Package Summary
| Version | 1.4.0 | 
| License | Apache License 2.0 | 
| Build type | AMENT_CMAKE | 
| Use | RECOMMENDED | 
Repository Summary
| Checkout URI | https://github.com/autowarefoundation/autoware_core.git | 
| VCS Type | git | 
| VCS Version | main | 
| Last Updated | 2025-10-31 | 
| Dev Status | DEVELOPED | 
| Released | RELEASED | 
| Contributing | 
        
          Help Wanted (-)
        
         Good First Issues (-) Pull Requests to Review (-)  | 
    
Package Description
Maintainers
- amc-nu
 - Yukihiro Saito
 - Kyoichi Sugahara
 - Dai Nguyen
 - Kenzo Lobos-Tsunekawa
 - Yihsiang Fang
 - Yoshi Ri
 - David Wong
 - Melike Tanrikulu
 - Max Schmeller
 - Xingang Liu
 
Authors
autoware_crop_box_filter
Overview
The autoware_crop_box_filter is a package that crops the input pointcloud to a specified bounding box. This is useful for reducing the computational load and improving the performance of the system.
Design
The autoware_crop_box_filter is implemented as a autoware core node that subscribes to the input pointcloud, and publishes the filtered pointcloud. The bounding box is specified using the min_point and max_point parameters.
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
~/crop_box_polygon | 
      geometry_msgs::msg::PolygonStamped | 
      bounding box polygon | 
Parameters
Launch file Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | the frame id in which filtering is performed | 
output_frame | 
      string | ” “ | output frame id of the filtered points | 
input_pointcloud_frame | 
      string | ” “ | frame id of input pointcloud | 
max_queue_size | 
      int | 5 | max buffer size of input/output topics | 
crop_box_filter_param_file | 
      string | ” “ | path to the parameter file for the node | 
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
min_x | 
      double | -5.0 | minimum x value of the crop box | 
min_y | 
      double | -5.0 | minimum y value of the crop box | 
min_z | 
      double | -5.0 | minimum z value of the crop box | 
max_x | 
      double | 5.0 | maximum x value of the crop box | 
max_y | 
      double | 5.0 | maximum y value of the crop box | 
max_z | 
      double | 5.0 | maximum z value of the crop box | 
negative | 
      bool | true | if true, points inside the box are removed, otherwise points outside the box are removed | 
Usage
1.publish static tf from input pointcloud to target frame that is used for filtering
ros2 run tf2_ros static_transform_publisher 2.0 3.2 1.3 0 0 0 1  velodyne_top_base_link  base_link
2.launch node
ros2 launch autoware_crop_box_filter crop_box_filter_node.launch.xml
3. launch rviz2 and AWSIM
Changelog for package autoware_crop_box_filter
1.1.0 (2025-05-01)
- 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko
 
1.4.0 (2025-08-11)
- chore: bump version to 1.3.0 (#554)
 - Contributors: Ryohsuke Mitsudome
 
1.3.0 (2025-06-23)
- 
    
fix: to be consistent version in all package.xml(s)
 - 
    
fix(autoware_crop_box_filter): fix deprecated autoware_utils header (#418)
- fix autoware_utils header
 
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko, Masaki Baba, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- chore: update version in package.xml
 - feat(autoware_crop_box_filter): reimplementation in core repo (#279) Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - Contributors: Ryohsuke Mitsudome, 心刚
 
Package Dependencies
System Dependencies
Dependant Packages
Launch files
- launch/crop_box_filter_node.launch.xml
                
- 
                    
- input_topic_name [default: /sensing/lidar/top/pointcloud_raw_ex]
 - output_topic_name [default: /sensing/lidar/top/self_cropped/pointcloud_ex]
 - input_frame [default: base_link]
 - output_frame [default: base_link]
 - input_pointcloud_frame [default: velodyne_top_base_link]
 - crop_box_filter_param_file [default: $(find-pkg-share autoware_crop_box_filter)/config/crop_box_filter_node.param.yaml]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_crop_box_filter at Robotics Stack Exchange
Package Summary
| Version | 1.4.0 | 
| License | Apache License 2.0 | 
| Build type | AMENT_CMAKE | 
| Use | RECOMMENDED | 
Repository Summary
| Checkout URI | https://github.com/autowarefoundation/autoware_core.git | 
| VCS Type | git | 
| VCS Version | main | 
| Last Updated | 2025-10-31 | 
| Dev Status | DEVELOPED | 
| Released | RELEASED | 
| Contributing | 
        
          Help Wanted (-)
        
         Good First Issues (-) Pull Requests to Review (-)  | 
    
Package Description
Maintainers
- amc-nu
 - Yukihiro Saito
 - Kyoichi Sugahara
 - Dai Nguyen
 - Kenzo Lobos-Tsunekawa
 - Yihsiang Fang
 - Yoshi Ri
 - David Wong
 - Melike Tanrikulu
 - Max Schmeller
 - Xingang Liu
 
Authors
autoware_crop_box_filter
Overview
The autoware_crop_box_filter is a package that crops the input pointcloud to a specified bounding box. This is useful for reducing the computational load and improving the performance of the system.
Design
The autoware_crop_box_filter is implemented as a autoware core node that subscribes to the input pointcloud, and publishes the filtered pointcloud. The bounding box is specified using the min_point and max_point parameters.
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
~/crop_box_polygon | 
      geometry_msgs::msg::PolygonStamped | 
      bounding box polygon | 
Parameters
Launch file Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | the frame id in which filtering is performed | 
output_frame | 
      string | ” “ | output frame id of the filtered points | 
input_pointcloud_frame | 
      string | ” “ | frame id of input pointcloud | 
max_queue_size | 
      int | 5 | max buffer size of input/output topics | 
crop_box_filter_param_file | 
      string | ” “ | path to the parameter file for the node | 
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
min_x | 
      double | -5.0 | minimum x value of the crop box | 
min_y | 
      double | -5.0 | minimum y value of the crop box | 
min_z | 
      double | -5.0 | minimum z value of the crop box | 
max_x | 
      double | 5.0 | maximum x value of the crop box | 
max_y | 
      double | 5.0 | maximum y value of the crop box | 
max_z | 
      double | 5.0 | maximum z value of the crop box | 
negative | 
      bool | true | if true, points inside the box are removed, otherwise points outside the box are removed | 
Usage
1.publish static tf from input pointcloud to target frame that is used for filtering
ros2 run tf2_ros static_transform_publisher 2.0 3.2 1.3 0 0 0 1  velodyne_top_base_link  base_link
2.launch node
ros2 launch autoware_crop_box_filter crop_box_filter_node.launch.xml
3. launch rviz2 and AWSIM
Changelog for package autoware_crop_box_filter
1.1.0 (2025-05-01)
- 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko
 
1.4.0 (2025-08-11)
- chore: bump version to 1.3.0 (#554)
 - Contributors: Ryohsuke Mitsudome
 
1.3.0 (2025-06-23)
- 
    
fix: to be consistent version in all package.xml(s)
 - 
    
fix(autoware_crop_box_filter): fix deprecated autoware_utils header (#418)
- fix autoware_utils header
 
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko, Masaki Baba, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- chore: update version in package.xml
 - feat(autoware_crop_box_filter): reimplementation in core repo (#279) Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - Contributors: Ryohsuke Mitsudome, 心刚
 
Package Dependencies
System Dependencies
Dependant Packages
Launch files
- launch/crop_box_filter_node.launch.xml
                
- 
                    
- input_topic_name [default: /sensing/lidar/top/pointcloud_raw_ex]
 - output_topic_name [default: /sensing/lidar/top/self_cropped/pointcloud_ex]
 - input_frame [default: base_link]
 - output_frame [default: base_link]
 - input_pointcloud_frame [default: velodyne_top_base_link]
 - crop_box_filter_param_file [default: $(find-pkg-share autoware_crop_box_filter)/config/crop_box_filter_node.param.yaml]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_crop_box_filter at Robotics Stack Exchange
Package Summary
| Version | 1.4.0 | 
| License | Apache License 2.0 | 
| Build type | AMENT_CMAKE | 
| Use | RECOMMENDED | 
Repository Summary
| Checkout URI | https://github.com/autowarefoundation/autoware_core.git | 
| VCS Type | git | 
| VCS Version | main | 
| Last Updated | 2025-10-31 | 
| Dev Status | DEVELOPED | 
| Released | RELEASED | 
| Contributing | 
        
          Help Wanted (-)
        
         Good First Issues (-) Pull Requests to Review (-)  | 
    
Package Description
Maintainers
- amc-nu
 - Yukihiro Saito
 - Kyoichi Sugahara
 - Dai Nguyen
 - Kenzo Lobos-Tsunekawa
 - Yihsiang Fang
 - Yoshi Ri
 - David Wong
 - Melike Tanrikulu
 - Max Schmeller
 - Xingang Liu
 
Authors
autoware_crop_box_filter
Overview
The autoware_crop_box_filter is a package that crops the input pointcloud to a specified bounding box. This is useful for reducing the computational load and improving the performance of the system.
Design
The autoware_crop_box_filter is implemented as a autoware core node that subscribes to the input pointcloud, and publishes the filtered pointcloud. The bounding box is specified using the min_point and max_point parameters.
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
~/crop_box_polygon | 
      geometry_msgs::msg::PolygonStamped | 
      bounding box polygon | 
Parameters
Launch file Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | the frame id in which filtering is performed | 
output_frame | 
      string | ” “ | output frame id of the filtered points | 
input_pointcloud_frame | 
      string | ” “ | frame id of input pointcloud | 
max_queue_size | 
      int | 5 | max buffer size of input/output topics | 
crop_box_filter_param_file | 
      string | ” “ | path to the parameter file for the node | 
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
min_x | 
      double | -5.0 | minimum x value of the crop box | 
min_y | 
      double | -5.0 | minimum y value of the crop box | 
min_z | 
      double | -5.0 | minimum z value of the crop box | 
max_x | 
      double | 5.0 | maximum x value of the crop box | 
max_y | 
      double | 5.0 | maximum y value of the crop box | 
max_z | 
      double | 5.0 | maximum z value of the crop box | 
negative | 
      bool | true | if true, points inside the box are removed, otherwise points outside the box are removed | 
Usage
1.publish static tf from input pointcloud to target frame that is used for filtering
ros2 run tf2_ros static_transform_publisher 2.0 3.2 1.3 0 0 0 1  velodyne_top_base_link  base_link
2.launch node
ros2 launch autoware_crop_box_filter crop_box_filter_node.launch.xml
3. launch rviz2 and AWSIM
Changelog for package autoware_crop_box_filter
1.1.0 (2025-05-01)
- 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko
 
1.4.0 (2025-08-11)
- chore: bump version to 1.3.0 (#554)
 - Contributors: Ryohsuke Mitsudome
 
1.3.0 (2025-06-23)
- 
    
fix: to be consistent version in all package.xml(s)
 - 
    
fix(autoware_crop_box_filter): fix deprecated autoware_utils header (#418)
- fix autoware_utils header
 
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko, Masaki Baba, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- chore: update version in package.xml
 - feat(autoware_crop_box_filter): reimplementation in core repo (#279) Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - Contributors: Ryohsuke Mitsudome, 心刚
 
Package Dependencies
System Dependencies
Dependant Packages
Launch files
- launch/crop_box_filter_node.launch.xml
                
- 
                    
- input_topic_name [default: /sensing/lidar/top/pointcloud_raw_ex]
 - output_topic_name [default: /sensing/lidar/top/self_cropped/pointcloud_ex]
 - input_frame [default: base_link]
 - output_frame [default: base_link]
 - input_pointcloud_frame [default: velodyne_top_base_link]
 - crop_box_filter_param_file [default: $(find-pkg-share autoware_crop_box_filter)/config/crop_box_filter_node.param.yaml]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_crop_box_filter at Robotics Stack Exchange
Package Summary
| Version | 1.4.0 | 
| License | Apache License 2.0 | 
| Build type | AMENT_CMAKE | 
| Use | RECOMMENDED | 
Repository Summary
| Checkout URI | https://github.com/autowarefoundation/autoware_core.git | 
| VCS Type | git | 
| VCS Version | main | 
| Last Updated | 2025-10-31 | 
| Dev Status | DEVELOPED | 
| Released | RELEASED | 
| Contributing | 
        
          Help Wanted (-)
        
         Good First Issues (-) Pull Requests to Review (-)  | 
    
Package Description
Maintainers
- amc-nu
 - Yukihiro Saito
 - Kyoichi Sugahara
 - Dai Nguyen
 - Kenzo Lobos-Tsunekawa
 - Yihsiang Fang
 - Yoshi Ri
 - David Wong
 - Melike Tanrikulu
 - Max Schmeller
 - Xingang Liu
 
Authors
autoware_crop_box_filter
Overview
The autoware_crop_box_filter is a package that crops the input pointcloud to a specified bounding box. This is useful for reducing the computational load and improving the performance of the system.
Design
The autoware_crop_box_filter is implemented as a autoware core node that subscribes to the input pointcloud, and publishes the filtered pointcloud. The bounding box is specified using the min_point and max_point parameters.
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
~/crop_box_polygon | 
      geometry_msgs::msg::PolygonStamped | 
      bounding box polygon | 
Parameters
Launch file Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | the frame id in which filtering is performed | 
output_frame | 
      string | ” “ | output frame id of the filtered points | 
input_pointcloud_frame | 
      string | ” “ | frame id of input pointcloud | 
max_queue_size | 
      int | 5 | max buffer size of input/output topics | 
crop_box_filter_param_file | 
      string | ” “ | path to the parameter file for the node | 
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
min_x | 
      double | -5.0 | minimum x value of the crop box | 
min_y | 
      double | -5.0 | minimum y value of the crop box | 
min_z | 
      double | -5.0 | minimum z value of the crop box | 
max_x | 
      double | 5.0 | maximum x value of the crop box | 
max_y | 
      double | 5.0 | maximum y value of the crop box | 
max_z | 
      double | 5.0 | maximum z value of the crop box | 
negative | 
      bool | true | if true, points inside the box are removed, otherwise points outside the box are removed | 
Usage
1.publish static tf from input pointcloud to target frame that is used for filtering
ros2 run tf2_ros static_transform_publisher 2.0 3.2 1.3 0 0 0 1  velodyne_top_base_link  base_link
2.launch node
ros2 launch autoware_crop_box_filter crop_box_filter_node.launch.xml
3. launch rviz2 and AWSIM
Changelog for package autoware_crop_box_filter
1.1.0 (2025-05-01)
- 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko
 
1.4.0 (2025-08-11)
- chore: bump version to 1.3.0 (#554)
 - Contributors: Ryohsuke Mitsudome
 
1.3.0 (2025-06-23)
- 
    
fix: to be consistent version in all package.xml(s)
 - 
    
fix(autoware_crop_box_filter): fix deprecated autoware_utils header (#418)
- fix autoware_utils header
 
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko, Masaki Baba, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- chore: update version in package.xml
 - feat(autoware_crop_box_filter): reimplementation in core repo (#279) Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - Contributors: Ryohsuke Mitsudome, 心刚
 
Package Dependencies
System Dependencies
Dependant Packages
Launch files
- launch/crop_box_filter_node.launch.xml
                
- 
                    
- input_topic_name [default: /sensing/lidar/top/pointcloud_raw_ex]
 - output_topic_name [default: /sensing/lidar/top/self_cropped/pointcloud_ex]
 - input_frame [default: base_link]
 - output_frame [default: base_link]
 - input_pointcloud_frame [default: velodyne_top_base_link]
 - crop_box_filter_param_file [default: $(find-pkg-share autoware_crop_box_filter)/config/crop_box_filter_node.param.yaml]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_crop_box_filter at Robotics Stack Exchange
Package Summary
| Version | 1.4.0 | 
| License | Apache License 2.0 | 
| Build type | AMENT_CMAKE | 
| Use | RECOMMENDED | 
Repository Summary
| Checkout URI | https://github.com/autowarefoundation/autoware_core.git | 
| VCS Type | git | 
| VCS Version | main | 
| Last Updated | 2025-10-31 | 
| Dev Status | DEVELOPED | 
| Released | RELEASED | 
| Contributing | 
        
          Help Wanted (-)
        
         Good First Issues (-) Pull Requests to Review (-)  | 
    
Package Description
Maintainers
- amc-nu
 - Yukihiro Saito
 - Kyoichi Sugahara
 - Dai Nguyen
 - Kenzo Lobos-Tsunekawa
 - Yihsiang Fang
 - Yoshi Ri
 - David Wong
 - Melike Tanrikulu
 - Max Schmeller
 - Xingang Liu
 
Authors
autoware_crop_box_filter
Overview
The autoware_crop_box_filter is a package that crops the input pointcloud to a specified bounding box. This is useful for reducing the computational load and improving the performance of the system.
Design
The autoware_crop_box_filter is implemented as a autoware core node that subscribes to the input pointcloud, and publishes the filtered pointcloud. The bounding box is specified using the min_point and max_point parameters.
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
~/crop_box_polygon | 
      geometry_msgs::msg::PolygonStamped | 
      bounding box polygon | 
Parameters
Launch file Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | the frame id in which filtering is performed | 
output_frame | 
      string | ” “ | output frame id of the filtered points | 
input_pointcloud_frame | 
      string | ” “ | frame id of input pointcloud | 
max_queue_size | 
      int | 5 | max buffer size of input/output topics | 
crop_box_filter_param_file | 
      string | ” “ | path to the parameter file for the node | 
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
min_x | 
      double | -5.0 | minimum x value of the crop box | 
min_y | 
      double | -5.0 | minimum y value of the crop box | 
min_z | 
      double | -5.0 | minimum z value of the crop box | 
max_x | 
      double | 5.0 | maximum x value of the crop box | 
max_y | 
      double | 5.0 | maximum y value of the crop box | 
max_z | 
      double | 5.0 | maximum z value of the crop box | 
negative | 
      bool | true | if true, points inside the box are removed, otherwise points outside the box are removed | 
Usage
1.publish static tf from input pointcloud to target frame that is used for filtering
ros2 run tf2_ros static_transform_publisher 2.0 3.2 1.3 0 0 0 1  velodyne_top_base_link  base_link
2.launch node
ros2 launch autoware_crop_box_filter crop_box_filter_node.launch.xml
3. launch rviz2 and AWSIM
Changelog for package autoware_crop_box_filter
1.1.0 (2025-05-01)
- 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko
 
1.4.0 (2025-08-11)
- chore: bump version to 1.3.0 (#554)
 - Contributors: Ryohsuke Mitsudome
 
1.3.0 (2025-06-23)
- 
    
fix: to be consistent version in all package.xml(s)
 - 
    
fix(autoware_crop_box_filter): fix deprecated autoware_utils header (#418)
- fix autoware_utils header
 
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko, Masaki Baba, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- chore: update version in package.xml
 - feat(autoware_crop_box_filter): reimplementation in core repo (#279) Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - Contributors: Ryohsuke Mitsudome, 心刚
 
Package Dependencies
System Dependencies
Dependant Packages
Launch files
- launch/crop_box_filter_node.launch.xml
                
- 
                    
- input_topic_name [default: /sensing/lidar/top/pointcloud_raw_ex]
 - output_topic_name [default: /sensing/lidar/top/self_cropped/pointcloud_ex]
 - input_frame [default: base_link]
 - output_frame [default: base_link]
 - input_pointcloud_frame [default: velodyne_top_base_link]
 - crop_box_filter_param_file [default: $(find-pkg-share autoware_crop_box_filter)/config/crop_box_filter_node.param.yaml]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_crop_box_filter at Robotics Stack Exchange
Package Summary
| Version | 1.4.0 | 
| License | Apache License 2.0 | 
| Build type | AMENT_CMAKE | 
| Use | RECOMMENDED | 
Repository Summary
| Checkout URI | https://github.com/autowarefoundation/autoware_core.git | 
| VCS Type | git | 
| VCS Version | main | 
| Last Updated | 2025-10-31 | 
| Dev Status | DEVELOPED | 
| Released | RELEASED | 
| Contributing | 
        
          Help Wanted (-)
        
         Good First Issues (-) Pull Requests to Review (-)  | 
    
Package Description
Maintainers
- amc-nu
 - Yukihiro Saito
 - Kyoichi Sugahara
 - Dai Nguyen
 - Kenzo Lobos-Tsunekawa
 - Yihsiang Fang
 - Yoshi Ri
 - David Wong
 - Melike Tanrikulu
 - Max Schmeller
 - Xingang Liu
 
Authors
autoware_crop_box_filter
Overview
The autoware_crop_box_filter is a package that crops the input pointcloud to a specified bounding box. This is useful for reducing the computational load and improving the performance of the system.
Design
The autoware_crop_box_filter is implemented as a autoware core node that subscribes to the input pointcloud, and publishes the filtered pointcloud. The bounding box is specified using the min_point and max_point parameters.
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
~/crop_box_polygon | 
      geometry_msgs::msg::PolygonStamped | 
      bounding box polygon | 
Parameters
Launch file Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | the frame id in which filtering is performed | 
output_frame | 
      string | ” “ | output frame id of the filtered points | 
input_pointcloud_frame | 
      string | ” “ | frame id of input pointcloud | 
max_queue_size | 
      int | 5 | max buffer size of input/output topics | 
crop_box_filter_param_file | 
      string | ” “ | path to the parameter file for the node | 
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
min_x | 
      double | -5.0 | minimum x value of the crop box | 
min_y | 
      double | -5.0 | minimum y value of the crop box | 
min_z | 
      double | -5.0 | minimum z value of the crop box | 
max_x | 
      double | 5.0 | maximum x value of the crop box | 
max_y | 
      double | 5.0 | maximum y value of the crop box | 
max_z | 
      double | 5.0 | maximum z value of the crop box | 
negative | 
      bool | true | if true, points inside the box are removed, otherwise points outside the box are removed | 
Usage
1.publish static tf from input pointcloud to target frame that is used for filtering
ros2 run tf2_ros static_transform_publisher 2.0 3.2 1.3 0 0 0 1  velodyne_top_base_link  base_link
2.launch node
ros2 launch autoware_crop_box_filter crop_box_filter_node.launch.xml
3. launch rviz2 and AWSIM
Changelog for package autoware_crop_box_filter
1.1.0 (2025-05-01)
- 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko
 
1.4.0 (2025-08-11)
- chore: bump version to 1.3.0 (#554)
 - Contributors: Ryohsuke Mitsudome
 
1.3.0 (2025-06-23)
- 
    
fix: to be consistent version in all package.xml(s)
 - 
    
fix(autoware_crop_box_filter): fix deprecated autoware_utils header (#418)
- fix autoware_utils header
 
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko, Masaki Baba, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- chore: update version in package.xml
 - feat(autoware_crop_box_filter): reimplementation in core repo (#279) Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - Contributors: Ryohsuke Mitsudome, 心刚
 
Package Dependencies
System Dependencies
Dependant Packages
Launch files
- launch/crop_box_filter_node.launch.xml
                
- 
                    
- input_topic_name [default: /sensing/lidar/top/pointcloud_raw_ex]
 - output_topic_name [default: /sensing/lidar/top/self_cropped/pointcloud_ex]
 - input_frame [default: base_link]
 - output_frame [default: base_link]
 - input_pointcloud_frame [default: velodyne_top_base_link]
 - crop_box_filter_param_file [default: $(find-pkg-share autoware_crop_box_filter)/config/crop_box_filter_node.param.yaml]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_crop_box_filter at Robotics Stack Exchange
Package Summary
| Version | 1.4.0 | 
| License | Apache License 2.0 | 
| Build type | AMENT_CMAKE | 
| Use | RECOMMENDED | 
Repository Summary
| Checkout URI | https://github.com/autowarefoundation/autoware_core.git | 
| VCS Type | git | 
| VCS Version | main | 
| Last Updated | 2025-10-31 | 
| Dev Status | DEVELOPED | 
| Released | RELEASED | 
| Contributing | 
        
          Help Wanted (-)
        
         Good First Issues (-) Pull Requests to Review (-)  | 
    
Package Description
Maintainers
- amc-nu
 - Yukihiro Saito
 - Kyoichi Sugahara
 - Dai Nguyen
 - Kenzo Lobos-Tsunekawa
 - Yihsiang Fang
 - Yoshi Ri
 - David Wong
 - Melike Tanrikulu
 - Max Schmeller
 - Xingang Liu
 
Authors
autoware_crop_box_filter
Overview
The autoware_crop_box_filter is a package that crops the input pointcloud to a specified bounding box. This is useful for reducing the computational load and improving the performance of the system.
Design
The autoware_crop_box_filter is implemented as a autoware core node that subscribes to the input pointcloud, and publishes the filtered pointcloud. The bounding box is specified using the min_point and max_point parameters.
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
~/crop_box_polygon | 
      geometry_msgs::msg::PolygonStamped | 
      bounding box polygon | 
Parameters
Launch file Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | the frame id in which filtering is performed | 
output_frame | 
      string | ” “ | output frame id of the filtered points | 
input_pointcloud_frame | 
      string | ” “ | frame id of input pointcloud | 
max_queue_size | 
      int | 5 | max buffer size of input/output topics | 
crop_box_filter_param_file | 
      string | ” “ | path to the parameter file for the node | 
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
min_x | 
      double | -5.0 | minimum x value of the crop box | 
min_y | 
      double | -5.0 | minimum y value of the crop box | 
min_z | 
      double | -5.0 | minimum z value of the crop box | 
max_x | 
      double | 5.0 | maximum x value of the crop box | 
max_y | 
      double | 5.0 | maximum y value of the crop box | 
max_z | 
      double | 5.0 | maximum z value of the crop box | 
negative | 
      bool | true | if true, points inside the box are removed, otherwise points outside the box are removed | 
Usage
1.publish static tf from input pointcloud to target frame that is used for filtering
ros2 run tf2_ros static_transform_publisher 2.0 3.2 1.3 0 0 0 1  velodyne_top_base_link  base_link
2.launch node
ros2 launch autoware_crop_box_filter crop_box_filter_node.launch.xml
3. launch rviz2 and AWSIM
Changelog for package autoware_crop_box_filter
1.1.0 (2025-05-01)
- 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko
 
1.4.0 (2025-08-11)
- chore: bump version to 1.3.0 (#554)
 - Contributors: Ryohsuke Mitsudome
 
1.3.0 (2025-06-23)
- 
    
fix: to be consistent version in all package.xml(s)
 - 
    
fix(autoware_crop_box_filter): fix deprecated autoware_utils header (#418)
- fix autoware_utils header
 
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko, Masaki Baba, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- chore: update version in package.xml
 - feat(autoware_crop_box_filter): reimplementation in core repo (#279) Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - Contributors: Ryohsuke Mitsudome, 心刚
 
Package Dependencies
System Dependencies
Dependant Packages
Launch files
- launch/crop_box_filter_node.launch.xml
                
- 
                    
- input_topic_name [default: /sensing/lidar/top/pointcloud_raw_ex]
 - output_topic_name [default: /sensing/lidar/top/self_cropped/pointcloud_ex]
 - input_frame [default: base_link]
 - output_frame [default: base_link]
 - input_pointcloud_frame [default: velodyne_top_base_link]
 - crop_box_filter_param_file [default: $(find-pkg-share autoware_crop_box_filter)/config/crop_box_filter_node.param.yaml]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_crop_box_filter at Robotics Stack Exchange
Package Summary
| Version | 1.4.0 | 
| License | Apache License 2.0 | 
| Build type | AMENT_CMAKE | 
| Use | RECOMMENDED | 
Repository Summary
| Checkout URI | https://github.com/autowarefoundation/autoware_core.git | 
| VCS Type | git | 
| VCS Version | main | 
| Last Updated | 2025-10-31 | 
| Dev Status | DEVELOPED | 
| Released | RELEASED | 
| Contributing | 
        
          Help Wanted (-)
        
         Good First Issues (-) Pull Requests to Review (-)  | 
    
Package Description
Maintainers
- amc-nu
 - Yukihiro Saito
 - Kyoichi Sugahara
 - Dai Nguyen
 - Kenzo Lobos-Tsunekawa
 - Yihsiang Fang
 - Yoshi Ri
 - David Wong
 - Melike Tanrikulu
 - Max Schmeller
 - Xingang Liu
 
Authors
autoware_crop_box_filter
Overview
The autoware_crop_box_filter is a package that crops the input pointcloud to a specified bounding box. This is useful for reducing the computational load and improving the performance of the system.
Design
The autoware_crop_box_filter is implemented as a autoware core node that subscribes to the input pointcloud, and publishes the filtered pointcloud. The bounding box is specified using the min_point and max_point parameters.
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
~/crop_box_polygon | 
      geometry_msgs::msg::PolygonStamped | 
      bounding box polygon | 
Parameters
Launch file Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | the frame id in which filtering is performed | 
output_frame | 
      string | ” “ | output frame id of the filtered points | 
input_pointcloud_frame | 
      string | ” “ | frame id of input pointcloud | 
max_queue_size | 
      int | 5 | max buffer size of input/output topics | 
crop_box_filter_param_file | 
      string | ” “ | path to the parameter file for the node | 
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
min_x | 
      double | -5.0 | minimum x value of the crop box | 
min_y | 
      double | -5.0 | minimum y value of the crop box | 
min_z | 
      double | -5.0 | minimum z value of the crop box | 
max_x | 
      double | 5.0 | maximum x value of the crop box | 
max_y | 
      double | 5.0 | maximum y value of the crop box | 
max_z | 
      double | 5.0 | maximum z value of the crop box | 
negative | 
      bool | true | if true, points inside the box are removed, otherwise points outside the box are removed | 
Usage
1.publish static tf from input pointcloud to target frame that is used for filtering
ros2 run tf2_ros static_transform_publisher 2.0 3.2 1.3 0 0 0 1  velodyne_top_base_link  base_link
2.launch node
ros2 launch autoware_crop_box_filter crop_box_filter_node.launch.xml
3. launch rviz2 and AWSIM
Changelog for package autoware_crop_box_filter
1.1.0 (2025-05-01)
- 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko
 
1.4.0 (2025-08-11)
- chore: bump version to 1.3.0 (#554)
 - Contributors: Ryohsuke Mitsudome
 
1.3.0 (2025-06-23)
- 
    
fix: to be consistent version in all package.xml(s)
 - 
    
fix(autoware_crop_box_filter): fix deprecated autoware_utils header (#418)
- fix autoware_utils header
 
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko, Masaki Baba, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- chore: update version in package.xml
 - feat(autoware_crop_box_filter): reimplementation in core repo (#279) Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - Contributors: Ryohsuke Mitsudome, 心刚
 
Package Dependencies
System Dependencies
Dependant Packages
Launch files
- launch/crop_box_filter_node.launch.xml
                
- 
                    
- input_topic_name [default: /sensing/lidar/top/pointcloud_raw_ex]
 - output_topic_name [default: /sensing/lidar/top/self_cropped/pointcloud_ex]
 - input_frame [default: base_link]
 - output_frame [default: base_link]
 - input_pointcloud_frame [default: velodyne_top_base_link]
 - crop_box_filter_param_file [default: $(find-pkg-share autoware_crop_box_filter)/config/crop_box_filter_node.param.yaml]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_crop_box_filter at Robotics Stack Exchange
Package Summary
| Version | 1.4.0 | 
| License | Apache License 2.0 | 
| Build type | AMENT_CMAKE | 
| Use | RECOMMENDED | 
Repository Summary
| Checkout URI | https://github.com/autowarefoundation/autoware_core.git | 
| VCS Type | git | 
| VCS Version | main | 
| Last Updated | 2025-10-31 | 
| Dev Status | DEVELOPED | 
| Released | RELEASED | 
| Contributing | 
        
          Help Wanted (-)
        
         Good First Issues (-) Pull Requests to Review (-)  | 
    
Package Description
Maintainers
- amc-nu
 - Yukihiro Saito
 - Kyoichi Sugahara
 - Dai Nguyen
 - Kenzo Lobos-Tsunekawa
 - Yihsiang Fang
 - Yoshi Ri
 - David Wong
 - Melike Tanrikulu
 - Max Schmeller
 - Xingang Liu
 
Authors
autoware_crop_box_filter
Overview
The autoware_crop_box_filter is a package that crops the input pointcloud to a specified bounding box. This is useful for reducing the computational load and improving the performance of the system.
Design
The autoware_crop_box_filter is implemented as a autoware core node that subscribes to the input pointcloud, and publishes the filtered pointcloud. The bounding box is specified using the min_point and max_point parameters.
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
~/crop_box_polygon | 
      geometry_msgs::msg::PolygonStamped | 
      bounding box polygon | 
Parameters
Launch file Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | the frame id in which filtering is performed | 
output_frame | 
      string | ” “ | output frame id of the filtered points | 
input_pointcloud_frame | 
      string | ” “ | frame id of input pointcloud | 
max_queue_size | 
      int | 5 | max buffer size of input/output topics | 
crop_box_filter_param_file | 
      string | ” “ | path to the parameter file for the node | 
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
min_x | 
      double | -5.0 | minimum x value of the crop box | 
min_y | 
      double | -5.0 | minimum y value of the crop box | 
min_z | 
      double | -5.0 | minimum z value of the crop box | 
max_x | 
      double | 5.0 | maximum x value of the crop box | 
max_y | 
      double | 5.0 | maximum y value of the crop box | 
max_z | 
      double | 5.0 | maximum z value of the crop box | 
negative | 
      bool | true | if true, points inside the box are removed, otherwise points outside the box are removed | 
Usage
1.publish static tf from input pointcloud to target frame that is used for filtering
ros2 run tf2_ros static_transform_publisher 2.0 3.2 1.3 0 0 0 1  velodyne_top_base_link  base_link
2.launch node
ros2 launch autoware_crop_box_filter crop_box_filter_node.launch.xml
3. launch rviz2 and AWSIM
Changelog for package autoware_crop_box_filter
1.1.0 (2025-05-01)
- 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko
 
1.4.0 (2025-08-11)
- chore: bump version to 1.3.0 (#554)
 - Contributors: Ryohsuke Mitsudome
 
1.3.0 (2025-06-23)
- 
    
fix: to be consistent version in all package.xml(s)
 - 
    
fix(autoware_crop_box_filter): fix deprecated autoware_utils header (#418)
- fix autoware_utils header
 
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko, Masaki Baba, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- chore: update version in package.xml
 - feat(autoware_crop_box_filter): reimplementation in core repo (#279) Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - Contributors: Ryohsuke Mitsudome, 心刚
 
Package Dependencies
System Dependencies
Dependant Packages
Launch files
- launch/crop_box_filter_node.launch.xml
                
- 
                    
- input_topic_name [default: /sensing/lidar/top/pointcloud_raw_ex]
 - output_topic_name [default: /sensing/lidar/top/self_cropped/pointcloud_ex]
 - input_frame [default: base_link]
 - output_frame [default: base_link]
 - input_pointcloud_frame [default: velodyne_top_base_link]
 - crop_box_filter_param_file [default: $(find-pkg-share autoware_crop_box_filter)/config/crop_box_filter_node.param.yaml]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_crop_box_filter at Robotics Stack Exchange
Package Summary
| Version | 1.4.0 | 
| License | Apache License 2.0 | 
| Build type | AMENT_CMAKE | 
| Use | RECOMMENDED | 
Repository Summary
| Checkout URI | https://github.com/autowarefoundation/autoware_core.git | 
| VCS Type | git | 
| VCS Version | main | 
| Last Updated | 2025-10-31 | 
| Dev Status | DEVELOPED | 
| Released | RELEASED | 
| Contributing | 
        
          Help Wanted (-)
        
         Good First Issues (-) Pull Requests to Review (-)  | 
    
Package Description
Maintainers
- amc-nu
 - Yukihiro Saito
 - Kyoichi Sugahara
 - Dai Nguyen
 - Kenzo Lobos-Tsunekawa
 - Yihsiang Fang
 - Yoshi Ri
 - David Wong
 - Melike Tanrikulu
 - Max Schmeller
 - Xingang Liu
 
Authors
autoware_crop_box_filter
Overview
The autoware_crop_box_filter is a package that crops the input pointcloud to a specified bounding box. This is useful for reducing the computational load and improving the performance of the system.
Design
The autoware_crop_box_filter is implemented as a autoware core node that subscribes to the input pointcloud, and publishes the filtered pointcloud. The bounding box is specified using the min_point and max_point parameters.
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
~/crop_box_polygon | 
      geometry_msgs::msg::PolygonStamped | 
      bounding box polygon | 
Parameters
Launch file Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | the frame id in which filtering is performed | 
output_frame | 
      string | ” “ | output frame id of the filtered points | 
input_pointcloud_frame | 
      string | ” “ | frame id of input pointcloud | 
max_queue_size | 
      int | 5 | max buffer size of input/output topics | 
crop_box_filter_param_file | 
      string | ” “ | path to the parameter file for the node | 
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
min_x | 
      double | -5.0 | minimum x value of the crop box | 
min_y | 
      double | -5.0 | minimum y value of the crop box | 
min_z | 
      double | -5.0 | minimum z value of the crop box | 
max_x | 
      double | 5.0 | maximum x value of the crop box | 
max_y | 
      double | 5.0 | maximum y value of the crop box | 
max_z | 
      double | 5.0 | maximum z value of the crop box | 
negative | 
      bool | true | if true, points inside the box are removed, otherwise points outside the box are removed | 
Usage
1.publish static tf from input pointcloud to target frame that is used for filtering
ros2 run tf2_ros static_transform_publisher 2.0 3.2 1.3 0 0 0 1  velodyne_top_base_link  base_link
2.launch node
ros2 launch autoware_crop_box_filter crop_box_filter_node.launch.xml
3. launch rviz2 and AWSIM
Changelog for package autoware_crop_box_filter
1.1.0 (2025-05-01)
- 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko
 
1.4.0 (2025-08-11)
- chore: bump version to 1.3.0 (#554)
 - Contributors: Ryohsuke Mitsudome
 
1.3.0 (2025-06-23)
- 
    
fix: to be consistent version in all package.xml(s)
 - 
    
fix(autoware_crop_box_filter): fix deprecated autoware_utils header (#418)
- fix autoware_utils header
 
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko, Masaki Baba, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- chore: update version in package.xml
 - feat(autoware_crop_box_filter): reimplementation in core repo (#279) Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - Contributors: Ryohsuke Mitsudome, 心刚
 
Package Dependencies
System Dependencies
Dependant Packages
Launch files
- launch/crop_box_filter_node.launch.xml
                
- 
                    
- input_topic_name [default: /sensing/lidar/top/pointcloud_raw_ex]
 - output_topic_name [default: /sensing/lidar/top/self_cropped/pointcloud_ex]
 - input_frame [default: base_link]
 - output_frame [default: base_link]
 - input_pointcloud_frame [default: velodyne_top_base_link]
 - crop_box_filter_param_file [default: $(find-pkg-share autoware_crop_box_filter)/config/crop_box_filter_node.param.yaml]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_crop_box_filter at Robotics Stack Exchange
Package Summary
| Version | 1.4.0 | 
| License | Apache License 2.0 | 
| Build type | AMENT_CMAKE | 
| Use | RECOMMENDED | 
Repository Summary
| Checkout URI | https://github.com/autowarefoundation/autoware_core.git | 
| VCS Type | git | 
| VCS Version | main | 
| Last Updated | 2025-10-31 | 
| Dev Status | DEVELOPED | 
| Released | RELEASED | 
| Contributing | 
        
          Help Wanted (-)
        
         Good First Issues (-) Pull Requests to Review (-)  | 
    
Package Description
Maintainers
- amc-nu
 - Yukihiro Saito
 - Kyoichi Sugahara
 - Dai Nguyen
 - Kenzo Lobos-Tsunekawa
 - Yihsiang Fang
 - Yoshi Ri
 - David Wong
 - Melike Tanrikulu
 - Max Schmeller
 - Xingang Liu
 
Authors
autoware_crop_box_filter
Overview
The autoware_crop_box_filter is a package that crops the input pointcloud to a specified bounding box. This is useful for reducing the computational load and improving the performance of the system.
Design
The autoware_crop_box_filter is implemented as a autoware core node that subscribes to the input pointcloud, and publishes the filtered pointcloud. The bounding box is specified using the min_point and max_point parameters.
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
~/crop_box_polygon | 
      geometry_msgs::msg::PolygonStamped | 
      bounding box polygon | 
Parameters
Launch file Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | the frame id in which filtering is performed | 
output_frame | 
      string | ” “ | output frame id of the filtered points | 
input_pointcloud_frame | 
      string | ” “ | frame id of input pointcloud | 
max_queue_size | 
      int | 5 | max buffer size of input/output topics | 
crop_box_filter_param_file | 
      string | ” “ | path to the parameter file for the node | 
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
min_x | 
      double | -5.0 | minimum x value of the crop box | 
min_y | 
      double | -5.0 | minimum y value of the crop box | 
min_z | 
      double | -5.0 | minimum z value of the crop box | 
max_x | 
      double | 5.0 | maximum x value of the crop box | 
max_y | 
      double | 5.0 | maximum y value of the crop box | 
max_z | 
      double | 5.0 | maximum z value of the crop box | 
negative | 
      bool | true | if true, points inside the box are removed, otherwise points outside the box are removed | 
Usage
1.publish static tf from input pointcloud to target frame that is used for filtering
ros2 run tf2_ros static_transform_publisher 2.0 3.2 1.3 0 0 0 1  velodyne_top_base_link  base_link
2.launch node
ros2 launch autoware_crop_box_filter crop_box_filter_node.launch.xml
3. launch rviz2 and AWSIM
Changelog for package autoware_crop_box_filter
1.1.0 (2025-05-01)
- 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko
 
1.4.0 (2025-08-11)
- chore: bump version to 1.3.0 (#554)
 - Contributors: Ryohsuke Mitsudome
 
1.3.0 (2025-06-23)
- 
    
fix: to be consistent version in all package.xml(s)
 - 
    
fix(autoware_crop_box_filter): fix deprecated autoware_utils header (#418)
- fix autoware_utils header
 
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko, Masaki Baba, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- chore: update version in package.xml
 - feat(autoware_crop_box_filter): reimplementation in core repo (#279) Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - Contributors: Ryohsuke Mitsudome, 心刚
 
Package Dependencies
System Dependencies
Dependant Packages
Launch files
- launch/crop_box_filter_node.launch.xml
                
- 
                    
- input_topic_name [default: /sensing/lidar/top/pointcloud_raw_ex]
 - output_topic_name [default: /sensing/lidar/top/self_cropped/pointcloud_ex]
 - input_frame [default: base_link]
 - output_frame [default: base_link]
 - input_pointcloud_frame [default: velodyne_top_base_link]
 - crop_box_filter_param_file [default: $(find-pkg-share autoware_crop_box_filter)/config/crop_box_filter_node.param.yaml]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_crop_box_filter at Robotics Stack Exchange
Package Summary
| Version | 1.4.0 | 
| License | Apache License 2.0 | 
| Build type | AMENT_CMAKE | 
| Use | RECOMMENDED | 
Repository Summary
| Checkout URI | https://github.com/autowarefoundation/autoware_core.git | 
| VCS Type | git | 
| VCS Version | main | 
| Last Updated | 2025-10-31 | 
| Dev Status | DEVELOPED | 
| Released | RELEASED | 
| Contributing | 
        
          Help Wanted (-)
        
         Good First Issues (-) Pull Requests to Review (-)  | 
    
Package Description
Maintainers
- amc-nu
 - Yukihiro Saito
 - Kyoichi Sugahara
 - Dai Nguyen
 - Kenzo Lobos-Tsunekawa
 - Yihsiang Fang
 - Yoshi Ri
 - David Wong
 - Melike Tanrikulu
 - Max Schmeller
 - Xingang Liu
 
Authors
autoware_crop_box_filter
Overview
The autoware_crop_box_filter is a package that crops the input pointcloud to a specified bounding box. This is useful for reducing the computational load and improving the performance of the system.
Design
The autoware_crop_box_filter is implemented as a autoware core node that subscribes to the input pointcloud, and publishes the filtered pointcloud. The bounding box is specified using the min_point and max_point parameters.
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
~/crop_box_polygon | 
      geometry_msgs::msg::PolygonStamped | 
      bounding box polygon | 
Parameters
Launch file Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | the frame id in which filtering is performed | 
output_frame | 
      string | ” “ | output frame id of the filtered points | 
input_pointcloud_frame | 
      string | ” “ | frame id of input pointcloud | 
max_queue_size | 
      int | 5 | max buffer size of input/output topics | 
crop_box_filter_param_file | 
      string | ” “ | path to the parameter file for the node | 
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
min_x | 
      double | -5.0 | minimum x value of the crop box | 
min_y | 
      double | -5.0 | minimum y value of the crop box | 
min_z | 
      double | -5.0 | minimum z value of the crop box | 
max_x | 
      double | 5.0 | maximum x value of the crop box | 
max_y | 
      double | 5.0 | maximum y value of the crop box | 
max_z | 
      double | 5.0 | maximum z value of the crop box | 
negative | 
      bool | true | if true, points inside the box are removed, otherwise points outside the box are removed | 
Usage
1.publish static tf from input pointcloud to target frame that is used for filtering
ros2 run tf2_ros static_transform_publisher 2.0 3.2 1.3 0 0 0 1  velodyne_top_base_link  base_link
2.launch node
ros2 launch autoware_crop_box_filter crop_box_filter_node.launch.xml
3. launch rviz2 and AWSIM
Changelog for package autoware_crop_box_filter
1.1.0 (2025-05-01)
- 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko
 
1.4.0 (2025-08-11)
- chore: bump version to 1.3.0 (#554)
 - Contributors: Ryohsuke Mitsudome
 
1.3.0 (2025-06-23)
- 
    
fix: to be consistent version in all package.xml(s)
 - 
    
fix(autoware_crop_box_filter): fix deprecated autoware_utils header (#418)
- fix autoware_utils header
 
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko, Masaki Baba, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- chore: update version in package.xml
 - feat(autoware_crop_box_filter): reimplementation in core repo (#279) Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - Contributors: Ryohsuke Mitsudome, 心刚
 
Package Dependencies
System Dependencies
Dependant Packages
Launch files
- launch/crop_box_filter_node.launch.xml
                
- 
                    
- input_topic_name [default: /sensing/lidar/top/pointcloud_raw_ex]
 - output_topic_name [default: /sensing/lidar/top/self_cropped/pointcloud_ex]
 - input_frame [default: base_link]
 - output_frame [default: base_link]
 - input_pointcloud_frame [default: velodyne_top_base_link]
 - crop_box_filter_param_file [default: $(find-pkg-share autoware_crop_box_filter)/config/crop_box_filter_node.param.yaml]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_crop_box_filter at Robotics Stack Exchange
Package Summary
| Version | 1.4.0 | 
| License | Apache License 2.0 | 
| Build type | AMENT_CMAKE | 
| Use | RECOMMENDED | 
Repository Summary
| Checkout URI | https://github.com/autowarefoundation/autoware_core.git | 
| VCS Type | git | 
| VCS Version | main | 
| Last Updated | 2025-10-31 | 
| Dev Status | DEVELOPED | 
| Released | RELEASED | 
| Contributing | 
        
          Help Wanted (-)
        
         Good First Issues (-) Pull Requests to Review (-)  | 
    
Package Description
Maintainers
- amc-nu
 - Yukihiro Saito
 - Kyoichi Sugahara
 - Dai Nguyen
 - Kenzo Lobos-Tsunekawa
 - Yihsiang Fang
 - Yoshi Ri
 - David Wong
 - Melike Tanrikulu
 - Max Schmeller
 - Xingang Liu
 
Authors
autoware_crop_box_filter
Overview
The autoware_crop_box_filter is a package that crops the input pointcloud to a specified bounding box. This is useful for reducing the computational load and improving the performance of the system.
Design
The autoware_crop_box_filter is implemented as a autoware core node that subscribes to the input pointcloud, and publishes the filtered pointcloud. The bounding box is specified using the min_point and max_point parameters.
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
~/crop_box_polygon | 
      geometry_msgs::msg::PolygonStamped | 
      bounding box polygon | 
Parameters
Launch file Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | the frame id in which filtering is performed | 
output_frame | 
      string | ” “ | output frame id of the filtered points | 
input_pointcloud_frame | 
      string | ” “ | frame id of input pointcloud | 
max_queue_size | 
      int | 5 | max buffer size of input/output topics | 
crop_box_filter_param_file | 
      string | ” “ | path to the parameter file for the node | 
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
min_x | 
      double | -5.0 | minimum x value of the crop box | 
min_y | 
      double | -5.0 | minimum y value of the crop box | 
min_z | 
      double | -5.0 | minimum z value of the crop box | 
max_x | 
      double | 5.0 | maximum x value of the crop box | 
max_y | 
      double | 5.0 | maximum y value of the crop box | 
max_z | 
      double | 5.0 | maximum z value of the crop box | 
negative | 
      bool | true | if true, points inside the box are removed, otherwise points outside the box are removed | 
Usage
1.publish static tf from input pointcloud to target frame that is used for filtering
ros2 run tf2_ros static_transform_publisher 2.0 3.2 1.3 0 0 0 1  velodyne_top_base_link  base_link
2.launch node
ros2 launch autoware_crop_box_filter crop_box_filter_node.launch.xml
3. launch rviz2 and AWSIM
Changelog for package autoware_crop_box_filter
1.1.0 (2025-05-01)
- 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko
 
1.4.0 (2025-08-11)
- chore: bump version to 1.3.0 (#554)
 - Contributors: Ryohsuke Mitsudome
 
1.3.0 (2025-06-23)
- 
    
fix: to be consistent version in all package.xml(s)
 - 
    
fix(autoware_crop_box_filter): fix deprecated autoware_utils header (#418)
- fix autoware_utils header
 
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko, Masaki Baba, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- chore: update version in package.xml
 - feat(autoware_crop_box_filter): reimplementation in core repo (#279) Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - Contributors: Ryohsuke Mitsudome, 心刚
 
Package Dependencies
System Dependencies
Dependant Packages
Launch files
- launch/crop_box_filter_node.launch.xml
                
- 
                    
- input_topic_name [default: /sensing/lidar/top/pointcloud_raw_ex]
 - output_topic_name [default: /sensing/lidar/top/self_cropped/pointcloud_ex]
 - input_frame [default: base_link]
 - output_frame [default: base_link]
 - input_pointcloud_frame [default: velodyne_top_base_link]
 - crop_box_filter_param_file [default: $(find-pkg-share autoware_crop_box_filter)/config/crop_box_filter_node.param.yaml]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_crop_box_filter at Robotics Stack Exchange
Package Summary
| Version | 1.4.0 | 
| License | Apache License 2.0 | 
| Build type | AMENT_CMAKE | 
| Use | RECOMMENDED | 
Repository Summary
| Checkout URI | https://github.com/autowarefoundation/autoware_core.git | 
| VCS Type | git | 
| VCS Version | main | 
| Last Updated | 2025-10-31 | 
| Dev Status | DEVELOPED | 
| Released | RELEASED | 
| Contributing | 
        
          Help Wanted (-)
        
         Good First Issues (-) Pull Requests to Review (-)  | 
    
Package Description
Maintainers
- amc-nu
 - Yukihiro Saito
 - Kyoichi Sugahara
 - Dai Nguyen
 - Kenzo Lobos-Tsunekawa
 - Yihsiang Fang
 - Yoshi Ri
 - David Wong
 - Melike Tanrikulu
 - Max Schmeller
 - Xingang Liu
 
Authors
autoware_crop_box_filter
Overview
The autoware_crop_box_filter is a package that crops the input pointcloud to a specified bounding box. This is useful for reducing the computational load and improving the performance of the system.
Design
The autoware_crop_box_filter is implemented as a autoware core node that subscribes to the input pointcloud, and publishes the filtered pointcloud. The bounding box is specified using the min_point and max_point parameters.
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
~/crop_box_polygon | 
      geometry_msgs::msg::PolygonStamped | 
      bounding box polygon | 
Parameters
Launch file Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | the frame id in which filtering is performed | 
output_frame | 
      string | ” “ | output frame id of the filtered points | 
input_pointcloud_frame | 
      string | ” “ | frame id of input pointcloud | 
max_queue_size | 
      int | 5 | max buffer size of input/output topics | 
crop_box_filter_param_file | 
      string | ” “ | path to the parameter file for the node | 
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
min_x | 
      double | -5.0 | minimum x value of the crop box | 
min_y | 
      double | -5.0 | minimum y value of the crop box | 
min_z | 
      double | -5.0 | minimum z value of the crop box | 
max_x | 
      double | 5.0 | maximum x value of the crop box | 
max_y | 
      double | 5.0 | maximum y value of the crop box | 
max_z | 
      double | 5.0 | maximum z value of the crop box | 
negative | 
      bool | true | if true, points inside the box are removed, otherwise points outside the box are removed | 
Usage
1.publish static tf from input pointcloud to target frame that is used for filtering
ros2 run tf2_ros static_transform_publisher 2.0 3.2 1.3 0 0 0 1  velodyne_top_base_link  base_link
2.launch node
ros2 launch autoware_crop_box_filter crop_box_filter_node.launch.xml
3. launch rviz2 and AWSIM
Changelog for package autoware_crop_box_filter
1.1.0 (2025-05-01)
- 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko
 
1.4.0 (2025-08-11)
- chore: bump version to 1.3.0 (#554)
 - Contributors: Ryohsuke Mitsudome
 
1.3.0 (2025-06-23)
- 
    
fix: to be consistent version in all package.xml(s)
 - 
    
fix(autoware_crop_box_filter): fix deprecated autoware_utils header (#418)
- fix autoware_utils header
 
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko, Masaki Baba, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- chore: update version in package.xml
 - feat(autoware_crop_box_filter): reimplementation in core repo (#279) Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - Contributors: Ryohsuke Mitsudome, 心刚
 
Package Dependencies
System Dependencies
Dependant Packages
Launch files
- launch/crop_box_filter_node.launch.xml
                
- 
                    
- input_topic_name [default: /sensing/lidar/top/pointcloud_raw_ex]
 - output_topic_name [default: /sensing/lidar/top/self_cropped/pointcloud_ex]
 - input_frame [default: base_link]
 - output_frame [default: base_link]
 - input_pointcloud_frame [default: velodyne_top_base_link]
 - crop_box_filter_param_file [default: $(find-pkg-share autoware_crop_box_filter)/config/crop_box_filter_node.param.yaml]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_crop_box_filter at Robotics Stack Exchange
Package Summary
| Version | 1.4.0 | 
| License | Apache License 2.0 | 
| Build type | AMENT_CMAKE | 
| Use | RECOMMENDED | 
Repository Summary
| Checkout URI | https://github.com/autowarefoundation/autoware_core.git | 
| VCS Type | git | 
| VCS Version | main | 
| Last Updated | 2025-10-31 | 
| Dev Status | DEVELOPED | 
| Released | RELEASED | 
| Contributing | 
        
          Help Wanted (-)
        
         Good First Issues (-) Pull Requests to Review (-)  | 
    
Package Description
Maintainers
- amc-nu
 - Yukihiro Saito
 - Kyoichi Sugahara
 - Dai Nguyen
 - Kenzo Lobos-Tsunekawa
 - Yihsiang Fang
 - Yoshi Ri
 - David Wong
 - Melike Tanrikulu
 - Max Schmeller
 - Xingang Liu
 
Authors
autoware_crop_box_filter
Overview
The autoware_crop_box_filter is a package that crops the input pointcloud to a specified bounding box. This is useful for reducing the computational load and improving the performance of the system.
Design
The autoware_crop_box_filter is implemented as a autoware core node that subscribes to the input pointcloud, and publishes the filtered pointcloud. The bounding box is specified using the min_point and max_point parameters.
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
~/crop_box_polygon | 
      geometry_msgs::msg::PolygonStamped | 
      bounding box polygon | 
Parameters
Launch file Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | the frame id in which filtering is performed | 
output_frame | 
      string | ” “ | output frame id of the filtered points | 
input_pointcloud_frame | 
      string | ” “ | frame id of input pointcloud | 
max_queue_size | 
      int | 5 | max buffer size of input/output topics | 
crop_box_filter_param_file | 
      string | ” “ | path to the parameter file for the node | 
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
min_x | 
      double | -5.0 | minimum x value of the crop box | 
min_y | 
      double | -5.0 | minimum y value of the crop box | 
min_z | 
      double | -5.0 | minimum z value of the crop box | 
max_x | 
      double | 5.0 | maximum x value of the crop box | 
max_y | 
      double | 5.0 | maximum y value of the crop box | 
max_z | 
      double | 5.0 | maximum z value of the crop box | 
negative | 
      bool | true | if true, points inside the box are removed, otherwise points outside the box are removed | 
Usage
1.publish static tf from input pointcloud to target frame that is used for filtering
ros2 run tf2_ros static_transform_publisher 2.0 3.2 1.3 0 0 0 1  velodyne_top_base_link  base_link
2.launch node
ros2 launch autoware_crop_box_filter crop_box_filter_node.launch.xml
3. launch rviz2 and AWSIM
Changelog for package autoware_crop_box_filter
1.1.0 (2025-05-01)
- 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko
 
1.4.0 (2025-08-11)
- chore: bump version to 1.3.0 (#554)
 - Contributors: Ryohsuke Mitsudome
 
1.3.0 (2025-06-23)
- 
    
fix: to be consistent version in all package.xml(s)
 - 
    
fix(autoware_crop_box_filter): fix deprecated autoware_utils header (#418)
- fix autoware_utils header
 
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko, Masaki Baba, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- chore: update version in package.xml
 - feat(autoware_crop_box_filter): reimplementation in core repo (#279) Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - Contributors: Ryohsuke Mitsudome, 心刚
 
Package Dependencies
System Dependencies
Dependant Packages
Launch files
- launch/crop_box_filter_node.launch.xml
                
- 
                    
- input_topic_name [default: /sensing/lidar/top/pointcloud_raw_ex]
 - output_topic_name [default: /sensing/lidar/top/self_cropped/pointcloud_ex]
 - input_frame [default: base_link]
 - output_frame [default: base_link]
 - input_pointcloud_frame [default: velodyne_top_base_link]
 - crop_box_filter_param_file [default: $(find-pkg-share autoware_crop_box_filter)/config/crop_box_filter_node.param.yaml]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_crop_box_filter at Robotics Stack Exchange
Package Summary
| Version | 1.4.0 | 
| License | Apache License 2.0 | 
| Build type | AMENT_CMAKE | 
| Use | RECOMMENDED | 
Repository Summary
| Checkout URI | https://github.com/autowarefoundation/autoware_core.git | 
| VCS Type | git | 
| VCS Version | main | 
| Last Updated | 2025-10-31 | 
| Dev Status | DEVELOPED | 
| Released | RELEASED | 
| Contributing | 
        
          Help Wanted (-)
        
         Good First Issues (-) Pull Requests to Review (-)  | 
    
Package Description
Maintainers
- amc-nu
 - Yukihiro Saito
 - Kyoichi Sugahara
 - Dai Nguyen
 - Kenzo Lobos-Tsunekawa
 - Yihsiang Fang
 - Yoshi Ri
 - David Wong
 - Melike Tanrikulu
 - Max Schmeller
 - Xingang Liu
 
Authors
autoware_crop_box_filter
Overview
The autoware_crop_box_filter is a package that crops the input pointcloud to a specified bounding box. This is useful for reducing the computational load and improving the performance of the system.
Design
The autoware_crop_box_filter is implemented as a autoware core node that subscribes to the input pointcloud, and publishes the filtered pointcloud. The bounding box is specified using the min_point and max_point parameters.
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
~/crop_box_polygon | 
      geometry_msgs::msg::PolygonStamped | 
      bounding box polygon | 
Parameters
Launch file Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | the frame id in which filtering is performed | 
output_frame | 
      string | ” “ | output frame id of the filtered points | 
input_pointcloud_frame | 
      string | ” “ | frame id of input pointcloud | 
max_queue_size | 
      int | 5 | max buffer size of input/output topics | 
crop_box_filter_param_file | 
      string | ” “ | path to the parameter file for the node | 
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
min_x | 
      double | -5.0 | minimum x value of the crop box | 
min_y | 
      double | -5.0 | minimum y value of the crop box | 
min_z | 
      double | -5.0 | minimum z value of the crop box | 
max_x | 
      double | 5.0 | maximum x value of the crop box | 
max_y | 
      double | 5.0 | maximum y value of the crop box | 
max_z | 
      double | 5.0 | maximum z value of the crop box | 
negative | 
      bool | true | if true, points inside the box are removed, otherwise points outside the box are removed | 
Usage
1.publish static tf from input pointcloud to target frame that is used for filtering
ros2 run tf2_ros static_transform_publisher 2.0 3.2 1.3 0 0 0 1  velodyne_top_base_link  base_link
2.launch node
ros2 launch autoware_crop_box_filter crop_box_filter_node.launch.xml
3. launch rviz2 and AWSIM
Changelog for package autoware_crop_box_filter
1.1.0 (2025-05-01)
- 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko
 
1.4.0 (2025-08-11)
- chore: bump version to 1.3.0 (#554)
 - Contributors: Ryohsuke Mitsudome
 
1.3.0 (2025-06-23)
- 
    
fix: to be consistent version in all package.xml(s)
 - 
    
fix(autoware_crop_box_filter): fix deprecated autoware_utils header (#418)
- fix autoware_utils header
 
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko, Masaki Baba, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- chore: update version in package.xml
 - feat(autoware_crop_box_filter): reimplementation in core repo (#279) Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - Contributors: Ryohsuke Mitsudome, 心刚
 
Package Dependencies
System Dependencies
Dependant Packages
Launch files
- launch/crop_box_filter_node.launch.xml
                
- 
                    
- input_topic_name [default: /sensing/lidar/top/pointcloud_raw_ex]
 - output_topic_name [default: /sensing/lidar/top/self_cropped/pointcloud_ex]
 - input_frame [default: base_link]
 - output_frame [default: base_link]
 - input_pointcloud_frame [default: velodyne_top_base_link]
 - crop_box_filter_param_file [default: $(find-pkg-share autoware_crop_box_filter)/config/crop_box_filter_node.param.yaml]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_crop_box_filter at Robotics Stack Exchange
Package Summary
| Version | 1.4.0 | 
| License | Apache License 2.0 | 
| Build type | AMENT_CMAKE | 
| Use | RECOMMENDED | 
Repository Summary
| Checkout URI | https://github.com/autowarefoundation/autoware_core.git | 
| VCS Type | git | 
| VCS Version | main | 
| Last Updated | 2025-10-31 | 
| Dev Status | DEVELOPED | 
| Released | RELEASED | 
| Contributing | 
        
          Help Wanted (-)
        
         Good First Issues (-) Pull Requests to Review (-)  | 
    
Package Description
Maintainers
- amc-nu
 - Yukihiro Saito
 - Kyoichi Sugahara
 - Dai Nguyen
 - Kenzo Lobos-Tsunekawa
 - Yihsiang Fang
 - Yoshi Ri
 - David Wong
 - Melike Tanrikulu
 - Max Schmeller
 - Xingang Liu
 
Authors
autoware_crop_box_filter
Overview
The autoware_crop_box_filter is a package that crops the input pointcloud to a specified bounding box. This is useful for reducing the computational load and improving the performance of the system.
Design
The autoware_crop_box_filter is implemented as a autoware core node that subscribes to the input pointcloud, and publishes the filtered pointcloud. The bounding box is specified using the min_point and max_point parameters.
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
~/crop_box_polygon | 
      geometry_msgs::msg::PolygonStamped | 
      bounding box polygon | 
Parameters
Launch file Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | the frame id in which filtering is performed | 
output_frame | 
      string | ” “ | output frame id of the filtered points | 
input_pointcloud_frame | 
      string | ” “ | frame id of input pointcloud | 
max_queue_size | 
      int | 5 | max buffer size of input/output topics | 
crop_box_filter_param_file | 
      string | ” “ | path to the parameter file for the node | 
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
min_x | 
      double | -5.0 | minimum x value of the crop box | 
min_y | 
      double | -5.0 | minimum y value of the crop box | 
min_z | 
      double | -5.0 | minimum z value of the crop box | 
max_x | 
      double | 5.0 | maximum x value of the crop box | 
max_y | 
      double | 5.0 | maximum y value of the crop box | 
max_z | 
      double | 5.0 | maximum z value of the crop box | 
negative | 
      bool | true | if true, points inside the box are removed, otherwise points outside the box are removed | 
Usage
1.publish static tf from input pointcloud to target frame that is used for filtering
ros2 run tf2_ros static_transform_publisher 2.0 3.2 1.3 0 0 0 1  velodyne_top_base_link  base_link
2.launch node
ros2 launch autoware_crop_box_filter crop_box_filter_node.launch.xml
3. launch rviz2 and AWSIM
Changelog for package autoware_crop_box_filter
1.1.0 (2025-05-01)
- 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko
 
1.4.0 (2025-08-11)
- chore: bump version to 1.3.0 (#554)
 - Contributors: Ryohsuke Mitsudome
 
1.3.0 (2025-06-23)
- 
    
fix: to be consistent version in all package.xml(s)
 - 
    
fix(autoware_crop_box_filter): fix deprecated autoware_utils header (#418)
- fix autoware_utils header
 
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko, Masaki Baba, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- chore: update version in package.xml
 - feat(autoware_crop_box_filter): reimplementation in core repo (#279) Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - Contributors: Ryohsuke Mitsudome, 心刚
 
Package Dependencies
System Dependencies
Dependant Packages
Launch files
- launch/crop_box_filter_node.launch.xml
                
- 
                    
- input_topic_name [default: /sensing/lidar/top/pointcloud_raw_ex]
 - output_topic_name [default: /sensing/lidar/top/self_cropped/pointcloud_ex]
 - input_frame [default: base_link]
 - output_frame [default: base_link]
 - input_pointcloud_frame [default: velodyne_top_base_link]
 - crop_box_filter_param_file [default: $(find-pkg-share autoware_crop_box_filter)/config/crop_box_filter_node.param.yaml]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_crop_box_filter at Robotics Stack Exchange
Package Summary
| Version | 1.4.0 | 
| License | Apache License 2.0 | 
| Build type | AMENT_CMAKE | 
| Use | RECOMMENDED | 
Repository Summary
| Checkout URI | https://github.com/autowarefoundation/autoware_core.git | 
| VCS Type | git | 
| VCS Version | main | 
| Last Updated | 2025-10-31 | 
| Dev Status | DEVELOPED | 
| Released | RELEASED | 
| Contributing | 
        
          Help Wanted (-)
        
         Good First Issues (-) Pull Requests to Review (-)  | 
    
Package Description
Maintainers
- amc-nu
 - Yukihiro Saito
 - Kyoichi Sugahara
 - Dai Nguyen
 - Kenzo Lobos-Tsunekawa
 - Yihsiang Fang
 - Yoshi Ri
 - David Wong
 - Melike Tanrikulu
 - Max Schmeller
 - Xingang Liu
 
Authors
autoware_crop_box_filter
Overview
The autoware_crop_box_filter is a package that crops the input pointcloud to a specified bounding box. This is useful for reducing the computational load and improving the performance of the system.
Design
The autoware_crop_box_filter is implemented as a autoware core node that subscribes to the input pointcloud, and publishes the filtered pointcloud. The bounding box is specified using the min_point and max_point parameters.
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
~/crop_box_polygon | 
      geometry_msgs::msg::PolygonStamped | 
      bounding box polygon | 
Parameters
Launch file Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | the frame id in which filtering is performed | 
output_frame | 
      string | ” “ | output frame id of the filtered points | 
input_pointcloud_frame | 
      string | ” “ | frame id of input pointcloud | 
max_queue_size | 
      int | 5 | max buffer size of input/output topics | 
crop_box_filter_param_file | 
      string | ” “ | path to the parameter file for the node | 
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
min_x | 
      double | -5.0 | minimum x value of the crop box | 
min_y | 
      double | -5.0 | minimum y value of the crop box | 
min_z | 
      double | -5.0 | minimum z value of the crop box | 
max_x | 
      double | 5.0 | maximum x value of the crop box | 
max_y | 
      double | 5.0 | maximum y value of the crop box | 
max_z | 
      double | 5.0 | maximum z value of the crop box | 
negative | 
      bool | true | if true, points inside the box are removed, otherwise points outside the box are removed | 
Usage
1.publish static tf from input pointcloud to target frame that is used for filtering
ros2 run tf2_ros static_transform_publisher 2.0 3.2 1.3 0 0 0 1  velodyne_top_base_link  base_link
2.launch node
ros2 launch autoware_crop_box_filter crop_box_filter_node.launch.xml
3. launch rviz2 and AWSIM
Changelog for package autoware_crop_box_filter
1.1.0 (2025-05-01)
- 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko
 
1.4.0 (2025-08-11)
- chore: bump version to 1.3.0 (#554)
 - Contributors: Ryohsuke Mitsudome
 
1.3.0 (2025-06-23)
- 
    
fix: to be consistent version in all package.xml(s)
 - 
    
fix(autoware_crop_box_filter): fix deprecated autoware_utils header (#418)
- fix autoware_utils header
 
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko, Masaki Baba, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- chore: update version in package.xml
 - feat(autoware_crop_box_filter): reimplementation in core repo (#279) Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - Contributors: Ryohsuke Mitsudome, 心刚
 
Package Dependencies
System Dependencies
Dependant Packages
Launch files
- launch/crop_box_filter_node.launch.xml
                
- 
                    
- input_topic_name [default: /sensing/lidar/top/pointcloud_raw_ex]
 - output_topic_name [default: /sensing/lidar/top/self_cropped/pointcloud_ex]
 - input_frame [default: base_link]
 - output_frame [default: base_link]
 - input_pointcloud_frame [default: velodyne_top_base_link]
 - crop_box_filter_param_file [default: $(find-pkg-share autoware_crop_box_filter)/config/crop_box_filter_node.param.yaml]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_crop_box_filter at Robotics Stack Exchange
Package Summary
| Version | 1.4.0 | 
| License | Apache License 2.0 | 
| Build type | AMENT_CMAKE | 
| Use | RECOMMENDED | 
Repository Summary
| Checkout URI | https://github.com/autowarefoundation/autoware_core.git | 
| VCS Type | git | 
| VCS Version | main | 
| Last Updated | 2025-10-31 | 
| Dev Status | DEVELOPED | 
| Released | RELEASED | 
| Contributing | 
        
          Help Wanted (-)
        
         Good First Issues (-) Pull Requests to Review (-)  | 
    
Package Description
Maintainers
- amc-nu
 - Yukihiro Saito
 - Kyoichi Sugahara
 - Dai Nguyen
 - Kenzo Lobos-Tsunekawa
 - Yihsiang Fang
 - Yoshi Ri
 - David Wong
 - Melike Tanrikulu
 - Max Schmeller
 - Xingang Liu
 
Authors
autoware_crop_box_filter
Overview
The autoware_crop_box_filter is a package that crops the input pointcloud to a specified bounding box. This is useful for reducing the computational load and improving the performance of the system.
Design
The autoware_crop_box_filter is implemented as a autoware core node that subscribes to the input pointcloud, and publishes the filtered pointcloud. The bounding box is specified using the min_point and max_point parameters.
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
~/crop_box_polygon | 
      geometry_msgs::msg::PolygonStamped | 
      bounding box polygon | 
Parameters
Launch file Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | the frame id in which filtering is performed | 
output_frame | 
      string | ” “ | output frame id of the filtered points | 
input_pointcloud_frame | 
      string | ” “ | frame id of input pointcloud | 
max_queue_size | 
      int | 5 | max buffer size of input/output topics | 
crop_box_filter_param_file | 
      string | ” “ | path to the parameter file for the node | 
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
min_x | 
      double | -5.0 | minimum x value of the crop box | 
min_y | 
      double | -5.0 | minimum y value of the crop box | 
min_z | 
      double | -5.0 | minimum z value of the crop box | 
max_x | 
      double | 5.0 | maximum x value of the crop box | 
max_y | 
      double | 5.0 | maximum y value of the crop box | 
max_z | 
      double | 5.0 | maximum z value of the crop box | 
negative | 
      bool | true | if true, points inside the box are removed, otherwise points outside the box are removed | 
Usage
1.publish static tf from input pointcloud to target frame that is used for filtering
ros2 run tf2_ros static_transform_publisher 2.0 3.2 1.3 0 0 0 1  velodyne_top_base_link  base_link
2.launch node
ros2 launch autoware_crop_box_filter crop_box_filter_node.launch.xml
3. launch rviz2 and AWSIM
Changelog for package autoware_crop_box_filter
1.1.0 (2025-05-01)
- 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko
 
1.4.0 (2025-08-11)
- chore: bump version to 1.3.0 (#554)
 - Contributors: Ryohsuke Mitsudome
 
1.3.0 (2025-06-23)
- 
    
fix: to be consistent version in all package.xml(s)
 - 
    
fix(autoware_crop_box_filter): fix deprecated autoware_utils header (#418)
- fix autoware_utils header
 
* style(pre-commit): autofix ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
feat(autoware_utils): remove managed transform buffer (#360)
- feat(autoware_utils): remove managed transform buffer
 
* fix(autoware_ground_filter): redundant inclusion ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
Contributors: Amadeusz Szymko, Masaki Baba, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- chore: update version in package.xml
 - feat(autoware_crop_box_filter): reimplementation in core repo (#279) Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - Contributors: Ryohsuke Mitsudome, 心刚
 
Package Dependencies
System Dependencies
Dependant Packages
Launch files
- launch/crop_box_filter_node.launch.xml
                
- 
                    
- input_topic_name [default: /sensing/lidar/top/pointcloud_raw_ex]
 - output_topic_name [default: /sensing/lidar/top/self_cropped/pointcloud_ex]
 - input_frame [default: base_link]
 - output_frame [default: base_link]
 - input_pointcloud_frame [default: velodyne_top_base_link]
 - crop_box_filter_param_file [default: $(find-pkg-share autoware_crop_box_filter)/config/crop_box_filter_node.param.yaml]