Package Summary
Tags | No category tags. |
Version | 0.46.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_universe.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-07-31 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | planner ros calibration self-driving-car autonomous-driving autonomous-vehicles ros2 3d-map autoware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- amc-nu
- Yukihiro Saito
- Dai Nguyen
- Yoshi Ri
- Taekjin Lee
Authors
- Open Perception
- Julius Kammerl
- William Woodall
autoware_ground_segmentation
Purpose
The autoware_ground_segmentation
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 |
---|---|---|
ray_ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link |
scan_ground_filter | Almost the same method as ray_ground_filter , but with slightly improved performance |
link |
ransac_ground_filter | A method of removing the ground by approximating the ground to a plane | 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
autoware::pointcloud_preprocessor::Filter
is 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_segmentation
0.46.0 (2025-06-20)
-
Merge remote-tracking branch 'upstream/main' into tmp/TaikiYamada/bump_version_base
-
feat(autoware_pointcloud_preprocessor): add diagnostic message (#10579)
- feat: add diag msg
- chore: fix code
- chore: remove outlier count in ring
- chore: move format timestamp to utility
- chore: add paramter to schema
- chore: add parameter for cluster
- chore: clean code
- chore: fix schema
- chore: move diagnostic updater to filter base class
- chore: fix schema
- chore: fix spell error
- chore: set up diagnostic updater
- refactor: utilize autoware_utils diagnostic message
- chore: add publish
- chore: add detail message
- chore: const for time difference
- refactor: structure diagnostics to class
- chore: const reference
- chore: clean logic
- chore: modify function name
- chore: update parameter
- chore: move evaluate status into diagnostic
- chore: fix description for concatenated pointcloud
- chore: timestamp mismatch threshold
- chore: fix diagnostic key
* chore: change function naming ---------
-
fix(scan_ground_segmentation): separate parameter for recheck ignore distance (#10686)
- fix(scan_ground_segmentation): fix recheck effective range
- feat: separate param for recheck region
- chore: docs and test update
- chore: docs
- chore: rename param
* chore: fix schema ---------
-
Contributors: TaikiYamada4, Yi-Hsiang Fang (Vivid), badai nguyen
0.45.0 (2025-05-22)
-
Merge remote-tracking branch 'origin/main' into tmp/notbot/bump_version_base
-
fix(autoware_ground_segmentation): correct slope threshold global to local (#10666)
- fix(grid_ground_filter): correct slope threshold global to local
* Update perception/autoware_ground_segmentation/src/scan_ground_filter/grid_ground_filter.cpp Co-authored-by: badai nguyen <<94814556+badai-nguyen@users.noreply.github.com>>
- Update grid_ground_filter.cpp
* fix(grid_ground_filter): update slope threshold from global to local ---------Co-authored-by: badai nguyen <<94814556+badai-nguyen@users.noreply.github.com>>
-
chore: perception code owner update (#10645)
- chore: update maintainers in multiple perception packages
* Revert "chore: update maintainers in multiple perception packages" This reverts commit f2838c33d6cd82bd032039e2a12b9cb8ba6eb584.
- chore: update maintainers in multiple perception packages
* chore: add Kok Seang Tan as maintainer in multiple perception packages ---------
-
docs(autoware_ground_segmentation): move parameter table to respective README (#10500)
-
Contributors: Ryohsuke Mitsudome, Taekjin LEE, TaikiYamada4
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
libopencv-dev |
yaml-cpp |
Dependant Packages
Name | Deps |
---|---|
tier4_perception_launch |
Launch files
- launch/ransac_ground_filter.launch.xml
-
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_segmentation)/config/ransac_ground_filter.param.yaml]
- input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
- output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
- launch/ray_ground_filter.launch.xml
-
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_segmentation)/config/ray_ground_filter.param.yaml]
- input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
- output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
- launch/scan_ground_filter.launch.xml
-
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_segmentation)/config/scan_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_segmentation at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 0.46.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_universe.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-07-31 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | planner ros calibration self-driving-car autonomous-driving autonomous-vehicles ros2 3d-map autoware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- amc-nu
- Yukihiro Saito
- Dai Nguyen
- Yoshi Ri
- Taekjin Lee
Authors
- Open Perception
- Julius Kammerl
- William Woodall
autoware_ground_segmentation
Purpose
The autoware_ground_segmentation
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 |
---|---|---|
ray_ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link |
scan_ground_filter | Almost the same method as ray_ground_filter , but with slightly improved performance |
link |
ransac_ground_filter | A method of removing the ground by approximating the ground to a plane | 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
autoware::pointcloud_preprocessor::Filter
is 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_segmentation
0.46.0 (2025-06-20)
-
Merge remote-tracking branch 'upstream/main' into tmp/TaikiYamada/bump_version_base
-
feat(autoware_pointcloud_preprocessor): add diagnostic message (#10579)
- feat: add diag msg
- chore: fix code
- chore: remove outlier count in ring
- chore: move format timestamp to utility
- chore: add paramter to schema
- chore: add parameter for cluster
- chore: clean code
- chore: fix schema
- chore: move diagnostic updater to filter base class
- chore: fix schema
- chore: fix spell error
- chore: set up diagnostic updater
- refactor: utilize autoware_utils diagnostic message
- chore: add publish
- chore: add detail message
- chore: const for time difference
- refactor: structure diagnostics to class
- chore: const reference
- chore: clean logic
- chore: modify function name
- chore: update parameter
- chore: move evaluate status into diagnostic
- chore: fix description for concatenated pointcloud
- chore: timestamp mismatch threshold
- chore: fix diagnostic key
* chore: change function naming ---------
-
fix(scan_ground_segmentation): separate parameter for recheck ignore distance (#10686)
- fix(scan_ground_segmentation): fix recheck effective range
- feat: separate param for recheck region
- chore: docs and test update
- chore: docs
- chore: rename param
* chore: fix schema ---------
-
Contributors: TaikiYamada4, Yi-Hsiang Fang (Vivid), badai nguyen
0.45.0 (2025-05-22)
-
Merge remote-tracking branch 'origin/main' into tmp/notbot/bump_version_base
-
fix(autoware_ground_segmentation): correct slope threshold global to local (#10666)
- fix(grid_ground_filter): correct slope threshold global to local
* Update perception/autoware_ground_segmentation/src/scan_ground_filter/grid_ground_filter.cpp Co-authored-by: badai nguyen <<94814556+badai-nguyen@users.noreply.github.com>>
- Update grid_ground_filter.cpp
* fix(grid_ground_filter): update slope threshold from global to local ---------Co-authored-by: badai nguyen <<94814556+badai-nguyen@users.noreply.github.com>>
-
chore: perception code owner update (#10645)
- chore: update maintainers in multiple perception packages
* Revert "chore: update maintainers in multiple perception packages" This reverts commit f2838c33d6cd82bd032039e2a12b9cb8ba6eb584.
- chore: update maintainers in multiple perception packages
* chore: add Kok Seang Tan as maintainer in multiple perception packages ---------
-
docs(autoware_ground_segmentation): move parameter table to respective README (#10500)
-
Contributors: Ryohsuke Mitsudome, Taekjin LEE, TaikiYamada4
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
libopencv-dev |
yaml-cpp |
Dependant Packages
Name | Deps |
---|---|
tier4_perception_launch |
Launch files
- launch/ransac_ground_filter.launch.xml
-
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_segmentation)/config/ransac_ground_filter.param.yaml]
- input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
- output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
- launch/ray_ground_filter.launch.xml
-
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_segmentation)/config/ray_ground_filter.param.yaml]
- input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
- output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
- launch/scan_ground_filter.launch.xml
-
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_segmentation)/config/scan_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_segmentation at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 0.46.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_universe.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-07-31 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | planner ros calibration self-driving-car autonomous-driving autonomous-vehicles ros2 3d-map autoware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- amc-nu
- Yukihiro Saito
- Dai Nguyen
- Yoshi Ri
- Taekjin Lee
Authors
- Open Perception
- Julius Kammerl
- William Woodall
autoware_ground_segmentation
Purpose
The autoware_ground_segmentation
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 |
---|---|---|
ray_ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link |
scan_ground_filter | Almost the same method as ray_ground_filter , but with slightly improved performance |
link |
ransac_ground_filter | A method of removing the ground by approximating the ground to a plane | 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
autoware::pointcloud_preprocessor::Filter
is 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_segmentation
0.46.0 (2025-06-20)
-
Merge remote-tracking branch 'upstream/main' into tmp/TaikiYamada/bump_version_base
-
feat(autoware_pointcloud_preprocessor): add diagnostic message (#10579)
- feat: add diag msg
- chore: fix code
- chore: remove outlier count in ring
- chore: move format timestamp to utility
- chore: add paramter to schema
- chore: add parameter for cluster
- chore: clean code
- chore: fix schema
- chore: move diagnostic updater to filter base class
- chore: fix schema
- chore: fix spell error
- chore: set up diagnostic updater
- refactor: utilize autoware_utils diagnostic message
- chore: add publish
- chore: add detail message
- chore: const for time difference
- refactor: structure diagnostics to class
- chore: const reference
- chore: clean logic
- chore: modify function name
- chore: update parameter
- chore: move evaluate status into diagnostic
- chore: fix description for concatenated pointcloud
- chore: timestamp mismatch threshold
- chore: fix diagnostic key
* chore: change function naming ---------
-
fix(scan_ground_segmentation): separate parameter for recheck ignore distance (#10686)
- fix(scan_ground_segmentation): fix recheck effective range
- feat: separate param for recheck region
- chore: docs and test update
- chore: docs
- chore: rename param
* chore: fix schema ---------
-
Contributors: TaikiYamada4, Yi-Hsiang Fang (Vivid), badai nguyen
0.45.0 (2025-05-22)
-
Merge remote-tracking branch 'origin/main' into tmp/notbot/bump_version_base
-
fix(autoware_ground_segmentation): correct slope threshold global to local (#10666)
- fix(grid_ground_filter): correct slope threshold global to local
* Update perception/autoware_ground_segmentation/src/scan_ground_filter/grid_ground_filter.cpp Co-authored-by: badai nguyen <<94814556+badai-nguyen@users.noreply.github.com>>
- Update grid_ground_filter.cpp
* fix(grid_ground_filter): update slope threshold from global to local ---------Co-authored-by: badai nguyen <<94814556+badai-nguyen@users.noreply.github.com>>
-
chore: perception code owner update (#10645)
- chore: update maintainers in multiple perception packages
* Revert "chore: update maintainers in multiple perception packages" This reverts commit f2838c33d6cd82bd032039e2a12b9cb8ba6eb584.
- chore: update maintainers in multiple perception packages
* chore: add Kok Seang Tan as maintainer in multiple perception packages ---------
-
docs(autoware_ground_segmentation): move parameter table to respective README (#10500)
-
Contributors: Ryohsuke Mitsudome, Taekjin LEE, TaikiYamada4
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
libopencv-dev |
yaml-cpp |
Dependant Packages
Name | Deps |
---|---|
tier4_perception_launch |
Launch files
- launch/ransac_ground_filter.launch.xml
-
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_segmentation)/config/ransac_ground_filter.param.yaml]
- input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
- output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
- launch/ray_ground_filter.launch.xml
-
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_segmentation)/config/ray_ground_filter.param.yaml]
- input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
- output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
- launch/scan_ground_filter.launch.xml
-
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_segmentation)/config/scan_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_segmentation at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 0.46.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_universe.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-07-31 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | planner ros calibration self-driving-car autonomous-driving autonomous-vehicles ros2 3d-map autoware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- amc-nu
- Yukihiro Saito
- Dai Nguyen
- Yoshi Ri
- Taekjin Lee
Authors
- Open Perception
- Julius Kammerl
- William Woodall
autoware_ground_segmentation
Purpose
The autoware_ground_segmentation
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 |
---|---|---|
ray_ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link |
scan_ground_filter | Almost the same method as ray_ground_filter , but with slightly improved performance |
link |
ransac_ground_filter | A method of removing the ground by approximating the ground to a plane | 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
autoware::pointcloud_preprocessor::Filter
is 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_segmentation
0.46.0 (2025-06-20)
-
Merge remote-tracking branch 'upstream/main' into tmp/TaikiYamada/bump_version_base
-
feat(autoware_pointcloud_preprocessor): add diagnostic message (#10579)
- feat: add diag msg
- chore: fix code
- chore: remove outlier count in ring
- chore: move format timestamp to utility
- chore: add paramter to schema
- chore: add parameter for cluster
- chore: clean code
- chore: fix schema
- chore: move diagnostic updater to filter base class
- chore: fix schema
- chore: fix spell error
- chore: set up diagnostic updater
- refactor: utilize autoware_utils diagnostic message
- chore: add publish
- chore: add detail message
- chore: const for time difference
- refactor: structure diagnostics to class
- chore: const reference
- chore: clean logic
- chore: modify function name
- chore: update parameter
- chore: move evaluate status into diagnostic
- chore: fix description for concatenated pointcloud
- chore: timestamp mismatch threshold
- chore: fix diagnostic key
* chore: change function naming ---------
-
fix(scan_ground_segmentation): separate parameter for recheck ignore distance (#10686)
- fix(scan_ground_segmentation): fix recheck effective range
- feat: separate param for recheck region
- chore: docs and test update
- chore: docs
- chore: rename param
* chore: fix schema ---------
-
Contributors: TaikiYamada4, Yi-Hsiang Fang (Vivid), badai nguyen
0.45.0 (2025-05-22)
-
Merge remote-tracking branch 'origin/main' into tmp/notbot/bump_version_base
-
fix(autoware_ground_segmentation): correct slope threshold global to local (#10666)
- fix(grid_ground_filter): correct slope threshold global to local
* Update perception/autoware_ground_segmentation/src/scan_ground_filter/grid_ground_filter.cpp Co-authored-by: badai nguyen <<94814556+badai-nguyen@users.noreply.github.com>>
- Update grid_ground_filter.cpp
* fix(grid_ground_filter): update slope threshold from global to local ---------Co-authored-by: badai nguyen <<94814556+badai-nguyen@users.noreply.github.com>>
-
chore: perception code owner update (#10645)
- chore: update maintainers in multiple perception packages
* Revert "chore: update maintainers in multiple perception packages" This reverts commit f2838c33d6cd82bd032039e2a12b9cb8ba6eb584.
- chore: update maintainers in multiple perception packages
* chore: add Kok Seang Tan as maintainer in multiple perception packages ---------
-
docs(autoware_ground_segmentation): move parameter table to respective README (#10500)
-
Contributors: Ryohsuke Mitsudome, Taekjin LEE, TaikiYamada4
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
libopencv-dev |
yaml-cpp |
Dependant Packages
Name | Deps |
---|---|
tier4_perception_launch |
Launch files
- launch/ransac_ground_filter.launch.xml
-
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_segmentation)/config/ransac_ground_filter.param.yaml]
- input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
- output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
- launch/ray_ground_filter.launch.xml
-
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_segmentation)/config/ray_ground_filter.param.yaml]
- input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
- output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
- launch/scan_ground_filter.launch.xml
-
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_segmentation)/config/scan_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_segmentation at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 0.46.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_universe.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-07-31 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | planner ros calibration self-driving-car autonomous-driving autonomous-vehicles ros2 3d-map autoware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- amc-nu
- Yukihiro Saito
- Dai Nguyen
- Yoshi Ri
- Taekjin Lee
Authors
- Open Perception
- Julius Kammerl
- William Woodall
autoware_ground_segmentation
Purpose
The autoware_ground_segmentation
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 |
---|---|---|
ray_ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link |
scan_ground_filter | Almost the same method as ray_ground_filter , but with slightly improved performance |
link |
ransac_ground_filter | A method of removing the ground by approximating the ground to a plane | 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
autoware::pointcloud_preprocessor::Filter
is 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_segmentation
0.46.0 (2025-06-20)
-
Merge remote-tracking branch 'upstream/main' into tmp/TaikiYamada/bump_version_base
-
feat(autoware_pointcloud_preprocessor): add diagnostic message (#10579)
- feat: add diag msg
- chore: fix code
- chore: remove outlier count in ring
- chore: move format timestamp to utility
- chore: add paramter to schema
- chore: add parameter for cluster
- chore: clean code
- chore: fix schema
- chore: move diagnostic updater to filter base class
- chore: fix schema
- chore: fix spell error
- chore: set up diagnostic updater
- refactor: utilize autoware_utils diagnostic message
- chore: add publish
- chore: add detail message
- chore: const for time difference
- refactor: structure diagnostics to class
- chore: const reference
- chore: clean logic
- chore: modify function name
- chore: update parameter
- chore: move evaluate status into diagnostic
- chore: fix description for concatenated pointcloud
- chore: timestamp mismatch threshold
- chore: fix diagnostic key
* chore: change function naming ---------
-
fix(scan_ground_segmentation): separate parameter for recheck ignore distance (#10686)
- fix(scan_ground_segmentation): fix recheck effective range
- feat: separate param for recheck region
- chore: docs and test update
- chore: docs
- chore: rename param
* chore: fix schema ---------
-
Contributors: TaikiYamada4, Yi-Hsiang Fang (Vivid), badai nguyen
0.45.0 (2025-05-22)
-
Merge remote-tracking branch 'origin/main' into tmp/notbot/bump_version_base
-
fix(autoware_ground_segmentation): correct slope threshold global to local (#10666)
- fix(grid_ground_filter): correct slope threshold global to local
* Update perception/autoware_ground_segmentation/src/scan_ground_filter/grid_ground_filter.cpp Co-authored-by: badai nguyen <<94814556+badai-nguyen@users.noreply.github.com>>
- Update grid_ground_filter.cpp
* fix(grid_ground_filter): update slope threshold from global to local ---------Co-authored-by: badai nguyen <<94814556+badai-nguyen@users.noreply.github.com>>
-
chore: perception code owner update (#10645)
- chore: update maintainers in multiple perception packages
* Revert "chore: update maintainers in multiple perception packages" This reverts commit f2838c33d6cd82bd032039e2a12b9cb8ba6eb584.
- chore: update maintainers in multiple perception packages
* chore: add Kok Seang Tan as maintainer in multiple perception packages ---------
-
docs(autoware_ground_segmentation): move parameter table to respective README (#10500)
-
Contributors: Ryohsuke Mitsudome, Taekjin LEE, TaikiYamada4
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
libopencv-dev |
yaml-cpp |
Dependant Packages
Name | Deps |
---|---|
tier4_perception_launch |
Launch files
- launch/ransac_ground_filter.launch.xml
-
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_segmentation)/config/ransac_ground_filter.param.yaml]
- input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
- output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
- launch/ray_ground_filter.launch.xml
-
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_segmentation)/config/ray_ground_filter.param.yaml]
- input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
- output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
- launch/scan_ground_filter.launch.xml
-
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_segmentation)/config/scan_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_segmentation at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 0.46.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_universe.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-07-31 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | planner ros calibration self-driving-car autonomous-driving autonomous-vehicles ros2 3d-map autoware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- amc-nu
- Yukihiro Saito
- Dai Nguyen
- Yoshi Ri
- Taekjin Lee
Authors
- Open Perception
- Julius Kammerl
- William Woodall
autoware_ground_segmentation
Purpose
The autoware_ground_segmentation
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 |
---|---|---|
ray_ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link |
scan_ground_filter | Almost the same method as ray_ground_filter , but with slightly improved performance |
link |
ransac_ground_filter | A method of removing the ground by approximating the ground to a plane | 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
autoware::pointcloud_preprocessor::Filter
is 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_segmentation
0.46.0 (2025-06-20)
-
Merge remote-tracking branch 'upstream/main' into tmp/TaikiYamada/bump_version_base
-
feat(autoware_pointcloud_preprocessor): add diagnostic message (#10579)
- feat: add diag msg
- chore: fix code
- chore: remove outlier count in ring
- chore: move format timestamp to utility
- chore: add paramter to schema
- chore: add parameter for cluster
- chore: clean code
- chore: fix schema
- chore: move diagnostic updater to filter base class
- chore: fix schema
- chore: fix spell error
- chore: set up diagnostic updater
- refactor: utilize autoware_utils diagnostic message
- chore: add publish
- chore: add detail message
- chore: const for time difference
- refactor: structure diagnostics to class
- chore: const reference
- chore: clean logic
- chore: modify function name
- chore: update parameter
- chore: move evaluate status into diagnostic
- chore: fix description for concatenated pointcloud
- chore: timestamp mismatch threshold
- chore: fix diagnostic key
* chore: change function naming ---------
-
fix(scan_ground_segmentation): separate parameter for recheck ignore distance (#10686)
- fix(scan_ground_segmentation): fix recheck effective range
- feat: separate param for recheck region
- chore: docs and test update
- chore: docs
- chore: rename param
* chore: fix schema ---------
-
Contributors: TaikiYamada4, Yi-Hsiang Fang (Vivid), badai nguyen
0.45.0 (2025-05-22)
-
Merge remote-tracking branch 'origin/main' into tmp/notbot/bump_version_base
-
fix(autoware_ground_segmentation): correct slope threshold global to local (#10666)
- fix(grid_ground_filter): correct slope threshold global to local
* Update perception/autoware_ground_segmentation/src/scan_ground_filter/grid_ground_filter.cpp Co-authored-by: badai nguyen <<94814556+badai-nguyen@users.noreply.github.com>>
- Update grid_ground_filter.cpp
* fix(grid_ground_filter): update slope threshold from global to local ---------Co-authored-by: badai nguyen <<94814556+badai-nguyen@users.noreply.github.com>>
-
chore: perception code owner update (#10645)
- chore: update maintainers in multiple perception packages
* Revert "chore: update maintainers in multiple perception packages" This reverts commit f2838c33d6cd82bd032039e2a12b9cb8ba6eb584.
- chore: update maintainers in multiple perception packages
* chore: add Kok Seang Tan as maintainer in multiple perception packages ---------
-
docs(autoware_ground_segmentation): move parameter table to respective README (#10500)
-
Contributors: Ryohsuke Mitsudome, Taekjin LEE, TaikiYamada4
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
libopencv-dev |
yaml-cpp |
Dependant Packages
Name | Deps |
---|---|
tier4_perception_launch |
Launch files
- launch/ransac_ground_filter.launch.xml
-
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_segmentation)/config/ransac_ground_filter.param.yaml]
- input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
- output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
- launch/ray_ground_filter.launch.xml
-
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_segmentation)/config/ray_ground_filter.param.yaml]
- input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
- output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
- launch/scan_ground_filter.launch.xml
-
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_segmentation)/config/scan_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_segmentation at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 0.46.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_universe.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-07-31 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | planner ros calibration self-driving-car autonomous-driving autonomous-vehicles ros2 3d-map autoware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- amc-nu
- Yukihiro Saito
- Dai Nguyen
- Yoshi Ri
- Taekjin Lee
Authors
- Open Perception
- Julius Kammerl
- William Woodall
autoware_ground_segmentation
Purpose
The autoware_ground_segmentation
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 |
---|---|---|
ray_ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link |
scan_ground_filter | Almost the same method as ray_ground_filter , but with slightly improved performance |
link |
ransac_ground_filter | A method of removing the ground by approximating the ground to a plane | 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
autoware::pointcloud_preprocessor::Filter
is 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_segmentation
0.46.0 (2025-06-20)
-
Merge remote-tracking branch 'upstream/main' into tmp/TaikiYamada/bump_version_base
-
feat(autoware_pointcloud_preprocessor): add diagnostic message (#10579)
- feat: add diag msg
- chore: fix code
- chore: remove outlier count in ring
- chore: move format timestamp to utility
- chore: add paramter to schema
- chore: add parameter for cluster
- chore: clean code
- chore: fix schema
- chore: move diagnostic updater to filter base class
- chore: fix schema
- chore: fix spell error
- chore: set up diagnostic updater
- refactor: utilize autoware_utils diagnostic message
- chore: add publish
- chore: add detail message
- chore: const for time difference
- refactor: structure diagnostics to class
- chore: const reference
- chore: clean logic
- chore: modify function name
- chore: update parameter
- chore: move evaluate status into diagnostic
- chore: fix description for concatenated pointcloud
- chore: timestamp mismatch threshold
- chore: fix diagnostic key
* chore: change function naming ---------
-
fix(scan_ground_segmentation): separate parameter for recheck ignore distance (#10686)
- fix(scan_ground_segmentation): fix recheck effective range
- feat: separate param for recheck region
- chore: docs and test update
- chore: docs
- chore: rename param
* chore: fix schema ---------
-
Contributors: TaikiYamada4, Yi-Hsiang Fang (Vivid), badai nguyen
0.45.0 (2025-05-22)
-
Merge remote-tracking branch 'origin/main' into tmp/notbot/bump_version_base
-
fix(autoware_ground_segmentation): correct slope threshold global to local (#10666)
- fix(grid_ground_filter): correct slope threshold global to local
* Update perception/autoware_ground_segmentation/src/scan_ground_filter/grid_ground_filter.cpp Co-authored-by: badai nguyen <<94814556+badai-nguyen@users.noreply.github.com>>
- Update grid_ground_filter.cpp
* fix(grid_ground_filter): update slope threshold from global to local ---------Co-authored-by: badai nguyen <<94814556+badai-nguyen@users.noreply.github.com>>
-
chore: perception code owner update (#10645)
- chore: update maintainers in multiple perception packages
* Revert "chore: update maintainers in multiple perception packages" This reverts commit f2838c33d6cd82bd032039e2a12b9cb8ba6eb584.
- chore: update maintainers in multiple perception packages
* chore: add Kok Seang Tan as maintainer in multiple perception packages ---------
-
docs(autoware_ground_segmentation): move parameter table to respective README (#10500)
-
Contributors: Ryohsuke Mitsudome, Taekjin LEE, TaikiYamada4
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
libopencv-dev |
yaml-cpp |
Dependant Packages
Name | Deps |
---|---|
tier4_perception_launch |
Launch files
- launch/ransac_ground_filter.launch.xml
-
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_segmentation)/config/ransac_ground_filter.param.yaml]
- input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
- output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
- launch/ray_ground_filter.launch.xml
-
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_segmentation)/config/ray_ground_filter.param.yaml]
- input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
- output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
- launch/scan_ground_filter.launch.xml
-
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_segmentation)/config/scan_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_segmentation at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 0.46.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_universe.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-07-31 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | planner ros calibration self-driving-car autonomous-driving autonomous-vehicles ros2 3d-map autoware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- amc-nu
- Yukihiro Saito
- Dai Nguyen
- Yoshi Ri
- Taekjin Lee
Authors
- Open Perception
- Julius Kammerl
- William Woodall
autoware_ground_segmentation
Purpose
The autoware_ground_segmentation
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 |
---|---|---|
ray_ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link |
scan_ground_filter | Almost the same method as ray_ground_filter , but with slightly improved performance |
link |
ransac_ground_filter | A method of removing the ground by approximating the ground to a plane | 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
autoware::pointcloud_preprocessor::Filter
is 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_segmentation
0.46.0 (2025-06-20)
-
Merge remote-tracking branch 'upstream/main' into tmp/TaikiYamada/bump_version_base
-
feat(autoware_pointcloud_preprocessor): add diagnostic message (#10579)
- feat: add diag msg
- chore: fix code
- chore: remove outlier count in ring
- chore: move format timestamp to utility
- chore: add paramter to schema
- chore: add parameter for cluster
- chore: clean code
- chore: fix schema
- chore: move diagnostic updater to filter base class
- chore: fix schema
- chore: fix spell error
- chore: set up diagnostic updater
- refactor: utilize autoware_utils diagnostic message
- chore: add publish
- chore: add detail message
- chore: const for time difference
- refactor: structure diagnostics to class
- chore: const reference
- chore: clean logic
- chore: modify function name
- chore: update parameter
- chore: move evaluate status into diagnostic
- chore: fix description for concatenated pointcloud
- chore: timestamp mismatch threshold
- chore: fix diagnostic key
* chore: change function naming ---------
-
fix(scan_ground_segmentation): separate parameter for recheck ignore distance (#10686)
- fix(scan_ground_segmentation): fix recheck effective range
- feat: separate param for recheck region
- chore: docs and test update
- chore: docs
- chore: rename param
* chore: fix schema ---------
-
Contributors: TaikiYamada4, Yi-Hsiang Fang (Vivid), badai nguyen
0.45.0 (2025-05-22)
-
Merge remote-tracking branch 'origin/main' into tmp/notbot/bump_version_base
-
fix(autoware_ground_segmentation): correct slope threshold global to local (#10666)
- fix(grid_ground_filter): correct slope threshold global to local
* Update perception/autoware_ground_segmentation/src/scan_ground_filter/grid_ground_filter.cpp Co-authored-by: badai nguyen <<94814556+badai-nguyen@users.noreply.github.com>>
- Update grid_ground_filter.cpp
* fix(grid_ground_filter): update slope threshold from global to local ---------Co-authored-by: badai nguyen <<94814556+badai-nguyen@users.noreply.github.com>>
-
chore: perception code owner update (#10645)
- chore: update maintainers in multiple perception packages
* Revert "chore: update maintainers in multiple perception packages" This reverts commit f2838c33d6cd82bd032039e2a12b9cb8ba6eb584.
- chore: update maintainers in multiple perception packages
* chore: add Kok Seang Tan as maintainer in multiple perception packages ---------
-
docs(autoware_ground_segmentation): move parameter table to respective README (#10500)
-
Contributors: Ryohsuke Mitsudome, Taekjin LEE, TaikiYamada4
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
libopencv-dev |
yaml-cpp |
Dependant Packages
Name | Deps |
---|---|
tier4_perception_launch |
Launch files
- launch/ransac_ground_filter.launch.xml
-
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_segmentation)/config/ransac_ground_filter.param.yaml]
- input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
- output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
- launch/ray_ground_filter.launch.xml
-
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_segmentation)/config/ray_ground_filter.param.yaml]
- input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
- output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
- launch/scan_ground_filter.launch.xml
-
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_segmentation)/config/scan_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_segmentation at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 0.46.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | |
Checkout URI | https://github.com/autowarefoundation/autoware_universe.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-07-31 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | planner ros calibration self-driving-car autonomous-driving autonomous-vehicles ros2 3d-map autoware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- amc-nu
- Yukihiro Saito
- Dai Nguyen
- Yoshi Ri
- Taekjin Lee
Authors
- Open Perception
- Julius Kammerl
- William Woodall
autoware_ground_segmentation
Purpose
The autoware_ground_segmentation
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 |
---|---|---|
ray_ground_filter | A method of removing the ground based on the geometrical relationship between points lined up on radiation | link |
scan_ground_filter | Almost the same method as ray_ground_filter , but with slightly improved performance |
link |
ransac_ground_filter | A method of removing the ground by approximating the ground to a plane | 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
autoware::pointcloud_preprocessor::Filter
is 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_segmentation
0.46.0 (2025-06-20)
-
Merge remote-tracking branch 'upstream/main' into tmp/TaikiYamada/bump_version_base
-
feat(autoware_pointcloud_preprocessor): add diagnostic message (#10579)
- feat: add diag msg
- chore: fix code
- chore: remove outlier count in ring
- chore: move format timestamp to utility
- chore: add paramter to schema
- chore: add parameter for cluster
- chore: clean code
- chore: fix schema
- chore: move diagnostic updater to filter base class
- chore: fix schema
- chore: fix spell error
- chore: set up diagnostic updater
- refactor: utilize autoware_utils diagnostic message
- chore: add publish
- chore: add detail message
- chore: const for time difference
- refactor: structure diagnostics to class
- chore: const reference
- chore: clean logic
- chore: modify function name
- chore: update parameter
- chore: move evaluate status into diagnostic
- chore: fix description for concatenated pointcloud
- chore: timestamp mismatch threshold
- chore: fix diagnostic key
* chore: change function naming ---------
-
fix(scan_ground_segmentation): separate parameter for recheck ignore distance (#10686)
- fix(scan_ground_segmentation): fix recheck effective range
- feat: separate param for recheck region
- chore: docs and test update
- chore: docs
- chore: rename param
* chore: fix schema ---------
-
Contributors: TaikiYamada4, Yi-Hsiang Fang (Vivid), badai nguyen
0.45.0 (2025-05-22)
-
Merge remote-tracking branch 'origin/main' into tmp/notbot/bump_version_base
-
fix(autoware_ground_segmentation): correct slope threshold global to local (#10666)
- fix(grid_ground_filter): correct slope threshold global to local
* Update perception/autoware_ground_segmentation/src/scan_ground_filter/grid_ground_filter.cpp Co-authored-by: badai nguyen <<94814556+badai-nguyen@users.noreply.github.com>>
- Update grid_ground_filter.cpp
* fix(grid_ground_filter): update slope threshold from global to local ---------Co-authored-by: badai nguyen <<94814556+badai-nguyen@users.noreply.github.com>>
-
chore: perception code owner update (#10645)
- chore: update maintainers in multiple perception packages
* Revert "chore: update maintainers in multiple perception packages" This reverts commit f2838c33d6cd82bd032039e2a12b9cb8ba6eb584.
- chore: update maintainers in multiple perception packages
* chore: add Kok Seang Tan as maintainer in multiple perception packages ---------
-
docs(autoware_ground_segmentation): move parameter table to respective README (#10500)
-
Contributors: Ryohsuke Mitsudome, Taekjin LEE, TaikiYamada4
0.44.2 (2025-06-10)
0.44.1 (2025-05-01)
0.44.0 (2025-04-18)
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
libopencv-dev |
yaml-cpp |
Dependant Packages
Name | Deps |
---|---|
tier4_perception_launch |
Launch files
- launch/ransac_ground_filter.launch.xml
-
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_segmentation)/config/ransac_ground_filter.param.yaml]
- input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
- output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
- launch/ray_ground_filter.launch.xml
-
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_segmentation)/config/ray_ground_filter.param.yaml]
- input/pointcloud [default: /sensing/lidar/concatenated/pointcloud]
- output/pointcloud [default: /perception/obstacle_segmentation/pointcloud]
- launch/scan_ground_filter.launch.xml
-
- ground_segmentation_param_file [default: $(find-pkg-share autoware_ground_segmentation)/config/scan_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]