No version for distro humble showing github. Known supported distros are highlighted in the buttons above.
Package symbol

pointcloud_preprocessor package from autoware_car repo

autoware_auto_control_msgs autoware_auto_geometry_msgs autoware_auto_mapping_msgs autoware_auto_perception_msgs autoware_auto_planning_msgs autoware_auto_vehicle_msgs autoware_launch ekf_localizer gyro_odometer initial_pose_button_panel localization_error_monitor ndt_scan_matcher pose2twist pose_initializer stop_filter twist2accel autoware_adapi_v1_msgs autoware_cmake autoware_utils lanelet2_extension autoware_common_msgs autoware_planning_msgs autoware_ad_api_specs autoware_point_types interpolation kalman_filter motion_utils signal_processing tier4_autoware_utils component_interface_specs component_interface_utils ndt_omp tier4_control_msgs tier4_debug_msgs tier4_localization_msgs tier4_system_msgs tier4_localization_launch tier4_map_launch tier4_simulator_launch tier4_system_launch tier4_vehicle_launch pointcloud_preprocessor tier4_pcl_extensions vehicle_velocity_converter automatic_pose_initializer map_height_fitter map_loader map_tf_generator autoware_lint_common autoware_map_msgs tier4_external_api_msgs lanelet2_map_preprocessor autoware_slam autoware_gazebo autoware_gazebo_individual_params autoware_gazebo_launch autoware_gazebo_utils autoware_webots autoware_webots_individual_params autoware_webots_launch autoware_webots_utils robot webots_ros2_driver webots_ros2_msgs cartographer cartographer_ros cartographer_ros_msgs cartographer_rviz dolly dolly_follow dolly_gazebo dolly_ignition ndt_omp_ros2 graph_based_slam lidarslam lidarslam_msgs scanmatcher lio_sam pcl_localization_ros2 velodyne_description velodyne_gazebo_plugins velodyne_simulator

ROS Distro
github

Package Summary

Tags No category tags.
Version 0.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Description
Checkout URI https://github.com/qin-yuan/autoware_car.git
VCS Type git
VCS Version master
Last Updated 2024-12-19
Dev Status UNKNOWN
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

The ROS2 pointcloud_preprocessor package

Additional Links

No additional links.

Maintainers

  • amc-nu
  • Yukihiro Saito
  • Shunsuke Miura

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall

pointcloud_preprocessor

Purpose

The pointcloud_preprocessor is a package that includes the following filters:

  • removing outlier points
  • cropping
  • concatenating pointclouds
  • correcting distortion
  • downsampling

Inner-workings / Algorithms

Detail description of each filter’s algorithm is in the following links.

Filter Name Description Detail
concatenate_data subscribe multiple pointclouds and concatenate them into a pointcloud link
crop_box_filter remove points within a given box link
distortion_corrector compensate pointcloud distortion caused by ego vehicle’s movement during 1 scan link
downsample_filter downsampling input pointcloud link
outlier_filter remove points caused by hardware problems, rain drops and small insects as a noise link
passthrough_filter remove points on the outside of a range in given field (e.g. x, y, z, intensity) link
pointcloud_accumulator accumulate pointclouds for a given amount of time link
vector_map_filter remove points on the outside of lane by using vector map link
vector_map_inside_area_filter remove points inside of vector map area that has given type by parameter 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

pointcloud_preprocessor::Filter is implemented based on pcl_perception [1] because of this issue.

(Optional) Error detection and handling

(Optional) Performance characterization

[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp

(Optional) Future extensions / Unimplemented parts

CHANGELOG
No CHANGELOG found.

Launch files

  • launch/blockage_diag.launch.xml
      • input_topic_name [default: pointcloud_raw_ex]
      • output_topic_name [default: blockage_diag/pointcloud]
  • launch/dual_return_outlier_filter.launch.xml
      • input_topic_name [default: /velodyne_points_ex]
      • output_topic_name [default: /pointcloud_filtered]
      • input_frame [default: velodyne]
      • output_frame [default: velodyne]
      • visibility_threshold [default: 0.95]
      • vertical_bins [default: 128]
      • max_azimuth_diff [default: 50.0]
  • launch/preprocessor.launch.xml
      • input_points_raw_list [default: ['/points_raw']]
      • output_points_raw [default: /points_raw/cropbox/filtered]
      • tf_output_frame [default: base_link]
  • launch/random_downsample_filter.launch.xml
      • input_topic_name [default: /sensing/lidar/top/pointcloud_raw]
      • output_topic_name [default: /sensing/lidar/top/random_downsample_filter/pointcloud]
      • sample_num [default: 1500]
      • input_frame [default: ]
      • output_frame [default: base_link]
  • launch/ring_passthrough_filter.launch.xml
      • input_topic_name [default: /sensing/lidar/top/pointcloud_raw]
      • output_topic_name [default: /sensing/lidar/top/ring_passthrough_filtered/pointcloud]
      • filter_field_name [default: ring]
      • filter_limit_min [default: 0]
      • filter_limit_max [default: 127]
      • filter_limit_negative [default: False]
      • keep_organized [default: False]
      • input_frame [default: ]
      • output_frame [default: base_link]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged pointcloud_preprocessor at Robotics Stack Exchange

No version for distro jazzy showing github. Known supported distros are highlighted in the buttons above.
Package symbol

pointcloud_preprocessor package from autoware_car repo

autoware_auto_control_msgs autoware_auto_geometry_msgs autoware_auto_mapping_msgs autoware_auto_perception_msgs autoware_auto_planning_msgs autoware_auto_vehicle_msgs autoware_launch ekf_localizer gyro_odometer initial_pose_button_panel localization_error_monitor ndt_scan_matcher pose2twist pose_initializer stop_filter twist2accel autoware_adapi_v1_msgs autoware_cmake autoware_utils lanelet2_extension autoware_common_msgs autoware_planning_msgs autoware_ad_api_specs autoware_point_types interpolation kalman_filter motion_utils signal_processing tier4_autoware_utils component_interface_specs component_interface_utils ndt_omp tier4_control_msgs tier4_debug_msgs tier4_localization_msgs tier4_system_msgs tier4_localization_launch tier4_map_launch tier4_simulator_launch tier4_system_launch tier4_vehicle_launch pointcloud_preprocessor tier4_pcl_extensions vehicle_velocity_converter automatic_pose_initializer map_height_fitter map_loader map_tf_generator autoware_lint_common autoware_map_msgs tier4_external_api_msgs lanelet2_map_preprocessor autoware_slam autoware_gazebo autoware_gazebo_individual_params autoware_gazebo_launch autoware_gazebo_utils autoware_webots autoware_webots_individual_params autoware_webots_launch autoware_webots_utils robot webots_ros2_driver webots_ros2_msgs cartographer cartographer_ros cartographer_ros_msgs cartographer_rviz dolly dolly_follow dolly_gazebo dolly_ignition ndt_omp_ros2 graph_based_slam lidarslam lidarslam_msgs scanmatcher lio_sam pcl_localization_ros2 velodyne_description velodyne_gazebo_plugins velodyne_simulator

ROS Distro
github

Package Summary

Tags No category tags.
Version 0.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Description
Checkout URI https://github.com/qin-yuan/autoware_car.git
VCS Type git
VCS Version master
Last Updated 2024-12-19
Dev Status UNKNOWN
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

The ROS2 pointcloud_preprocessor package

Additional Links

No additional links.

Maintainers

  • amc-nu
  • Yukihiro Saito
  • Shunsuke Miura

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall

pointcloud_preprocessor

Purpose

The pointcloud_preprocessor is a package that includes the following filters:

  • removing outlier points
  • cropping
  • concatenating pointclouds
  • correcting distortion
  • downsampling

Inner-workings / Algorithms

Detail description of each filter’s algorithm is in the following links.

Filter Name Description Detail
concatenate_data subscribe multiple pointclouds and concatenate them into a pointcloud link
crop_box_filter remove points within a given box link
distortion_corrector compensate pointcloud distortion caused by ego vehicle’s movement during 1 scan link
downsample_filter downsampling input pointcloud link
outlier_filter remove points caused by hardware problems, rain drops and small insects as a noise link
passthrough_filter remove points on the outside of a range in given field (e.g. x, y, z, intensity) link
pointcloud_accumulator accumulate pointclouds for a given amount of time link
vector_map_filter remove points on the outside of lane by using vector map link
vector_map_inside_area_filter remove points inside of vector map area that has given type by parameter 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

pointcloud_preprocessor::Filter is implemented based on pcl_perception [1] because of this issue.

(Optional) Error detection and handling

(Optional) Performance characterization

[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp

(Optional) Future extensions / Unimplemented parts

CHANGELOG
No CHANGELOG found.

Launch files

  • launch/blockage_diag.launch.xml
      • input_topic_name [default: pointcloud_raw_ex]
      • output_topic_name [default: blockage_diag/pointcloud]
  • launch/dual_return_outlier_filter.launch.xml
      • input_topic_name [default: /velodyne_points_ex]
      • output_topic_name [default: /pointcloud_filtered]
      • input_frame [default: velodyne]
      • output_frame [default: velodyne]
      • visibility_threshold [default: 0.95]
      • vertical_bins [default: 128]
      • max_azimuth_diff [default: 50.0]
  • launch/preprocessor.launch.xml
      • input_points_raw_list [default: ['/points_raw']]
      • output_points_raw [default: /points_raw/cropbox/filtered]
      • tf_output_frame [default: base_link]
  • launch/random_downsample_filter.launch.xml
      • input_topic_name [default: /sensing/lidar/top/pointcloud_raw]
      • output_topic_name [default: /sensing/lidar/top/random_downsample_filter/pointcloud]
      • sample_num [default: 1500]
      • input_frame [default: ]
      • output_frame [default: base_link]
  • launch/ring_passthrough_filter.launch.xml
      • input_topic_name [default: /sensing/lidar/top/pointcloud_raw]
      • output_topic_name [default: /sensing/lidar/top/ring_passthrough_filtered/pointcloud]
      • filter_field_name [default: ring]
      • filter_limit_min [default: 0]
      • filter_limit_max [default: 127]
      • filter_limit_negative [default: False]
      • keep_organized [default: False]
      • input_frame [default: ]
      • output_frame [default: base_link]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged pointcloud_preprocessor at Robotics Stack Exchange

No version for distro kilted showing github. Known supported distros are highlighted in the buttons above.
Package symbol

pointcloud_preprocessor package from autoware_car repo

autoware_auto_control_msgs autoware_auto_geometry_msgs autoware_auto_mapping_msgs autoware_auto_perception_msgs autoware_auto_planning_msgs autoware_auto_vehicle_msgs autoware_launch ekf_localizer gyro_odometer initial_pose_button_panel localization_error_monitor ndt_scan_matcher pose2twist pose_initializer stop_filter twist2accel autoware_adapi_v1_msgs autoware_cmake autoware_utils lanelet2_extension autoware_common_msgs autoware_planning_msgs autoware_ad_api_specs autoware_point_types interpolation kalman_filter motion_utils signal_processing tier4_autoware_utils component_interface_specs component_interface_utils ndt_omp tier4_control_msgs tier4_debug_msgs tier4_localization_msgs tier4_system_msgs tier4_localization_launch tier4_map_launch tier4_simulator_launch tier4_system_launch tier4_vehicle_launch pointcloud_preprocessor tier4_pcl_extensions vehicle_velocity_converter automatic_pose_initializer map_height_fitter map_loader map_tf_generator autoware_lint_common autoware_map_msgs tier4_external_api_msgs lanelet2_map_preprocessor autoware_slam autoware_gazebo autoware_gazebo_individual_params autoware_gazebo_launch autoware_gazebo_utils autoware_webots autoware_webots_individual_params autoware_webots_launch autoware_webots_utils robot webots_ros2_driver webots_ros2_msgs cartographer cartographer_ros cartographer_ros_msgs cartographer_rviz dolly dolly_follow dolly_gazebo dolly_ignition ndt_omp_ros2 graph_based_slam lidarslam lidarslam_msgs scanmatcher lio_sam pcl_localization_ros2 velodyne_description velodyne_gazebo_plugins velodyne_simulator

ROS Distro
github

Package Summary

Tags No category tags.
Version 0.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Description
Checkout URI https://github.com/qin-yuan/autoware_car.git
VCS Type git
VCS Version master
Last Updated 2024-12-19
Dev Status UNKNOWN
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

The ROS2 pointcloud_preprocessor package

Additional Links

No additional links.

Maintainers

  • amc-nu
  • Yukihiro Saito
  • Shunsuke Miura

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall

pointcloud_preprocessor

Purpose

The pointcloud_preprocessor is a package that includes the following filters:

  • removing outlier points
  • cropping
  • concatenating pointclouds
  • correcting distortion
  • downsampling

Inner-workings / Algorithms

Detail description of each filter’s algorithm is in the following links.

Filter Name Description Detail
concatenate_data subscribe multiple pointclouds and concatenate them into a pointcloud link
crop_box_filter remove points within a given box link
distortion_corrector compensate pointcloud distortion caused by ego vehicle’s movement during 1 scan link
downsample_filter downsampling input pointcloud link
outlier_filter remove points caused by hardware problems, rain drops and small insects as a noise link
passthrough_filter remove points on the outside of a range in given field (e.g. x, y, z, intensity) link
pointcloud_accumulator accumulate pointclouds for a given amount of time link
vector_map_filter remove points on the outside of lane by using vector map link
vector_map_inside_area_filter remove points inside of vector map area that has given type by parameter 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

pointcloud_preprocessor::Filter is implemented based on pcl_perception [1] because of this issue.

(Optional) Error detection and handling

(Optional) Performance characterization

[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp

(Optional) Future extensions / Unimplemented parts

CHANGELOG
No CHANGELOG found.

Launch files

  • launch/blockage_diag.launch.xml
      • input_topic_name [default: pointcloud_raw_ex]
      • output_topic_name [default: blockage_diag/pointcloud]
  • launch/dual_return_outlier_filter.launch.xml
      • input_topic_name [default: /velodyne_points_ex]
      • output_topic_name [default: /pointcloud_filtered]
      • input_frame [default: velodyne]
      • output_frame [default: velodyne]
      • visibility_threshold [default: 0.95]
      • vertical_bins [default: 128]
      • max_azimuth_diff [default: 50.0]
  • launch/preprocessor.launch.xml
      • input_points_raw_list [default: ['/points_raw']]
      • output_points_raw [default: /points_raw/cropbox/filtered]
      • tf_output_frame [default: base_link]
  • launch/random_downsample_filter.launch.xml
      • input_topic_name [default: /sensing/lidar/top/pointcloud_raw]
      • output_topic_name [default: /sensing/lidar/top/random_downsample_filter/pointcloud]
      • sample_num [default: 1500]
      • input_frame [default: ]
      • output_frame [default: base_link]
  • launch/ring_passthrough_filter.launch.xml
      • input_topic_name [default: /sensing/lidar/top/pointcloud_raw]
      • output_topic_name [default: /sensing/lidar/top/ring_passthrough_filtered/pointcloud]
      • filter_field_name [default: ring]
      • filter_limit_min [default: 0]
      • filter_limit_max [default: 127]
      • filter_limit_negative [default: False]
      • keep_organized [default: False]
      • input_frame [default: ]
      • output_frame [default: base_link]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged pointcloud_preprocessor at Robotics Stack Exchange

No version for distro rolling showing github. Known supported distros are highlighted in the buttons above.
Package symbol

pointcloud_preprocessor package from autoware_car repo

autoware_auto_control_msgs autoware_auto_geometry_msgs autoware_auto_mapping_msgs autoware_auto_perception_msgs autoware_auto_planning_msgs autoware_auto_vehicle_msgs autoware_launch ekf_localizer gyro_odometer initial_pose_button_panel localization_error_monitor ndt_scan_matcher pose2twist pose_initializer stop_filter twist2accel autoware_adapi_v1_msgs autoware_cmake autoware_utils lanelet2_extension autoware_common_msgs autoware_planning_msgs autoware_ad_api_specs autoware_point_types interpolation kalman_filter motion_utils signal_processing tier4_autoware_utils component_interface_specs component_interface_utils ndt_omp tier4_control_msgs tier4_debug_msgs tier4_localization_msgs tier4_system_msgs tier4_localization_launch tier4_map_launch tier4_simulator_launch tier4_system_launch tier4_vehicle_launch pointcloud_preprocessor tier4_pcl_extensions vehicle_velocity_converter automatic_pose_initializer map_height_fitter map_loader map_tf_generator autoware_lint_common autoware_map_msgs tier4_external_api_msgs lanelet2_map_preprocessor autoware_slam autoware_gazebo autoware_gazebo_individual_params autoware_gazebo_launch autoware_gazebo_utils autoware_webots autoware_webots_individual_params autoware_webots_launch autoware_webots_utils robot webots_ros2_driver webots_ros2_msgs cartographer cartographer_ros cartographer_ros_msgs cartographer_rviz dolly dolly_follow dolly_gazebo dolly_ignition ndt_omp_ros2 graph_based_slam lidarslam lidarslam_msgs scanmatcher lio_sam pcl_localization_ros2 velodyne_description velodyne_gazebo_plugins velodyne_simulator

ROS Distro
github

Package Summary

Tags No category tags.
Version 0.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Description
Checkout URI https://github.com/qin-yuan/autoware_car.git
VCS Type git
VCS Version master
Last Updated 2024-12-19
Dev Status UNKNOWN
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

The ROS2 pointcloud_preprocessor package

Additional Links

No additional links.

Maintainers

  • amc-nu
  • Yukihiro Saito
  • Shunsuke Miura

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall

pointcloud_preprocessor

Purpose

The pointcloud_preprocessor is a package that includes the following filters:

  • removing outlier points
  • cropping
  • concatenating pointclouds
  • correcting distortion
  • downsampling

Inner-workings / Algorithms

Detail description of each filter’s algorithm is in the following links.

Filter Name Description Detail
concatenate_data subscribe multiple pointclouds and concatenate them into a pointcloud link
crop_box_filter remove points within a given box link
distortion_corrector compensate pointcloud distortion caused by ego vehicle’s movement during 1 scan link
downsample_filter downsampling input pointcloud link
outlier_filter remove points caused by hardware problems, rain drops and small insects as a noise link
passthrough_filter remove points on the outside of a range in given field (e.g. x, y, z, intensity) link
pointcloud_accumulator accumulate pointclouds for a given amount of time link
vector_map_filter remove points on the outside of lane by using vector map link
vector_map_inside_area_filter remove points inside of vector map area that has given type by parameter 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

pointcloud_preprocessor::Filter is implemented based on pcl_perception [1] because of this issue.

(Optional) Error detection and handling

(Optional) Performance characterization

[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp

(Optional) Future extensions / Unimplemented parts

CHANGELOG
No CHANGELOG found.

Launch files

  • launch/blockage_diag.launch.xml
      • input_topic_name [default: pointcloud_raw_ex]
      • output_topic_name [default: blockage_diag/pointcloud]
  • launch/dual_return_outlier_filter.launch.xml
      • input_topic_name [default: /velodyne_points_ex]
      • output_topic_name [default: /pointcloud_filtered]
      • input_frame [default: velodyne]
      • output_frame [default: velodyne]
      • visibility_threshold [default: 0.95]
      • vertical_bins [default: 128]
      • max_azimuth_diff [default: 50.0]
  • launch/preprocessor.launch.xml
      • input_points_raw_list [default: ['/points_raw']]
      • output_points_raw [default: /points_raw/cropbox/filtered]
      • tf_output_frame [default: base_link]
  • launch/random_downsample_filter.launch.xml
      • input_topic_name [default: /sensing/lidar/top/pointcloud_raw]
      • output_topic_name [default: /sensing/lidar/top/random_downsample_filter/pointcloud]
      • sample_num [default: 1500]
      • input_frame [default: ]
      • output_frame [default: base_link]
  • launch/ring_passthrough_filter.launch.xml
      • input_topic_name [default: /sensing/lidar/top/pointcloud_raw]
      • output_topic_name [default: /sensing/lidar/top/ring_passthrough_filtered/pointcloud]
      • filter_field_name [default: ring]
      • filter_limit_min [default: 0]
      • filter_limit_max [default: 127]
      • filter_limit_negative [default: False]
      • keep_organized [default: False]
      • input_frame [default: ]
      • output_frame [default: base_link]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged pointcloud_preprocessor at Robotics Stack Exchange

Package symbol

pointcloud_preprocessor package from autoware_car repo

autoware_auto_control_msgs autoware_auto_geometry_msgs autoware_auto_mapping_msgs autoware_auto_perception_msgs autoware_auto_planning_msgs autoware_auto_vehicle_msgs autoware_launch ekf_localizer gyro_odometer initial_pose_button_panel localization_error_monitor ndt_scan_matcher pose2twist pose_initializer stop_filter twist2accel autoware_adapi_v1_msgs autoware_cmake autoware_utils lanelet2_extension autoware_common_msgs autoware_planning_msgs autoware_ad_api_specs autoware_point_types interpolation kalman_filter motion_utils signal_processing tier4_autoware_utils component_interface_specs component_interface_utils ndt_omp tier4_control_msgs tier4_debug_msgs tier4_localization_msgs tier4_system_msgs tier4_localization_launch tier4_map_launch tier4_simulator_launch tier4_system_launch tier4_vehicle_launch pointcloud_preprocessor tier4_pcl_extensions vehicle_velocity_converter automatic_pose_initializer map_height_fitter map_loader map_tf_generator autoware_lint_common autoware_map_msgs tier4_external_api_msgs lanelet2_map_preprocessor autoware_slam autoware_gazebo autoware_gazebo_individual_params autoware_gazebo_launch autoware_gazebo_utils autoware_webots autoware_webots_individual_params autoware_webots_launch autoware_webots_utils robot webots_ros2_driver webots_ros2_msgs cartographer cartographer_ros cartographer_ros_msgs cartographer_rviz dolly dolly_follow dolly_gazebo dolly_ignition ndt_omp_ros2 graph_based_slam lidarslam lidarslam_msgs scanmatcher lio_sam pcl_localization_ros2 velodyne_description velodyne_gazebo_plugins velodyne_simulator

ROS Distro
github

Package Summary

Tags No category tags.
Version 0.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Description
Checkout URI https://github.com/qin-yuan/autoware_car.git
VCS Type git
VCS Version master
Last Updated 2024-12-19
Dev Status UNKNOWN
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

The ROS2 pointcloud_preprocessor package

Additional Links

No additional links.

Maintainers

  • amc-nu
  • Yukihiro Saito
  • Shunsuke Miura

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall

pointcloud_preprocessor

Purpose

The pointcloud_preprocessor is a package that includes the following filters:

  • removing outlier points
  • cropping
  • concatenating pointclouds
  • correcting distortion
  • downsampling

Inner-workings / Algorithms

Detail description of each filter’s algorithm is in the following links.

Filter Name Description Detail
concatenate_data subscribe multiple pointclouds and concatenate them into a pointcloud link
crop_box_filter remove points within a given box link
distortion_corrector compensate pointcloud distortion caused by ego vehicle’s movement during 1 scan link
downsample_filter downsampling input pointcloud link
outlier_filter remove points caused by hardware problems, rain drops and small insects as a noise link
passthrough_filter remove points on the outside of a range in given field (e.g. x, y, z, intensity) link
pointcloud_accumulator accumulate pointclouds for a given amount of time link
vector_map_filter remove points on the outside of lane by using vector map link
vector_map_inside_area_filter remove points inside of vector map area that has given type by parameter 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

pointcloud_preprocessor::Filter is implemented based on pcl_perception [1] because of this issue.

(Optional) Error detection and handling

(Optional) Performance characterization

[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp

(Optional) Future extensions / Unimplemented parts

CHANGELOG
No CHANGELOG found.

Launch files

  • launch/blockage_diag.launch.xml
      • input_topic_name [default: pointcloud_raw_ex]
      • output_topic_name [default: blockage_diag/pointcloud]
  • launch/dual_return_outlier_filter.launch.xml
      • input_topic_name [default: /velodyne_points_ex]
      • output_topic_name [default: /pointcloud_filtered]
      • input_frame [default: velodyne]
      • output_frame [default: velodyne]
      • visibility_threshold [default: 0.95]
      • vertical_bins [default: 128]
      • max_azimuth_diff [default: 50.0]
  • launch/preprocessor.launch.xml
      • input_points_raw_list [default: ['/points_raw']]
      • output_points_raw [default: /points_raw/cropbox/filtered]
      • tf_output_frame [default: base_link]
  • launch/random_downsample_filter.launch.xml
      • input_topic_name [default: /sensing/lidar/top/pointcloud_raw]
      • output_topic_name [default: /sensing/lidar/top/random_downsample_filter/pointcloud]
      • sample_num [default: 1500]
      • input_frame [default: ]
      • output_frame [default: base_link]
  • launch/ring_passthrough_filter.launch.xml
      • input_topic_name [default: /sensing/lidar/top/pointcloud_raw]
      • output_topic_name [default: /sensing/lidar/top/ring_passthrough_filtered/pointcloud]
      • filter_field_name [default: ring]
      • filter_limit_min [default: 0]
      • filter_limit_max [default: 127]
      • filter_limit_negative [default: False]
      • keep_organized [default: False]
      • input_frame [default: ]
      • output_frame [default: base_link]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged pointcloud_preprocessor at Robotics Stack Exchange

No version for distro galactic showing github. Known supported distros are highlighted in the buttons above.
Package symbol

pointcloud_preprocessor package from autoware_car repo

autoware_auto_control_msgs autoware_auto_geometry_msgs autoware_auto_mapping_msgs autoware_auto_perception_msgs autoware_auto_planning_msgs autoware_auto_vehicle_msgs autoware_launch ekf_localizer gyro_odometer initial_pose_button_panel localization_error_monitor ndt_scan_matcher pose2twist pose_initializer stop_filter twist2accel autoware_adapi_v1_msgs autoware_cmake autoware_utils lanelet2_extension autoware_common_msgs autoware_planning_msgs autoware_ad_api_specs autoware_point_types interpolation kalman_filter motion_utils signal_processing tier4_autoware_utils component_interface_specs component_interface_utils ndt_omp tier4_control_msgs tier4_debug_msgs tier4_localization_msgs tier4_system_msgs tier4_localization_launch tier4_map_launch tier4_simulator_launch tier4_system_launch tier4_vehicle_launch pointcloud_preprocessor tier4_pcl_extensions vehicle_velocity_converter automatic_pose_initializer map_height_fitter map_loader map_tf_generator autoware_lint_common autoware_map_msgs tier4_external_api_msgs lanelet2_map_preprocessor autoware_slam autoware_gazebo autoware_gazebo_individual_params autoware_gazebo_launch autoware_gazebo_utils autoware_webots autoware_webots_individual_params autoware_webots_launch autoware_webots_utils robot webots_ros2_driver webots_ros2_msgs cartographer cartographer_ros cartographer_ros_msgs cartographer_rviz dolly dolly_follow dolly_gazebo dolly_ignition ndt_omp_ros2 graph_based_slam lidarslam lidarslam_msgs scanmatcher lio_sam pcl_localization_ros2 velodyne_description velodyne_gazebo_plugins velodyne_simulator

ROS Distro
github

Package Summary

Tags No category tags.
Version 0.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Description
Checkout URI https://github.com/qin-yuan/autoware_car.git
VCS Type git
VCS Version master
Last Updated 2024-12-19
Dev Status UNKNOWN
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

The ROS2 pointcloud_preprocessor package

Additional Links

No additional links.

Maintainers

  • amc-nu
  • Yukihiro Saito
  • Shunsuke Miura

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall

pointcloud_preprocessor

Purpose

The pointcloud_preprocessor is a package that includes the following filters:

  • removing outlier points
  • cropping
  • concatenating pointclouds
  • correcting distortion
  • downsampling

Inner-workings / Algorithms

Detail description of each filter’s algorithm is in the following links.

Filter Name Description Detail
concatenate_data subscribe multiple pointclouds and concatenate them into a pointcloud link
crop_box_filter remove points within a given box link
distortion_corrector compensate pointcloud distortion caused by ego vehicle’s movement during 1 scan link
downsample_filter downsampling input pointcloud link
outlier_filter remove points caused by hardware problems, rain drops and small insects as a noise link
passthrough_filter remove points on the outside of a range in given field (e.g. x, y, z, intensity) link
pointcloud_accumulator accumulate pointclouds for a given amount of time link
vector_map_filter remove points on the outside of lane by using vector map link
vector_map_inside_area_filter remove points inside of vector map area that has given type by parameter 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

pointcloud_preprocessor::Filter is implemented based on pcl_perception [1] because of this issue.

(Optional) Error detection and handling

(Optional) Performance characterization

[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp

(Optional) Future extensions / Unimplemented parts

CHANGELOG
No CHANGELOG found.

Launch files

  • launch/blockage_diag.launch.xml
      • input_topic_name [default: pointcloud_raw_ex]
      • output_topic_name [default: blockage_diag/pointcloud]
  • launch/dual_return_outlier_filter.launch.xml
      • input_topic_name [default: /velodyne_points_ex]
      • output_topic_name [default: /pointcloud_filtered]
      • input_frame [default: velodyne]
      • output_frame [default: velodyne]
      • visibility_threshold [default: 0.95]
      • vertical_bins [default: 128]
      • max_azimuth_diff [default: 50.0]
  • launch/preprocessor.launch.xml
      • input_points_raw_list [default: ['/points_raw']]
      • output_points_raw [default: /points_raw/cropbox/filtered]
      • tf_output_frame [default: base_link]
  • launch/random_downsample_filter.launch.xml
      • input_topic_name [default: /sensing/lidar/top/pointcloud_raw]
      • output_topic_name [default: /sensing/lidar/top/random_downsample_filter/pointcloud]
      • sample_num [default: 1500]
      • input_frame [default: ]
      • output_frame [default: base_link]
  • launch/ring_passthrough_filter.launch.xml
      • input_topic_name [default: /sensing/lidar/top/pointcloud_raw]
      • output_topic_name [default: /sensing/lidar/top/ring_passthrough_filtered/pointcloud]
      • filter_field_name [default: ring]
      • filter_limit_min [default: 0]
      • filter_limit_max [default: 127]
      • filter_limit_negative [default: False]
      • keep_organized [default: False]
      • input_frame [default: ]
      • output_frame [default: base_link]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged pointcloud_preprocessor at Robotics Stack Exchange

No version for distro iron showing github. Known supported distros are highlighted in the buttons above.
Package symbol

pointcloud_preprocessor package from autoware_car repo

autoware_auto_control_msgs autoware_auto_geometry_msgs autoware_auto_mapping_msgs autoware_auto_perception_msgs autoware_auto_planning_msgs autoware_auto_vehicle_msgs autoware_launch ekf_localizer gyro_odometer initial_pose_button_panel localization_error_monitor ndt_scan_matcher pose2twist pose_initializer stop_filter twist2accel autoware_adapi_v1_msgs autoware_cmake autoware_utils lanelet2_extension autoware_common_msgs autoware_planning_msgs autoware_ad_api_specs autoware_point_types interpolation kalman_filter motion_utils signal_processing tier4_autoware_utils component_interface_specs component_interface_utils ndt_omp tier4_control_msgs tier4_debug_msgs tier4_localization_msgs tier4_system_msgs tier4_localization_launch tier4_map_launch tier4_simulator_launch tier4_system_launch tier4_vehicle_launch pointcloud_preprocessor tier4_pcl_extensions vehicle_velocity_converter automatic_pose_initializer map_height_fitter map_loader map_tf_generator autoware_lint_common autoware_map_msgs tier4_external_api_msgs lanelet2_map_preprocessor autoware_slam autoware_gazebo autoware_gazebo_individual_params autoware_gazebo_launch autoware_gazebo_utils autoware_webots autoware_webots_individual_params autoware_webots_launch autoware_webots_utils robot webots_ros2_driver webots_ros2_msgs cartographer cartographer_ros cartographer_ros_msgs cartographer_rviz dolly dolly_follow dolly_gazebo dolly_ignition ndt_omp_ros2 graph_based_slam lidarslam lidarslam_msgs scanmatcher lio_sam pcl_localization_ros2 velodyne_description velodyne_gazebo_plugins velodyne_simulator

ROS Distro
github

Package Summary

Tags No category tags.
Version 0.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Description
Checkout URI https://github.com/qin-yuan/autoware_car.git
VCS Type git
VCS Version master
Last Updated 2024-12-19
Dev Status UNKNOWN
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

The ROS2 pointcloud_preprocessor package

Additional Links

No additional links.

Maintainers

  • amc-nu
  • Yukihiro Saito
  • Shunsuke Miura

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall

pointcloud_preprocessor

Purpose

The pointcloud_preprocessor is a package that includes the following filters:

  • removing outlier points
  • cropping
  • concatenating pointclouds
  • correcting distortion
  • downsampling

Inner-workings / Algorithms

Detail description of each filter’s algorithm is in the following links.

Filter Name Description Detail
concatenate_data subscribe multiple pointclouds and concatenate them into a pointcloud link
crop_box_filter remove points within a given box link
distortion_corrector compensate pointcloud distortion caused by ego vehicle’s movement during 1 scan link
downsample_filter downsampling input pointcloud link
outlier_filter remove points caused by hardware problems, rain drops and small insects as a noise link
passthrough_filter remove points on the outside of a range in given field (e.g. x, y, z, intensity) link
pointcloud_accumulator accumulate pointclouds for a given amount of time link
vector_map_filter remove points on the outside of lane by using vector map link
vector_map_inside_area_filter remove points inside of vector map area that has given type by parameter 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

pointcloud_preprocessor::Filter is implemented based on pcl_perception [1] because of this issue.

(Optional) Error detection and handling

(Optional) Performance characterization

[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp

(Optional) Future extensions / Unimplemented parts

CHANGELOG
No CHANGELOG found.

Launch files

  • launch/blockage_diag.launch.xml
      • input_topic_name [default: pointcloud_raw_ex]
      • output_topic_name [default: blockage_diag/pointcloud]
  • launch/dual_return_outlier_filter.launch.xml
      • input_topic_name [default: /velodyne_points_ex]
      • output_topic_name [default: /pointcloud_filtered]
      • input_frame [default: velodyne]
      • output_frame [default: velodyne]
      • visibility_threshold [default: 0.95]
      • vertical_bins [default: 128]
      • max_azimuth_diff [default: 50.0]
  • launch/preprocessor.launch.xml
      • input_points_raw_list [default: ['/points_raw']]
      • output_points_raw [default: /points_raw/cropbox/filtered]
      • tf_output_frame [default: base_link]
  • launch/random_downsample_filter.launch.xml
      • input_topic_name [default: /sensing/lidar/top/pointcloud_raw]
      • output_topic_name [default: /sensing/lidar/top/random_downsample_filter/pointcloud]
      • sample_num [default: 1500]
      • input_frame [default: ]
      • output_frame [default: base_link]
  • launch/ring_passthrough_filter.launch.xml
      • input_topic_name [default: /sensing/lidar/top/pointcloud_raw]
      • output_topic_name [default: /sensing/lidar/top/ring_passthrough_filtered/pointcloud]
      • filter_field_name [default: ring]
      • filter_limit_min [default: 0]
      • filter_limit_max [default: 127]
      • filter_limit_negative [default: False]
      • keep_organized [default: False]
      • input_frame [default: ]
      • output_frame [default: base_link]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged pointcloud_preprocessor at Robotics Stack Exchange

No version for distro melodic showing github. Known supported distros are highlighted in the buttons above.
Package symbol

pointcloud_preprocessor package from autoware_car repo

autoware_auto_control_msgs autoware_auto_geometry_msgs autoware_auto_mapping_msgs autoware_auto_perception_msgs autoware_auto_planning_msgs autoware_auto_vehicle_msgs autoware_launch ekf_localizer gyro_odometer initial_pose_button_panel localization_error_monitor ndt_scan_matcher pose2twist pose_initializer stop_filter twist2accel autoware_adapi_v1_msgs autoware_cmake autoware_utils lanelet2_extension autoware_common_msgs autoware_planning_msgs autoware_ad_api_specs autoware_point_types interpolation kalman_filter motion_utils signal_processing tier4_autoware_utils component_interface_specs component_interface_utils ndt_omp tier4_control_msgs tier4_debug_msgs tier4_localization_msgs tier4_system_msgs tier4_localization_launch tier4_map_launch tier4_simulator_launch tier4_system_launch tier4_vehicle_launch pointcloud_preprocessor tier4_pcl_extensions vehicle_velocity_converter automatic_pose_initializer map_height_fitter map_loader map_tf_generator autoware_lint_common autoware_map_msgs tier4_external_api_msgs lanelet2_map_preprocessor autoware_slam autoware_gazebo autoware_gazebo_individual_params autoware_gazebo_launch autoware_gazebo_utils autoware_webots autoware_webots_individual_params autoware_webots_launch autoware_webots_utils robot webots_ros2_driver webots_ros2_msgs cartographer cartographer_ros cartographer_ros_msgs cartographer_rviz dolly dolly_follow dolly_gazebo dolly_ignition ndt_omp_ros2 graph_based_slam lidarslam lidarslam_msgs scanmatcher lio_sam pcl_localization_ros2 velodyne_description velodyne_gazebo_plugins velodyne_simulator

ROS Distro
github

Package Summary

Tags No category tags.
Version 0.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Description
Checkout URI https://github.com/qin-yuan/autoware_car.git
VCS Type git
VCS Version master
Last Updated 2024-12-19
Dev Status UNKNOWN
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

The ROS2 pointcloud_preprocessor package

Additional Links

No additional links.

Maintainers

  • amc-nu
  • Yukihiro Saito
  • Shunsuke Miura

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall

pointcloud_preprocessor

Purpose

The pointcloud_preprocessor is a package that includes the following filters:

  • removing outlier points
  • cropping
  • concatenating pointclouds
  • correcting distortion
  • downsampling

Inner-workings / Algorithms

Detail description of each filter’s algorithm is in the following links.

Filter Name Description Detail
concatenate_data subscribe multiple pointclouds and concatenate them into a pointcloud link
crop_box_filter remove points within a given box link
distortion_corrector compensate pointcloud distortion caused by ego vehicle’s movement during 1 scan link
downsample_filter downsampling input pointcloud link
outlier_filter remove points caused by hardware problems, rain drops and small insects as a noise link
passthrough_filter remove points on the outside of a range in given field (e.g. x, y, z, intensity) link
pointcloud_accumulator accumulate pointclouds for a given amount of time link
vector_map_filter remove points on the outside of lane by using vector map link
vector_map_inside_area_filter remove points inside of vector map area that has given type by parameter 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

pointcloud_preprocessor::Filter is implemented based on pcl_perception [1] because of this issue.

(Optional) Error detection and handling

(Optional) Performance characterization

[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp

(Optional) Future extensions / Unimplemented parts

CHANGELOG
No CHANGELOG found.

Launch files

  • launch/blockage_diag.launch.xml
      • input_topic_name [default: pointcloud_raw_ex]
      • output_topic_name [default: blockage_diag/pointcloud]
  • launch/dual_return_outlier_filter.launch.xml
      • input_topic_name [default: /velodyne_points_ex]
      • output_topic_name [default: /pointcloud_filtered]
      • input_frame [default: velodyne]
      • output_frame [default: velodyne]
      • visibility_threshold [default: 0.95]
      • vertical_bins [default: 128]
      • max_azimuth_diff [default: 50.0]
  • launch/preprocessor.launch.xml
      • input_points_raw_list [default: ['/points_raw']]
      • output_points_raw [default: /points_raw/cropbox/filtered]
      • tf_output_frame [default: base_link]
  • launch/random_downsample_filter.launch.xml
      • input_topic_name [default: /sensing/lidar/top/pointcloud_raw]
      • output_topic_name [default: /sensing/lidar/top/random_downsample_filter/pointcloud]
      • sample_num [default: 1500]
      • input_frame [default: ]
      • output_frame [default: base_link]
  • launch/ring_passthrough_filter.launch.xml
      • input_topic_name [default: /sensing/lidar/top/pointcloud_raw]
      • output_topic_name [default: /sensing/lidar/top/ring_passthrough_filtered/pointcloud]
      • filter_field_name [default: ring]
      • filter_limit_min [default: 0]
      • filter_limit_max [default: 127]
      • filter_limit_negative [default: False]
      • keep_organized [default: False]
      • input_frame [default: ]
      • output_frame [default: base_link]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged pointcloud_preprocessor at Robotics Stack Exchange

No version for distro noetic showing github. Known supported distros are highlighted in the buttons above.
Package symbol

pointcloud_preprocessor package from autoware_car repo

autoware_auto_control_msgs autoware_auto_geometry_msgs autoware_auto_mapping_msgs autoware_auto_perception_msgs autoware_auto_planning_msgs autoware_auto_vehicle_msgs autoware_launch ekf_localizer gyro_odometer initial_pose_button_panel localization_error_monitor ndt_scan_matcher pose2twist pose_initializer stop_filter twist2accel autoware_adapi_v1_msgs autoware_cmake autoware_utils lanelet2_extension autoware_common_msgs autoware_planning_msgs autoware_ad_api_specs autoware_point_types interpolation kalman_filter motion_utils signal_processing tier4_autoware_utils component_interface_specs component_interface_utils ndt_omp tier4_control_msgs tier4_debug_msgs tier4_localization_msgs tier4_system_msgs tier4_localization_launch tier4_map_launch tier4_simulator_launch tier4_system_launch tier4_vehicle_launch pointcloud_preprocessor tier4_pcl_extensions vehicle_velocity_converter automatic_pose_initializer map_height_fitter map_loader map_tf_generator autoware_lint_common autoware_map_msgs tier4_external_api_msgs lanelet2_map_preprocessor autoware_slam autoware_gazebo autoware_gazebo_individual_params autoware_gazebo_launch autoware_gazebo_utils autoware_webots autoware_webots_individual_params autoware_webots_launch autoware_webots_utils robot webots_ros2_driver webots_ros2_msgs cartographer cartographer_ros cartographer_ros_msgs cartographer_rviz dolly dolly_follow dolly_gazebo dolly_ignition ndt_omp_ros2 graph_based_slam lidarslam lidarslam_msgs scanmatcher lio_sam pcl_localization_ros2 velodyne_description velodyne_gazebo_plugins velodyne_simulator

ROS Distro
github

Package Summary

Tags No category tags.
Version 0.1.0
License Apache License 2.0
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Description
Checkout URI https://github.com/qin-yuan/autoware_car.git
VCS Type git
VCS Version master
Last Updated 2024-12-19
Dev Status UNKNOWN
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

The ROS2 pointcloud_preprocessor package

Additional Links

No additional links.

Maintainers

  • amc-nu
  • Yukihiro Saito
  • Shunsuke Miura

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall

pointcloud_preprocessor

Purpose

The pointcloud_preprocessor is a package that includes the following filters:

  • removing outlier points
  • cropping
  • concatenating pointclouds
  • correcting distortion
  • downsampling

Inner-workings / Algorithms

Detail description of each filter’s algorithm is in the following links.

Filter Name Description Detail
concatenate_data subscribe multiple pointclouds and concatenate them into a pointcloud link
crop_box_filter remove points within a given box link
distortion_corrector compensate pointcloud distortion caused by ego vehicle’s movement during 1 scan link
downsample_filter downsampling input pointcloud link
outlier_filter remove points caused by hardware problems, rain drops and small insects as a noise link
passthrough_filter remove points on the outside of a range in given field (e.g. x, y, z, intensity) link
pointcloud_accumulator accumulate pointclouds for a given amount of time link
vector_map_filter remove points on the outside of lane by using vector map link
vector_map_inside_area_filter remove points inside of vector map area that has given type by parameter 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

pointcloud_preprocessor::Filter is implemented based on pcl_perception [1] because of this issue.

(Optional) Error detection and handling

(Optional) Performance characterization

[1] https://github.com/ros-perception/perception_pcl/blob/ros2/pcl_ros/src/pcl_ros/filters/filter.cpp

(Optional) Future extensions / Unimplemented parts

CHANGELOG
No CHANGELOG found.

Launch files

  • launch/blockage_diag.launch.xml
      • input_topic_name [default: pointcloud_raw_ex]
      • output_topic_name [default: blockage_diag/pointcloud]
  • launch/dual_return_outlier_filter.launch.xml
      • input_topic_name [default: /velodyne_points_ex]
      • output_topic_name [default: /pointcloud_filtered]
      • input_frame [default: velodyne]
      • output_frame [default: velodyne]
      • visibility_threshold [default: 0.95]
      • vertical_bins [default: 128]
      • max_azimuth_diff [default: 50.0]
  • launch/preprocessor.launch.xml
      • input_points_raw_list [default: ['/points_raw']]
      • output_points_raw [default: /points_raw/cropbox/filtered]
      • tf_output_frame [default: base_link]
  • launch/random_downsample_filter.launch.xml
      • input_topic_name [default: /sensing/lidar/top/pointcloud_raw]
      • output_topic_name [default: /sensing/lidar/top/random_downsample_filter/pointcloud]
      • sample_num [default: 1500]
      • input_frame [default: ]
      • output_frame [default: base_link]
  • launch/ring_passthrough_filter.launch.xml
      • input_topic_name [default: /sensing/lidar/top/pointcloud_raw]
      • output_topic_name [default: /sensing/lidar/top/ring_passthrough_filtered/pointcloud]
      • filter_field_name [default: ring]
      • filter_limit_min [default: 0]
      • filter_limit_max [default: 127]
      • filter_limit_negative [default: False]
      • keep_organized [default: False]
      • input_frame [default: ]
      • output_frame [default: base_link]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged pointcloud_preprocessor at Robotics Stack Exchange