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
 - Dai Nguyen
 - Yoshi Ri
 - Junya Sasaki
 
Authors
- Open Perception
 - Julius Kammerl
 - William Woodall
 
autoware_ground_filter
Purpose
The autoware_ground_filter is a node that remove the ground points from the input pointcloud.
Inner-workings / Algorithms
Detail description of each ground segmentation algorithm is in the following links.
| Filter Name | Description | Detail | 
|---|---|---|
| ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link | 
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
~/input/indices | 
      pcl_msgs::msg::Indices | 
      reference indices | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
Parameters
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | input frame id | 
output_frame | 
      string | ” “ | output frame id | 
max_queue_size | 
      int | 5 | max queue size of input/output topics | 
use_indices | 
      bool | false | flag to use pointcloud indices | 
latched_indices | 
      bool | false | flag to latch pointcloud indices | 
approximate_sync | 
      bool | false | flag to use approximate sync option | 
Assumptions / Known limits
Implemented based on pcl_perception [1] because of this issue.
References/External links
[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp
Changelog for package autoware_ground_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: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
 
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
 - 
    
fix: deprecation of .h files in message_filters (#467)
- fix: deprecation of .h files in message_filters
 
* Update perception/autoware_ground_filter/include/autoware/ground_filter/node.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>> ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
fix(autoware_ground_filter): fix deprecated autoware_utils header (#417)
- fix autoware_utils header
 - style(pre-commit): autofix
 
* fix autoware_utils packages ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Junya Sasaki <<j2sasaki1990@gmail.com>>
 - 
    
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, Tim Clephas, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- 
    
chore: update version in package.xml
 - 
    
feat: re-implementation autoware_ground_filter as alpha quality from universe (#311)
* add: [scan_ground_filter]{.title-ref} from Autoware Universe Source: Files copied from [Autoware Universe](https://github.com/autowarefoundation/autoware_universe/tree/b8ce82e3759e50f780a0941ca8698ff52aa57b97/perception/autoware_ground_segmentation). Scope: Integrated [scan_ground_filter]{.title-ref} into [autoware.core]{.title-ref}. Dependency Changes: Removed dependencies on [autoware_pointcloud_preprocessor]{.title-ref} to ensure compatibility within [autoware.core]{.title-ref}. Purpose: Focus on making [scan_ground_filter]{.title-ref} functional within the [autoware.core]{.title-ref} environment. 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>>
 - 
    
Contributors: Junya Sasaki, Ryohsuke Mitsudome
 
Package Dependencies
System Dependencies
Dependant Packages
| Name | Deps | 
|---|---|
| autoware_core_perception | 
Launch files
- launch/ground_filter.launch.xml
                
- 
                    
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_filter)/config/ground_filter.param.yaml]
 - vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]
 - input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
 - output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_ground_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
 - Dai Nguyen
 - Yoshi Ri
 - Junya Sasaki
 
Authors
- Open Perception
 - Julius Kammerl
 - William Woodall
 
autoware_ground_filter
Purpose
The autoware_ground_filter is a node that remove the ground points from the input pointcloud.
Inner-workings / Algorithms
Detail description of each ground segmentation algorithm is in the following links.
| Filter Name | Description | Detail | 
|---|---|---|
| ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link | 
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
~/input/indices | 
      pcl_msgs::msg::Indices | 
      reference indices | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
Parameters
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | input frame id | 
output_frame | 
      string | ” “ | output frame id | 
max_queue_size | 
      int | 5 | max queue size of input/output topics | 
use_indices | 
      bool | false | flag to use pointcloud indices | 
latched_indices | 
      bool | false | flag to latch pointcloud indices | 
approximate_sync | 
      bool | false | flag to use approximate sync option | 
Assumptions / Known limits
Implemented based on pcl_perception [1] because of this issue.
References/External links
[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp
Changelog for package autoware_ground_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: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
 
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
 - 
    
fix: deprecation of .h files in message_filters (#467)
- fix: deprecation of .h files in message_filters
 
* Update perception/autoware_ground_filter/include/autoware/ground_filter/node.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>> ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
fix(autoware_ground_filter): fix deprecated autoware_utils header (#417)
- fix autoware_utils header
 - style(pre-commit): autofix
 
* fix autoware_utils packages ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Junya Sasaki <<j2sasaki1990@gmail.com>>
 - 
    
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, Tim Clephas, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- 
    
chore: update version in package.xml
 - 
    
feat: re-implementation autoware_ground_filter as alpha quality from universe (#311)
* add: [scan_ground_filter]{.title-ref} from Autoware Universe Source: Files copied from [Autoware Universe](https://github.com/autowarefoundation/autoware_universe/tree/b8ce82e3759e50f780a0941ca8698ff52aa57b97/perception/autoware_ground_segmentation). Scope: Integrated [scan_ground_filter]{.title-ref} into [autoware.core]{.title-ref}. Dependency Changes: Removed dependencies on [autoware_pointcloud_preprocessor]{.title-ref} to ensure compatibility within [autoware.core]{.title-ref}. Purpose: Focus on making [scan_ground_filter]{.title-ref} functional within the [autoware.core]{.title-ref} environment. 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>>
 - 
    
Contributors: Junya Sasaki, Ryohsuke Mitsudome
 
Package Dependencies
System Dependencies
Dependant Packages
| Name | Deps | 
|---|---|
| autoware_core_perception | 
Launch files
- launch/ground_filter.launch.xml
                
- 
                    
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_filter)/config/ground_filter.param.yaml]
 - vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]
 - input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
 - output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_ground_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
 - Dai Nguyen
 - Yoshi Ri
 - Junya Sasaki
 
Authors
- Open Perception
 - Julius Kammerl
 - William Woodall
 
autoware_ground_filter
Purpose
The autoware_ground_filter is a node that remove the ground points from the input pointcloud.
Inner-workings / Algorithms
Detail description of each ground segmentation algorithm is in the following links.
| Filter Name | Description | Detail | 
|---|---|---|
| ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link | 
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
~/input/indices | 
      pcl_msgs::msg::Indices | 
      reference indices | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
Parameters
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | input frame id | 
output_frame | 
      string | ” “ | output frame id | 
max_queue_size | 
      int | 5 | max queue size of input/output topics | 
use_indices | 
      bool | false | flag to use pointcloud indices | 
latched_indices | 
      bool | false | flag to latch pointcloud indices | 
approximate_sync | 
      bool | false | flag to use approximate sync option | 
Assumptions / Known limits
Implemented based on pcl_perception [1] because of this issue.
References/External links
[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp
Changelog for package autoware_ground_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: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
 
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
 - 
    
fix: deprecation of .h files in message_filters (#467)
- fix: deprecation of .h files in message_filters
 
* Update perception/autoware_ground_filter/include/autoware/ground_filter/node.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>> ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
fix(autoware_ground_filter): fix deprecated autoware_utils header (#417)
- fix autoware_utils header
 - style(pre-commit): autofix
 
* fix autoware_utils packages ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Junya Sasaki <<j2sasaki1990@gmail.com>>
 - 
    
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, Tim Clephas, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- 
    
chore: update version in package.xml
 - 
    
feat: re-implementation autoware_ground_filter as alpha quality from universe (#311)
* add: [scan_ground_filter]{.title-ref} from Autoware Universe Source: Files copied from [Autoware Universe](https://github.com/autowarefoundation/autoware_universe/tree/b8ce82e3759e50f780a0941ca8698ff52aa57b97/perception/autoware_ground_segmentation). Scope: Integrated [scan_ground_filter]{.title-ref} into [autoware.core]{.title-ref}. Dependency Changes: Removed dependencies on [autoware_pointcloud_preprocessor]{.title-ref} to ensure compatibility within [autoware.core]{.title-ref}. Purpose: Focus on making [scan_ground_filter]{.title-ref} functional within the [autoware.core]{.title-ref} environment. 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>>
 - 
    
Contributors: Junya Sasaki, Ryohsuke Mitsudome
 
Package Dependencies
System Dependencies
Dependant Packages
| Name | Deps | 
|---|---|
| autoware_core_perception | 
Launch files
- launch/ground_filter.launch.xml
                
- 
                    
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_filter)/config/ground_filter.param.yaml]
 - vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]
 - input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
 - output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_ground_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
 - Dai Nguyen
 - Yoshi Ri
 - Junya Sasaki
 
Authors
- Open Perception
 - Julius Kammerl
 - William Woodall
 
autoware_ground_filter
Purpose
The autoware_ground_filter is a node that remove the ground points from the input pointcloud.
Inner-workings / Algorithms
Detail description of each ground segmentation algorithm is in the following links.
| Filter Name | Description | Detail | 
|---|---|---|
| ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link | 
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
~/input/indices | 
      pcl_msgs::msg::Indices | 
      reference indices | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
Parameters
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | input frame id | 
output_frame | 
      string | ” “ | output frame id | 
max_queue_size | 
      int | 5 | max queue size of input/output topics | 
use_indices | 
      bool | false | flag to use pointcloud indices | 
latched_indices | 
      bool | false | flag to latch pointcloud indices | 
approximate_sync | 
      bool | false | flag to use approximate sync option | 
Assumptions / Known limits
Implemented based on pcl_perception [1] because of this issue.
References/External links
[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp
Changelog for package autoware_ground_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: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
 
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
 - 
    
fix: deprecation of .h files in message_filters (#467)
- fix: deprecation of .h files in message_filters
 
* Update perception/autoware_ground_filter/include/autoware/ground_filter/node.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>> ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
fix(autoware_ground_filter): fix deprecated autoware_utils header (#417)
- fix autoware_utils header
 - style(pre-commit): autofix
 
* fix autoware_utils packages ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Junya Sasaki <<j2sasaki1990@gmail.com>>
 - 
    
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, Tim Clephas, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- 
    
chore: update version in package.xml
 - 
    
feat: re-implementation autoware_ground_filter as alpha quality from universe (#311)
* add: [scan_ground_filter]{.title-ref} from Autoware Universe Source: Files copied from [Autoware Universe](https://github.com/autowarefoundation/autoware_universe/tree/b8ce82e3759e50f780a0941ca8698ff52aa57b97/perception/autoware_ground_segmentation). Scope: Integrated [scan_ground_filter]{.title-ref} into [autoware.core]{.title-ref}. Dependency Changes: Removed dependencies on [autoware_pointcloud_preprocessor]{.title-ref} to ensure compatibility within [autoware.core]{.title-ref}. Purpose: Focus on making [scan_ground_filter]{.title-ref} functional within the [autoware.core]{.title-ref} environment. 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>>
 - 
    
Contributors: Junya Sasaki, Ryohsuke Mitsudome
 
Package Dependencies
System Dependencies
Dependant Packages
| Name | Deps | 
|---|---|
| autoware_core_perception | 
Launch files
- launch/ground_filter.launch.xml
                
- 
                    
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_filter)/config/ground_filter.param.yaml]
 - vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]
 - input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
 - output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_ground_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
 - Dai Nguyen
 - Yoshi Ri
 - Junya Sasaki
 
Authors
- Open Perception
 - Julius Kammerl
 - William Woodall
 
autoware_ground_filter
Purpose
The autoware_ground_filter is a node that remove the ground points from the input pointcloud.
Inner-workings / Algorithms
Detail description of each ground segmentation algorithm is in the following links.
| Filter Name | Description | Detail | 
|---|---|---|
| ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link | 
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
~/input/indices | 
      pcl_msgs::msg::Indices | 
      reference indices | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
Parameters
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | input frame id | 
output_frame | 
      string | ” “ | output frame id | 
max_queue_size | 
      int | 5 | max queue size of input/output topics | 
use_indices | 
      bool | false | flag to use pointcloud indices | 
latched_indices | 
      bool | false | flag to latch pointcloud indices | 
approximate_sync | 
      bool | false | flag to use approximate sync option | 
Assumptions / Known limits
Implemented based on pcl_perception [1] because of this issue.
References/External links
[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp
Changelog for package autoware_ground_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: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
 
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
 - 
    
fix: deprecation of .h files in message_filters (#467)
- fix: deprecation of .h files in message_filters
 
* Update perception/autoware_ground_filter/include/autoware/ground_filter/node.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>> ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
fix(autoware_ground_filter): fix deprecated autoware_utils header (#417)
- fix autoware_utils header
 - style(pre-commit): autofix
 
* fix autoware_utils packages ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Junya Sasaki <<j2sasaki1990@gmail.com>>
 - 
    
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, Tim Clephas, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- 
    
chore: update version in package.xml
 - 
    
feat: re-implementation autoware_ground_filter as alpha quality from universe (#311)
* add: [scan_ground_filter]{.title-ref} from Autoware Universe Source: Files copied from [Autoware Universe](https://github.com/autowarefoundation/autoware_universe/tree/b8ce82e3759e50f780a0941ca8698ff52aa57b97/perception/autoware_ground_segmentation). Scope: Integrated [scan_ground_filter]{.title-ref} into [autoware.core]{.title-ref}. Dependency Changes: Removed dependencies on [autoware_pointcloud_preprocessor]{.title-ref} to ensure compatibility within [autoware.core]{.title-ref}. Purpose: Focus on making [scan_ground_filter]{.title-ref} functional within the [autoware.core]{.title-ref} environment. 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>>
 - 
    
Contributors: Junya Sasaki, Ryohsuke Mitsudome
 
Package Dependencies
System Dependencies
Dependant Packages
| Name | Deps | 
|---|---|
| autoware_core_perception | 
Launch files
- launch/ground_filter.launch.xml
                
- 
                    
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_filter)/config/ground_filter.param.yaml]
 - vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]
 - input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
 - output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_ground_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
 - Dai Nguyen
 - Yoshi Ri
 - Junya Sasaki
 
Authors
- Open Perception
 - Julius Kammerl
 - William Woodall
 
autoware_ground_filter
Purpose
The autoware_ground_filter is a node that remove the ground points from the input pointcloud.
Inner-workings / Algorithms
Detail description of each ground segmentation algorithm is in the following links.
| Filter Name | Description | Detail | 
|---|---|---|
| ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link | 
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
~/input/indices | 
      pcl_msgs::msg::Indices | 
      reference indices | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
Parameters
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | input frame id | 
output_frame | 
      string | ” “ | output frame id | 
max_queue_size | 
      int | 5 | max queue size of input/output topics | 
use_indices | 
      bool | false | flag to use pointcloud indices | 
latched_indices | 
      bool | false | flag to latch pointcloud indices | 
approximate_sync | 
      bool | false | flag to use approximate sync option | 
Assumptions / Known limits
Implemented based on pcl_perception [1] because of this issue.
References/External links
[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp
Changelog for package autoware_ground_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: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
 
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
 - 
    
fix: deprecation of .h files in message_filters (#467)
- fix: deprecation of .h files in message_filters
 
* Update perception/autoware_ground_filter/include/autoware/ground_filter/node.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>> ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
fix(autoware_ground_filter): fix deprecated autoware_utils header (#417)
- fix autoware_utils header
 - style(pre-commit): autofix
 
* fix autoware_utils packages ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Junya Sasaki <<j2sasaki1990@gmail.com>>
 - 
    
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, Tim Clephas, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- 
    
chore: update version in package.xml
 - 
    
feat: re-implementation autoware_ground_filter as alpha quality from universe (#311)
* add: [scan_ground_filter]{.title-ref} from Autoware Universe Source: Files copied from [Autoware Universe](https://github.com/autowarefoundation/autoware_universe/tree/b8ce82e3759e50f780a0941ca8698ff52aa57b97/perception/autoware_ground_segmentation). Scope: Integrated [scan_ground_filter]{.title-ref} into [autoware.core]{.title-ref}. Dependency Changes: Removed dependencies on [autoware_pointcloud_preprocessor]{.title-ref} to ensure compatibility within [autoware.core]{.title-ref}. Purpose: Focus on making [scan_ground_filter]{.title-ref} functional within the [autoware.core]{.title-ref} environment. 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>>
 - 
    
Contributors: Junya Sasaki, Ryohsuke Mitsudome
 
Package Dependencies
System Dependencies
Dependant Packages
| Name | Deps | 
|---|---|
| autoware_core_perception | 
Launch files
- launch/ground_filter.launch.xml
                
- 
                    
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_filter)/config/ground_filter.param.yaml]
 - vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]
 - input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
 - output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_ground_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
 - Dai Nguyen
 - Yoshi Ri
 - Junya Sasaki
 
Authors
- Open Perception
 - Julius Kammerl
 - William Woodall
 
autoware_ground_filter
Purpose
The autoware_ground_filter is a node that remove the ground points from the input pointcloud.
Inner-workings / Algorithms
Detail description of each ground segmentation algorithm is in the following links.
| Filter Name | Description | Detail | 
|---|---|---|
| ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link | 
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
~/input/indices | 
      pcl_msgs::msg::Indices | 
      reference indices | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
Parameters
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | input frame id | 
output_frame | 
      string | ” “ | output frame id | 
max_queue_size | 
      int | 5 | max queue size of input/output topics | 
use_indices | 
      bool | false | flag to use pointcloud indices | 
latched_indices | 
      bool | false | flag to latch pointcloud indices | 
approximate_sync | 
      bool | false | flag to use approximate sync option | 
Assumptions / Known limits
Implemented based on pcl_perception [1] because of this issue.
References/External links
[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp
Changelog for package autoware_ground_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: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
 
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
 - 
    
fix: deprecation of .h files in message_filters (#467)
- fix: deprecation of .h files in message_filters
 
* Update perception/autoware_ground_filter/include/autoware/ground_filter/node.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>> ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
fix(autoware_ground_filter): fix deprecated autoware_utils header (#417)
- fix autoware_utils header
 - style(pre-commit): autofix
 
* fix autoware_utils packages ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Junya Sasaki <<j2sasaki1990@gmail.com>>
 - 
    
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, Tim Clephas, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- 
    
chore: update version in package.xml
 - 
    
feat: re-implementation autoware_ground_filter as alpha quality from universe (#311)
* add: [scan_ground_filter]{.title-ref} from Autoware Universe Source: Files copied from [Autoware Universe](https://github.com/autowarefoundation/autoware_universe/tree/b8ce82e3759e50f780a0941ca8698ff52aa57b97/perception/autoware_ground_segmentation). Scope: Integrated [scan_ground_filter]{.title-ref} into [autoware.core]{.title-ref}. Dependency Changes: Removed dependencies on [autoware_pointcloud_preprocessor]{.title-ref} to ensure compatibility within [autoware.core]{.title-ref}. Purpose: Focus on making [scan_ground_filter]{.title-ref} functional within the [autoware.core]{.title-ref} environment. 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>>
 - 
    
Contributors: Junya Sasaki, Ryohsuke Mitsudome
 
Package Dependencies
System Dependencies
Dependant Packages
| Name | Deps | 
|---|---|
| autoware_core_perception | 
Launch files
- launch/ground_filter.launch.xml
                
- 
                    
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_filter)/config/ground_filter.param.yaml]
 - vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]
 - input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
 - output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_ground_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
 - Dai Nguyen
 - Yoshi Ri
 - Junya Sasaki
 
Authors
- Open Perception
 - Julius Kammerl
 - William Woodall
 
autoware_ground_filter
Purpose
The autoware_ground_filter is a node that remove the ground points from the input pointcloud.
Inner-workings / Algorithms
Detail description of each ground segmentation algorithm is in the following links.
| Filter Name | Description | Detail | 
|---|---|---|
| ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link | 
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
~/input/indices | 
      pcl_msgs::msg::Indices | 
      reference indices | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
Parameters
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | input frame id | 
output_frame | 
      string | ” “ | output frame id | 
max_queue_size | 
      int | 5 | max queue size of input/output topics | 
use_indices | 
      bool | false | flag to use pointcloud indices | 
latched_indices | 
      bool | false | flag to latch pointcloud indices | 
approximate_sync | 
      bool | false | flag to use approximate sync option | 
Assumptions / Known limits
Implemented based on pcl_perception [1] because of this issue.
References/External links
[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp
Changelog for package autoware_ground_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: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
 
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
 - 
    
fix: deprecation of .h files in message_filters (#467)
- fix: deprecation of .h files in message_filters
 
* Update perception/autoware_ground_filter/include/autoware/ground_filter/node.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>> ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
fix(autoware_ground_filter): fix deprecated autoware_utils header (#417)
- fix autoware_utils header
 - style(pre-commit): autofix
 
* fix autoware_utils packages ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Junya Sasaki <<j2sasaki1990@gmail.com>>
 - 
    
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, Tim Clephas, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- 
    
chore: update version in package.xml
 - 
    
feat: re-implementation autoware_ground_filter as alpha quality from universe (#311)
* add: [scan_ground_filter]{.title-ref} from Autoware Universe Source: Files copied from [Autoware Universe](https://github.com/autowarefoundation/autoware_universe/tree/b8ce82e3759e50f780a0941ca8698ff52aa57b97/perception/autoware_ground_segmentation). Scope: Integrated [scan_ground_filter]{.title-ref} into [autoware.core]{.title-ref}. Dependency Changes: Removed dependencies on [autoware_pointcloud_preprocessor]{.title-ref} to ensure compatibility within [autoware.core]{.title-ref}. Purpose: Focus on making [scan_ground_filter]{.title-ref} functional within the [autoware.core]{.title-ref} environment. 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>>
 - 
    
Contributors: Junya Sasaki, Ryohsuke Mitsudome
 
Package Dependencies
System Dependencies
Dependant Packages
| Name | Deps | 
|---|---|
| autoware_core_perception | 
Launch files
- launch/ground_filter.launch.xml
                
- 
                    
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_filter)/config/ground_filter.param.yaml]
 - vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]
 - input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
 - output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_ground_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
 - Dai Nguyen
 - Yoshi Ri
 - Junya Sasaki
 
Authors
- Open Perception
 - Julius Kammerl
 - William Woodall
 
autoware_ground_filter
Purpose
The autoware_ground_filter is a node that remove the ground points from the input pointcloud.
Inner-workings / Algorithms
Detail description of each ground segmentation algorithm is in the following links.
| Filter Name | Description | Detail | 
|---|---|---|
| ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link | 
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
~/input/indices | 
      pcl_msgs::msg::Indices | 
      reference indices | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
Parameters
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | input frame id | 
output_frame | 
      string | ” “ | output frame id | 
max_queue_size | 
      int | 5 | max queue size of input/output topics | 
use_indices | 
      bool | false | flag to use pointcloud indices | 
latched_indices | 
      bool | false | flag to latch pointcloud indices | 
approximate_sync | 
      bool | false | flag to use approximate sync option | 
Assumptions / Known limits
Implemented based on pcl_perception [1] because of this issue.
References/External links
[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp
Changelog for package autoware_ground_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: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
 
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
 - 
    
fix: deprecation of .h files in message_filters (#467)
- fix: deprecation of .h files in message_filters
 
* Update perception/autoware_ground_filter/include/autoware/ground_filter/node.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>> ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
fix(autoware_ground_filter): fix deprecated autoware_utils header (#417)
- fix autoware_utils header
 - style(pre-commit): autofix
 
* fix autoware_utils packages ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Junya Sasaki <<j2sasaki1990@gmail.com>>
 - 
    
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, Tim Clephas, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- 
    
chore: update version in package.xml
 - 
    
feat: re-implementation autoware_ground_filter as alpha quality from universe (#311)
* add: [scan_ground_filter]{.title-ref} from Autoware Universe Source: Files copied from [Autoware Universe](https://github.com/autowarefoundation/autoware_universe/tree/b8ce82e3759e50f780a0941ca8698ff52aa57b97/perception/autoware_ground_segmentation). Scope: Integrated [scan_ground_filter]{.title-ref} into [autoware.core]{.title-ref}. Dependency Changes: Removed dependencies on [autoware_pointcloud_preprocessor]{.title-ref} to ensure compatibility within [autoware.core]{.title-ref}. Purpose: Focus on making [scan_ground_filter]{.title-ref} functional within the [autoware.core]{.title-ref} environment. 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>>
 - 
    
Contributors: Junya Sasaki, Ryohsuke Mitsudome
 
Package Dependencies
System Dependencies
Dependant Packages
| Name | Deps | 
|---|---|
| autoware_core_perception | 
Launch files
- launch/ground_filter.launch.xml
                
- 
                    
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_filter)/config/ground_filter.param.yaml]
 - vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]
 - input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
 - output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_ground_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
 - Dai Nguyen
 - Yoshi Ri
 - Junya Sasaki
 
Authors
- Open Perception
 - Julius Kammerl
 - William Woodall
 
autoware_ground_filter
Purpose
The autoware_ground_filter is a node that remove the ground points from the input pointcloud.
Inner-workings / Algorithms
Detail description of each ground segmentation algorithm is in the following links.
| Filter Name | Description | Detail | 
|---|---|---|
| ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link | 
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
~/input/indices | 
      pcl_msgs::msg::Indices | 
      reference indices | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
Parameters
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | input frame id | 
output_frame | 
      string | ” “ | output frame id | 
max_queue_size | 
      int | 5 | max queue size of input/output topics | 
use_indices | 
      bool | false | flag to use pointcloud indices | 
latched_indices | 
      bool | false | flag to latch pointcloud indices | 
approximate_sync | 
      bool | false | flag to use approximate sync option | 
Assumptions / Known limits
Implemented based on pcl_perception [1] because of this issue.
References/External links
[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp
Changelog for package autoware_ground_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: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
 
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
 - 
    
fix: deprecation of .h files in message_filters (#467)
- fix: deprecation of .h files in message_filters
 
* Update perception/autoware_ground_filter/include/autoware/ground_filter/node.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>> ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
fix(autoware_ground_filter): fix deprecated autoware_utils header (#417)
- fix autoware_utils header
 - style(pre-commit): autofix
 
* fix autoware_utils packages ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Junya Sasaki <<j2sasaki1990@gmail.com>>
 - 
    
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, Tim Clephas, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- 
    
chore: update version in package.xml
 - 
    
feat: re-implementation autoware_ground_filter as alpha quality from universe (#311)
* add: [scan_ground_filter]{.title-ref} from Autoware Universe Source: Files copied from [Autoware Universe](https://github.com/autowarefoundation/autoware_universe/tree/b8ce82e3759e50f780a0941ca8698ff52aa57b97/perception/autoware_ground_segmentation). Scope: Integrated [scan_ground_filter]{.title-ref} into [autoware.core]{.title-ref}. Dependency Changes: Removed dependencies on [autoware_pointcloud_preprocessor]{.title-ref} to ensure compatibility within [autoware.core]{.title-ref}. Purpose: Focus on making [scan_ground_filter]{.title-ref} functional within the [autoware.core]{.title-ref} environment. 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>>
 - 
    
Contributors: Junya Sasaki, Ryohsuke Mitsudome
 
Package Dependencies
System Dependencies
Dependant Packages
| Name | Deps | 
|---|---|
| autoware_core_perception | 
Launch files
- launch/ground_filter.launch.xml
                
- 
                    
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_filter)/config/ground_filter.param.yaml]
 - vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]
 - input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
 - output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_ground_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
 - Dai Nguyen
 - Yoshi Ri
 - Junya Sasaki
 
Authors
- Open Perception
 - Julius Kammerl
 - William Woodall
 
autoware_ground_filter
Purpose
The autoware_ground_filter is a node that remove the ground points from the input pointcloud.
Inner-workings / Algorithms
Detail description of each ground segmentation algorithm is in the following links.
| Filter Name | Description | Detail | 
|---|---|---|
| ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link | 
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
~/input/indices | 
      pcl_msgs::msg::Indices | 
      reference indices | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
Parameters
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | input frame id | 
output_frame | 
      string | ” “ | output frame id | 
max_queue_size | 
      int | 5 | max queue size of input/output topics | 
use_indices | 
      bool | false | flag to use pointcloud indices | 
latched_indices | 
      bool | false | flag to latch pointcloud indices | 
approximate_sync | 
      bool | false | flag to use approximate sync option | 
Assumptions / Known limits
Implemented based on pcl_perception [1] because of this issue.
References/External links
[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp
Changelog for package autoware_ground_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: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
 
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
 - 
    
fix: deprecation of .h files in message_filters (#467)
- fix: deprecation of .h files in message_filters
 
* Update perception/autoware_ground_filter/include/autoware/ground_filter/node.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>> ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
fix(autoware_ground_filter): fix deprecated autoware_utils header (#417)
- fix autoware_utils header
 - style(pre-commit): autofix
 
* fix autoware_utils packages ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Junya Sasaki <<j2sasaki1990@gmail.com>>
 - 
    
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, Tim Clephas, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- 
    
chore: update version in package.xml
 - 
    
feat: re-implementation autoware_ground_filter as alpha quality from universe (#311)
* add: [scan_ground_filter]{.title-ref} from Autoware Universe Source: Files copied from [Autoware Universe](https://github.com/autowarefoundation/autoware_universe/tree/b8ce82e3759e50f780a0941ca8698ff52aa57b97/perception/autoware_ground_segmentation). Scope: Integrated [scan_ground_filter]{.title-ref} into [autoware.core]{.title-ref}. Dependency Changes: Removed dependencies on [autoware_pointcloud_preprocessor]{.title-ref} to ensure compatibility within [autoware.core]{.title-ref}. Purpose: Focus on making [scan_ground_filter]{.title-ref} functional within the [autoware.core]{.title-ref} environment. 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>>
 - 
    
Contributors: Junya Sasaki, Ryohsuke Mitsudome
 
Package Dependencies
System Dependencies
Dependant Packages
| Name | Deps | 
|---|---|
| autoware_core_perception | 
Launch files
- launch/ground_filter.launch.xml
                
- 
                    
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_filter)/config/ground_filter.param.yaml]
 - vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]
 - input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
 - output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_ground_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
 - Dai Nguyen
 - Yoshi Ri
 - Junya Sasaki
 
Authors
- Open Perception
 - Julius Kammerl
 - William Woodall
 
autoware_ground_filter
Purpose
The autoware_ground_filter is a node that remove the ground points from the input pointcloud.
Inner-workings / Algorithms
Detail description of each ground segmentation algorithm is in the following links.
| Filter Name | Description | Detail | 
|---|---|---|
| ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link | 
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
~/input/indices | 
      pcl_msgs::msg::Indices | 
      reference indices | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
Parameters
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | input frame id | 
output_frame | 
      string | ” “ | output frame id | 
max_queue_size | 
      int | 5 | max queue size of input/output topics | 
use_indices | 
      bool | false | flag to use pointcloud indices | 
latched_indices | 
      bool | false | flag to latch pointcloud indices | 
approximate_sync | 
      bool | false | flag to use approximate sync option | 
Assumptions / Known limits
Implemented based on pcl_perception [1] because of this issue.
References/External links
[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp
Changelog for package autoware_ground_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: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
 
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
 - 
    
fix: deprecation of .h files in message_filters (#467)
- fix: deprecation of .h files in message_filters
 
* Update perception/autoware_ground_filter/include/autoware/ground_filter/node.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>> ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
fix(autoware_ground_filter): fix deprecated autoware_utils header (#417)
- fix autoware_utils header
 - style(pre-commit): autofix
 
* fix autoware_utils packages ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Junya Sasaki <<j2sasaki1990@gmail.com>>
 - 
    
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, Tim Clephas, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- 
    
chore: update version in package.xml
 - 
    
feat: re-implementation autoware_ground_filter as alpha quality from universe (#311)
* add: [scan_ground_filter]{.title-ref} from Autoware Universe Source: Files copied from [Autoware Universe](https://github.com/autowarefoundation/autoware_universe/tree/b8ce82e3759e50f780a0941ca8698ff52aa57b97/perception/autoware_ground_segmentation). Scope: Integrated [scan_ground_filter]{.title-ref} into [autoware.core]{.title-ref}. Dependency Changes: Removed dependencies on [autoware_pointcloud_preprocessor]{.title-ref} to ensure compatibility within [autoware.core]{.title-ref}. Purpose: Focus on making [scan_ground_filter]{.title-ref} functional within the [autoware.core]{.title-ref} environment. 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>>
 - 
    
Contributors: Junya Sasaki, Ryohsuke Mitsudome
 
Package Dependencies
System Dependencies
Dependant Packages
| Name | Deps | 
|---|---|
| autoware_core_perception | 
Launch files
- launch/ground_filter.launch.xml
                
- 
                    
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_filter)/config/ground_filter.param.yaml]
 - vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]
 - input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
 - output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_ground_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
 - Dai Nguyen
 - Yoshi Ri
 - Junya Sasaki
 
Authors
- Open Perception
 - Julius Kammerl
 - William Woodall
 
autoware_ground_filter
Purpose
The autoware_ground_filter is a node that remove the ground points from the input pointcloud.
Inner-workings / Algorithms
Detail description of each ground segmentation algorithm is in the following links.
| Filter Name | Description | Detail | 
|---|---|---|
| ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link | 
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
~/input/indices | 
      pcl_msgs::msg::Indices | 
      reference indices | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
Parameters
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | input frame id | 
output_frame | 
      string | ” “ | output frame id | 
max_queue_size | 
      int | 5 | max queue size of input/output topics | 
use_indices | 
      bool | false | flag to use pointcloud indices | 
latched_indices | 
      bool | false | flag to latch pointcloud indices | 
approximate_sync | 
      bool | false | flag to use approximate sync option | 
Assumptions / Known limits
Implemented based on pcl_perception [1] because of this issue.
References/External links
[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp
Changelog for package autoware_ground_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: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
 
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
 - 
    
fix: deprecation of .h files in message_filters (#467)
- fix: deprecation of .h files in message_filters
 
* Update perception/autoware_ground_filter/include/autoware/ground_filter/node.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>> ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
fix(autoware_ground_filter): fix deprecated autoware_utils header (#417)
- fix autoware_utils header
 - style(pre-commit): autofix
 
* fix autoware_utils packages ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Junya Sasaki <<j2sasaki1990@gmail.com>>
 - 
    
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, Tim Clephas, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- 
    
chore: update version in package.xml
 - 
    
feat: re-implementation autoware_ground_filter as alpha quality from universe (#311)
* add: [scan_ground_filter]{.title-ref} from Autoware Universe Source: Files copied from [Autoware Universe](https://github.com/autowarefoundation/autoware_universe/tree/b8ce82e3759e50f780a0941ca8698ff52aa57b97/perception/autoware_ground_segmentation). Scope: Integrated [scan_ground_filter]{.title-ref} into [autoware.core]{.title-ref}. Dependency Changes: Removed dependencies on [autoware_pointcloud_preprocessor]{.title-ref} to ensure compatibility within [autoware.core]{.title-ref}. Purpose: Focus on making [scan_ground_filter]{.title-ref} functional within the [autoware.core]{.title-ref} environment. 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>>
 - 
    
Contributors: Junya Sasaki, Ryohsuke Mitsudome
 
Package Dependencies
System Dependencies
Dependant Packages
| Name | Deps | 
|---|---|
| autoware_core_perception | 
Launch files
- launch/ground_filter.launch.xml
                
- 
                    
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_filter)/config/ground_filter.param.yaml]
 - vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]
 - input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
 - output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_ground_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
 - Dai Nguyen
 - Yoshi Ri
 - Junya Sasaki
 
Authors
- Open Perception
 - Julius Kammerl
 - William Woodall
 
autoware_ground_filter
Purpose
The autoware_ground_filter is a node that remove the ground points from the input pointcloud.
Inner-workings / Algorithms
Detail description of each ground segmentation algorithm is in the following links.
| Filter Name | Description | Detail | 
|---|---|---|
| ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link | 
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
~/input/indices | 
      pcl_msgs::msg::Indices | 
      reference indices | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
Parameters
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | input frame id | 
output_frame | 
      string | ” “ | output frame id | 
max_queue_size | 
      int | 5 | max queue size of input/output topics | 
use_indices | 
      bool | false | flag to use pointcloud indices | 
latched_indices | 
      bool | false | flag to latch pointcloud indices | 
approximate_sync | 
      bool | false | flag to use approximate sync option | 
Assumptions / Known limits
Implemented based on pcl_perception [1] because of this issue.
References/External links
[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp
Changelog for package autoware_ground_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: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
 
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
 - 
    
fix: deprecation of .h files in message_filters (#467)
- fix: deprecation of .h files in message_filters
 
* Update perception/autoware_ground_filter/include/autoware/ground_filter/node.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>> ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
fix(autoware_ground_filter): fix deprecated autoware_utils header (#417)
- fix autoware_utils header
 - style(pre-commit): autofix
 
* fix autoware_utils packages ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Junya Sasaki <<j2sasaki1990@gmail.com>>
 - 
    
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, Tim Clephas, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- 
    
chore: update version in package.xml
 - 
    
feat: re-implementation autoware_ground_filter as alpha quality from universe (#311)
* add: [scan_ground_filter]{.title-ref} from Autoware Universe Source: Files copied from [Autoware Universe](https://github.com/autowarefoundation/autoware_universe/tree/b8ce82e3759e50f780a0941ca8698ff52aa57b97/perception/autoware_ground_segmentation). Scope: Integrated [scan_ground_filter]{.title-ref} into [autoware.core]{.title-ref}. Dependency Changes: Removed dependencies on [autoware_pointcloud_preprocessor]{.title-ref} to ensure compatibility within [autoware.core]{.title-ref}. Purpose: Focus on making [scan_ground_filter]{.title-ref} functional within the [autoware.core]{.title-ref} environment. 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>>
 - 
    
Contributors: Junya Sasaki, Ryohsuke Mitsudome
 
Package Dependencies
System Dependencies
Dependant Packages
| Name | Deps | 
|---|---|
| autoware_core_perception | 
Launch files
- launch/ground_filter.launch.xml
                
- 
                    
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_filter)/config/ground_filter.param.yaml]
 - vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]
 - input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
 - output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_ground_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
 - Dai Nguyen
 - Yoshi Ri
 - Junya Sasaki
 
Authors
- Open Perception
 - Julius Kammerl
 - William Woodall
 
autoware_ground_filter
Purpose
The autoware_ground_filter is a node that remove the ground points from the input pointcloud.
Inner-workings / Algorithms
Detail description of each ground segmentation algorithm is in the following links.
| Filter Name | Description | Detail | 
|---|---|---|
| ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link | 
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
~/input/indices | 
      pcl_msgs::msg::Indices | 
      reference indices | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
Parameters
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | input frame id | 
output_frame | 
      string | ” “ | output frame id | 
max_queue_size | 
      int | 5 | max queue size of input/output topics | 
use_indices | 
      bool | false | flag to use pointcloud indices | 
latched_indices | 
      bool | false | flag to latch pointcloud indices | 
approximate_sync | 
      bool | false | flag to use approximate sync option | 
Assumptions / Known limits
Implemented based on pcl_perception [1] because of this issue.
References/External links
[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp
Changelog for package autoware_ground_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: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
 
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
 - 
    
fix: deprecation of .h files in message_filters (#467)
- fix: deprecation of .h files in message_filters
 
* Update perception/autoware_ground_filter/include/autoware/ground_filter/node.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>> ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
fix(autoware_ground_filter): fix deprecated autoware_utils header (#417)
- fix autoware_utils header
 - style(pre-commit): autofix
 
* fix autoware_utils packages ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Junya Sasaki <<j2sasaki1990@gmail.com>>
 - 
    
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, Tim Clephas, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- 
    
chore: update version in package.xml
 - 
    
feat: re-implementation autoware_ground_filter as alpha quality from universe (#311)
* add: [scan_ground_filter]{.title-ref} from Autoware Universe Source: Files copied from [Autoware Universe](https://github.com/autowarefoundation/autoware_universe/tree/b8ce82e3759e50f780a0941ca8698ff52aa57b97/perception/autoware_ground_segmentation). Scope: Integrated [scan_ground_filter]{.title-ref} into [autoware.core]{.title-ref}. Dependency Changes: Removed dependencies on [autoware_pointcloud_preprocessor]{.title-ref} to ensure compatibility within [autoware.core]{.title-ref}. Purpose: Focus on making [scan_ground_filter]{.title-ref} functional within the [autoware.core]{.title-ref} environment. 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>>
 - 
    
Contributors: Junya Sasaki, Ryohsuke Mitsudome
 
Package Dependencies
System Dependencies
Dependant Packages
| Name | Deps | 
|---|---|
| autoware_core_perception | 
Launch files
- launch/ground_filter.launch.xml
                
- 
                    
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_filter)/config/ground_filter.param.yaml]
 - vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]
 - input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
 - output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_ground_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
 - Dai Nguyen
 - Yoshi Ri
 - Junya Sasaki
 
Authors
- Open Perception
 - Julius Kammerl
 - William Woodall
 
autoware_ground_filter
Purpose
The autoware_ground_filter is a node that remove the ground points from the input pointcloud.
Inner-workings / Algorithms
Detail description of each ground segmentation algorithm is in the following links.
| Filter Name | Description | Detail | 
|---|---|---|
| ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link | 
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
~/input/indices | 
      pcl_msgs::msg::Indices | 
      reference indices | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
Parameters
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | input frame id | 
output_frame | 
      string | ” “ | output frame id | 
max_queue_size | 
      int | 5 | max queue size of input/output topics | 
use_indices | 
      bool | false | flag to use pointcloud indices | 
latched_indices | 
      bool | false | flag to latch pointcloud indices | 
approximate_sync | 
      bool | false | flag to use approximate sync option | 
Assumptions / Known limits
Implemented based on pcl_perception [1] because of this issue.
References/External links
[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp
Changelog for package autoware_ground_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: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
 
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
 - 
    
fix: deprecation of .h files in message_filters (#467)
- fix: deprecation of .h files in message_filters
 
* Update perception/autoware_ground_filter/include/autoware/ground_filter/node.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>> ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
fix(autoware_ground_filter): fix deprecated autoware_utils header (#417)
- fix autoware_utils header
 - style(pre-commit): autofix
 
* fix autoware_utils packages ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Junya Sasaki <<j2sasaki1990@gmail.com>>
 - 
    
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, Tim Clephas, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- 
    
chore: update version in package.xml
 - 
    
feat: re-implementation autoware_ground_filter as alpha quality from universe (#311)
* add: [scan_ground_filter]{.title-ref} from Autoware Universe Source: Files copied from [Autoware Universe](https://github.com/autowarefoundation/autoware_universe/tree/b8ce82e3759e50f780a0941ca8698ff52aa57b97/perception/autoware_ground_segmentation). Scope: Integrated [scan_ground_filter]{.title-ref} into [autoware.core]{.title-ref}. Dependency Changes: Removed dependencies on [autoware_pointcloud_preprocessor]{.title-ref} to ensure compatibility within [autoware.core]{.title-ref}. Purpose: Focus on making [scan_ground_filter]{.title-ref} functional within the [autoware.core]{.title-ref} environment. 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>>
 - 
    
Contributors: Junya Sasaki, Ryohsuke Mitsudome
 
Package Dependencies
System Dependencies
Dependant Packages
| Name | Deps | 
|---|---|
| autoware_core_perception | 
Launch files
- launch/ground_filter.launch.xml
                
- 
                    
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_filter)/config/ground_filter.param.yaml]
 - vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]
 - input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
 - output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_ground_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
 - Dai Nguyen
 - Yoshi Ri
 - Junya Sasaki
 
Authors
- Open Perception
 - Julius Kammerl
 - William Woodall
 
autoware_ground_filter
Purpose
The autoware_ground_filter is a node that remove the ground points from the input pointcloud.
Inner-workings / Algorithms
Detail description of each ground segmentation algorithm is in the following links.
| Filter Name | Description | Detail | 
|---|---|---|
| ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link | 
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
~/input/indices | 
      pcl_msgs::msg::Indices | 
      reference indices | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
Parameters
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | input frame id | 
output_frame | 
      string | ” “ | output frame id | 
max_queue_size | 
      int | 5 | max queue size of input/output topics | 
use_indices | 
      bool | false | flag to use pointcloud indices | 
latched_indices | 
      bool | false | flag to latch pointcloud indices | 
approximate_sync | 
      bool | false | flag to use approximate sync option | 
Assumptions / Known limits
Implemented based on pcl_perception [1] because of this issue.
References/External links
[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp
Changelog for package autoware_ground_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: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
 
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
 - 
    
fix: deprecation of .h files in message_filters (#467)
- fix: deprecation of .h files in message_filters
 
* Update perception/autoware_ground_filter/include/autoware/ground_filter/node.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>> ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
fix(autoware_ground_filter): fix deprecated autoware_utils header (#417)
- fix autoware_utils header
 - style(pre-commit): autofix
 
* fix autoware_utils packages ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Junya Sasaki <<j2sasaki1990@gmail.com>>
 - 
    
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, Tim Clephas, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- 
    
chore: update version in package.xml
 - 
    
feat: re-implementation autoware_ground_filter as alpha quality from universe (#311)
* add: [scan_ground_filter]{.title-ref} from Autoware Universe Source: Files copied from [Autoware Universe](https://github.com/autowarefoundation/autoware_universe/tree/b8ce82e3759e50f780a0941ca8698ff52aa57b97/perception/autoware_ground_segmentation). Scope: Integrated [scan_ground_filter]{.title-ref} into [autoware.core]{.title-ref}. Dependency Changes: Removed dependencies on [autoware_pointcloud_preprocessor]{.title-ref} to ensure compatibility within [autoware.core]{.title-ref}. Purpose: Focus on making [scan_ground_filter]{.title-ref} functional within the [autoware.core]{.title-ref} environment. 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>>
 - 
    
Contributors: Junya Sasaki, Ryohsuke Mitsudome
 
Package Dependencies
System Dependencies
Dependant Packages
| Name | Deps | 
|---|---|
| autoware_core_perception | 
Launch files
- launch/ground_filter.launch.xml
                
- 
                    
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_filter)/config/ground_filter.param.yaml]
 - vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]
 - input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
 - output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_ground_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
 - Dai Nguyen
 - Yoshi Ri
 - Junya Sasaki
 
Authors
- Open Perception
 - Julius Kammerl
 - William Woodall
 
autoware_ground_filter
Purpose
The autoware_ground_filter is a node that remove the ground points from the input pointcloud.
Inner-workings / Algorithms
Detail description of each ground segmentation algorithm is in the following links.
| Filter Name | Description | Detail | 
|---|---|---|
| ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link | 
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
~/input/indices | 
      pcl_msgs::msg::Indices | 
      reference indices | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
Parameters
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | input frame id | 
output_frame | 
      string | ” “ | output frame id | 
max_queue_size | 
      int | 5 | max queue size of input/output topics | 
use_indices | 
      bool | false | flag to use pointcloud indices | 
latched_indices | 
      bool | false | flag to latch pointcloud indices | 
approximate_sync | 
      bool | false | flag to use approximate sync option | 
Assumptions / Known limits
Implemented based on pcl_perception [1] because of this issue.
References/External links
[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp
Changelog for package autoware_ground_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: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
 
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
 - 
    
fix: deprecation of .h files in message_filters (#467)
- fix: deprecation of .h files in message_filters
 
* Update perception/autoware_ground_filter/include/autoware/ground_filter/node.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>> ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
fix(autoware_ground_filter): fix deprecated autoware_utils header (#417)
- fix autoware_utils header
 - style(pre-commit): autofix
 
* fix autoware_utils packages ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Junya Sasaki <<j2sasaki1990@gmail.com>>
 - 
    
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, Tim Clephas, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- 
    
chore: update version in package.xml
 - 
    
feat: re-implementation autoware_ground_filter as alpha quality from universe (#311)
* add: [scan_ground_filter]{.title-ref} from Autoware Universe Source: Files copied from [Autoware Universe](https://github.com/autowarefoundation/autoware_universe/tree/b8ce82e3759e50f780a0941ca8698ff52aa57b97/perception/autoware_ground_segmentation). Scope: Integrated [scan_ground_filter]{.title-ref} into [autoware.core]{.title-ref}. Dependency Changes: Removed dependencies on [autoware_pointcloud_preprocessor]{.title-ref} to ensure compatibility within [autoware.core]{.title-ref}. Purpose: Focus on making [scan_ground_filter]{.title-ref} functional within the [autoware.core]{.title-ref} environment. 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>>
 - 
    
Contributors: Junya Sasaki, Ryohsuke Mitsudome
 
Package Dependencies
System Dependencies
Dependant Packages
| Name | Deps | 
|---|---|
| autoware_core_perception | 
Launch files
- launch/ground_filter.launch.xml
                
- 
                    
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_filter)/config/ground_filter.param.yaml]
 - vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]
 - input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
 - output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
 
 
 
Messages
Services
Plugins
Recent questions tagged autoware_ground_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
 - Dai Nguyen
 - Yoshi Ri
 - Junya Sasaki
 
Authors
- Open Perception
 - Julius Kammerl
 - William Woodall
 
autoware_ground_filter
Purpose
The autoware_ground_filter is a node that remove the ground points from the input pointcloud.
Inner-workings / Algorithms
Detail description of each ground segmentation algorithm is in the following links.
| Filter Name | Description | Detail | 
|---|---|---|
| ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link | 
Inputs / Outputs
Input
| Name | Type | Description | 
|---|---|---|
~/input/points | 
      sensor_msgs::msg::PointCloud2 | 
      reference points | 
~/input/indices | 
      pcl_msgs::msg::Indices | 
      reference indices | 
Output
| Name | Type | Description | 
|---|---|---|
~/output/points | 
      sensor_msgs::msg::PointCloud2 | 
      filtered points | 
Parameters
Node Parameters
| Name | Type | Default Value | Description | 
|---|---|---|---|
input_frame | 
      string | ” “ | input frame id | 
output_frame | 
      string | ” “ | output frame id | 
max_queue_size | 
      int | 5 | max queue size of input/output topics | 
use_indices | 
      bool | false | flag to use pointcloud indices | 
latched_indices | 
      bool | false | flag to latch pointcloud indices | 
approximate_sync | 
      bool | false | flag to use approximate sync option | 
Assumptions / Known limits
Implemented based on pcl_perception [1] because of this issue.
References/External links
[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp
Changelog for package autoware_ground_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: tf2 uses hpp headers in rolling (and is backported) (#483)
- tf2 uses hpp headers in rolling (and is backported)
 
* fixup! tf2 uses hpp headers in rolling (and is backported) ---------
 - 
    
fix: deprecation of .h files in message_filters (#467)
- fix: deprecation of .h files in message_filters
 
* Update perception/autoware_ground_filter/include/autoware/ground_filter/node.hpp Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>> ---------Co-authored-by: Yutaka Kondo <<yutaka.kondo@youtalk.jp>>
 - 
    
fix(autoware_ground_filter): fix deprecated autoware_utils header (#417)
- fix autoware_utils header
 - style(pre-commit): autofix
 
* fix autoware_utils packages ---------Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Junya Sasaki <<j2sasaki1990@gmail.com>>
 - 
    
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, Tim Clephas, Yutaka Kondo, github-actions
 
1.0.0 (2025-03-31)
- 
    
chore: update version in package.xml
 - 
    
feat: re-implementation autoware_ground_filter as alpha quality from universe (#311)
* add: [scan_ground_filter]{.title-ref} from Autoware Universe Source: Files copied from [Autoware Universe](https://github.com/autowarefoundation/autoware_universe/tree/b8ce82e3759e50f780a0941ca8698ff52aa57b97/perception/autoware_ground_segmentation). Scope: Integrated [scan_ground_filter]{.title-ref} into [autoware.core]{.title-ref}. Dependency Changes: Removed dependencies on [autoware_pointcloud_preprocessor]{.title-ref} to ensure compatibility within [autoware.core]{.title-ref}. Purpose: Focus on making [scan_ground_filter]{.title-ref} functional within the [autoware.core]{.title-ref} environment. 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>>
 - 
    
Contributors: Junya Sasaki, Ryohsuke Mitsudome
 
Package Dependencies
System Dependencies
Dependant Packages
| Name | Deps | 
|---|---|
| autoware_core_perception | 
Launch files
- launch/ground_filter.launch.xml
                
- 
                    
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_filter)/config/ground_filter.param.yaml]
 - vehicle_info_param_file [default: $(find-pkg-share autoware_vehicle_info_utils)/config/vehicle_info.param.yaml]
 - input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
 - output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]