Package symbol

pcl_ros package from perception_pcl repo

pcl_conversions pcl_ros perception_pcl

ROS Distro
humble

Package Summary

Tags No category tags.
Version 2.4.5
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Description PCL (Point Cloud Library) ROS interface stack
Checkout URI https://github.com/ros-perception/perception_pcl.git
VCS Type git
VCS Version humble
Last Updated 2025-05-29
Dev Status MAINTAINED
Released RELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred bridge for 3D applications involving n-D Point Clouds and 3D geometry processing in ROS.

Additional Links

Maintainers

  • Paul Bovbel
  • Steve Macenski
  • Kentaro Wada

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall
README
No README found. See repository README.
CHANGELOG

Changelog for package pcl_ros

1.6.2 (2018-05-20)

  • Fix exported includes in Ubuntu Artful
  • Increase limits on CropBox filter parameters
  • Contributors: James Ward, Jiri Horner

1.6.1 (2018-05-08)

  • Add 1.6.0 section to CHANGELOG.rst
  • Fix the use of Eigen3 in cmake
  • Contributors: Kentaro Wada

1.6.0 (2018-04-30)

  • Fix build and update maintainers
  • Add message_filters to find_package
  • Remove unnecessary dependency on genmsg
  • Contributors: Paul Bovbel, Kentaro Wada

1.5.4 (2018-03-31)

  • update to use non deprecated pluginlib macro
  • Fix config path of sample_voxel_grid.launch
  • remove hack now that upstream pcl has been rebuilt
  • Looser hzerror in test for extract_clusters to make it pass on Travis
  • Add sample & test for surface/convex_hull
  • Add sample & test for segmentation/extract_clusters.cpp
  • Add sample & test for io/concatenate_data.cpp
  • Add sample & test for features/normal_3d.cpp
  • Organize samples of pcl_ros/features
  • Add test arg to avoid duplicated testing
  • LazyNodelet for features/*
  • LazyNodelet for filters/ProjectInliers
  • Refactor io/PCDReader and io/PCDWriter as child of PCLNodelet
  • LazyNodelet for io/PointCloudConcatenateFieldsSynchronizer
  • LazyNodelet for io/PointCloudConcatenateDataSynchronizer
  • LazyNodelet for segmentation/SegmentDifferences
  • LazyNodelet for segmentation/SACSegmentationFromNormals
  • LazyNodelet for segmentation/SACSegmentation
  • LazyNodelet for segmentation/ExtractPolygonalPrismData
  • LazyNodelet for segmentation/EuclideanClusterExtraction
  • LazyNodelet for surface/MovingLeastSquares
  • LazyNodelet for surface/ConvexHull2D
  • Add missing COMPONENTS of PCL
  • Inherit NodeletLazy for pipeline with less cpu load
  • Set leaf_size 0.02
  • Install samples
  • Add sample and test for pcl/StatisticalOutlierRemoval Conflicts: pcl_ros/CMakeLists.txt
  • Add sample and test for pcl/VoxelGrid Conflicts: pcl_ros/CMakeLists.txt
  • no need to remove duplicates
  • spourious line change
  • remove now unnecessary build_depend on qtbase5
  • exclude PCL IO libraries exporting Qt flag
  • find only PCL components used instead of all PCL
  • Remove dependency on vtk/libproj-dev (#145) * Remove dependency on vtk/libproj-dev These dependencies were introduced in #124 to temporarily fix missing / wrong dependencies in upstream vtk. This hack is no longer necessary, since fixed vtk packages have been uploaded to packages.ros.org (see #124 and ros-infrastructure/reprepro-updater#32).
    • Remove vtk hack from CMakeLists.txt
  • Contributors: Kentaro Wada, Mikael Arguedas

1.5.3 (2017-05-03)

1.5.2 (2017-04-29)

  • Find Qt5Widgets to fix -lQt5::Widgets error
  • Contributors: Kentaro Wada

1.5.1 (2017-04-26)

  • Add my name as a maintainer
  • Contributors: Kentaro Wada

1.5.0 (2017-04-25)

  • Fix lib name duplication error in ubunt:zesty
  • Detect automatically the version of PCL in cmake
  • Install xml files declaring nodelets
  • Fix syntax of nodelet manifest file by splitting files for each library.
  • Contributors: Kentaro Wada

1.4.0 (2016-04-22)

File truncated at 100 lines see the full file

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged pcl_ros at Robotics Stack Exchange

Package symbol

pcl_ros package from perception_pcl repo

pcl_conversions pcl_ros perception_pcl

ROS Distro
jazzy

Package Summary

Tags No category tags.
Version 2.6.2
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Description PCL (Point Cloud Library) ROS interface stack
Checkout URI https://github.com/ros-perception/perception_pcl.git
VCS Type git
VCS Version jazzy
Last Updated 2025-01-22
Dev Status MAINTAINED
Released RELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred bridge for 3D applications involving n-D Point Clouds and 3D geometry processing in ROS.

Additional Links

Maintainers

  • Paul Bovbel
  • Steve Macenski
  • Kentaro Wada

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall
README
No README found. See repository README.
CHANGELOG

Changelog for package pcl_ros

2.6.2 (2024-11-07)

  • Fix handling of empty input point cloud in computePublish method (#467)
  • point_cloud.hpp ros2 types fixed (#425)
  • Fix [Could NOT find Boost (missing: Boost_INCLUDE_DIR)]{.title-ref} (#452)
  • Fix ament_cpplint
  • Fix ament_lint_cmake
  • Switch to build_export_depend for libpcl-all-dev (#447)
  • porting pointcoud_to_pcd to ros2 (#444)
  • Contributors: Ar-Ray, Balint Rozgonyi, Ramon Wijnands, ShepelIlya, Yadu

1.6.2 (2018-05-20)

  • Fix exported includes in Ubuntu Artful
  • Increase limits on CropBox filter parameters
  • Contributors: James Ward, Jiri Horner

1.6.1 (2018-05-08)

  • Add 1.6.0 section to CHANGELOG.rst
  • Fix the use of Eigen3 in cmake
  • Contributors: Kentaro Wada

1.6.0 (2018-04-30)

  • Fix build and update maintainers
  • Add message_filters to find_package
  • Remove unnecessary dependency on genmsg
  • Contributors: Paul Bovbel, Kentaro Wada

1.5.4 (2018-03-31)

  • update to use non deprecated pluginlib macro
  • Fix config path of sample_voxel_grid.launch
  • remove hack now that upstream pcl has been rebuilt
  • Looser hzerror in test for extract_clusters to make it pass on Travis
  • Add sample & test for surface/convex_hull
  • Add sample & test for segmentation/extract_clusters.cpp
  • Add sample & test for io/concatenate_data.cpp
  • Add sample & test for features/normal_3d.cpp
  • Organize samples of pcl_ros/features
  • Add test arg to avoid duplicated testing
  • LazyNodelet for features/*
  • LazyNodelet for filters/ProjectInliers
  • Refactor io/PCDReader and io/PCDWriter as child of PCLNodelet
  • LazyNodelet for io/PointCloudConcatenateFieldsSynchronizer
  • LazyNodelet for io/PointCloudConcatenateDataSynchronizer
  • LazyNodelet for segmentation/SegmentDifferences
  • LazyNodelet for segmentation/SACSegmentationFromNormals
  • LazyNodelet for segmentation/SACSegmentation
  • LazyNodelet for segmentation/ExtractPolygonalPrismData
  • LazyNodelet for segmentation/EuclideanClusterExtraction
  • LazyNodelet for surface/MovingLeastSquares
  • LazyNodelet for surface/ConvexHull2D
  • Add missing COMPONENTS of PCL
  • Inherit NodeletLazy for pipeline with less cpu load
  • Set leaf_size 0.02
  • Install samples
  • Add sample and test for pcl/StatisticalOutlierRemoval Conflicts: pcl_ros/CMakeLists.txt
  • Add sample and test for pcl/VoxelGrid Conflicts: pcl_ros/CMakeLists.txt
  • no need to remove duplicates
  • spourious line change
  • remove now unnecessary build_depend on qtbase5
  • exclude PCL IO libraries exporting Qt flag
  • find only PCL components used instead of all PCL
  • Remove dependency on vtk/libproj-dev (#145) * Remove dependency on vtk/libproj-dev These dependencies were introduced in #124 to temporarily fix missing / wrong dependencies in upstream vtk. This hack is no longer necessary, since fixed vtk packages have been uploaded to packages.ros.org (see #124 and ros-infrastructure/reprepro-updater#32).
    • Remove vtk hack from CMakeLists.txt
  • Contributors: Kentaro Wada, Mikael Arguedas

1.5.3 (2017-05-03)

1.5.2 (2017-04-29)

  • Find Qt5Widgets to fix -lQt5::Widgets error

File truncated at 100 lines see the full file

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged pcl_ros at Robotics Stack Exchange

Package symbol

pcl_ros package from perception_pcl repo

pcl_conversions pcl_ros perception_pcl

ROS Distro
kilted

Package Summary

Tags No category tags.
Version 2.7.3
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Description PCL (Point Cloud Library) ROS interface stack
Checkout URI https://github.com/ros-perception/perception_pcl.git
VCS Type git
VCS Version ros2
Last Updated 2025-08-28
Dev Status MAINTAINED
Released RELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred bridge for 3D applications involving n-D Point Clouds and 3D geometry processing in ROS.

Additional Links

Maintainers

  • Paul Bovbel
  • Steve Macenski
  • Kentaro Wada

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall
README
No README found. See repository README.
CHANGELOG

Changelog for package pcl_ros

2.7.3 (2025-06-05)

  • Fix ament_export_dependencies (#500)
  • Contributors: Thomas Emter

2.7.2 (2025-05-23)

  • Remove calls to [ament_target_dependencies]{.title-ref} (#498)
  • Contributors: Ramon Wijnands

2.7.1 (2025-05-16)

  • Fix warning: 'subscribe<>' is deprecated: use rclcpp::QoS (#497)
  • Bump minimum cmake version to 3.20 (#496)
  • Contributors: Ramon Wijnands

2.7.0 (2025-05-15)

  • Fix downstream CMake error: rosbag2_transport not found (#494)
  • Port bag_to_pcd to ROS 2 (#486)
  • Add CombinedPointCloudToPCD Node for Accumulating Multiple Point Clouds into a Single PCD (#479)
  • Fix deprecation of .h files in message_filters (#493)
  • Improve pointcloud_to_pcd by keeping all field available in sensor_msgs (#491)
  • Added crop box marker publisher (#488)
  • Properly order the header includes for cpplint (#490)
  • Contributors: Adraub, Alireza Moayyedi, Ramon Wijnands, Tim Clephas, Valerio Passamano, vladimirjendrol

2.6.3 (2025-04-07)

  • Fix pcd timestamp format output in pointcloud_to_pcd (#481)
  • Split off pcl_ros_filter into separate library (#480)
  • Add lazy feature to ros2 branch (#477)
  • Deprecating tf2 C Headers (#469)
  • Contributors: Adraub, BÅ‚ażej Sowa, Lucas Wendland, Paul Bovbel, Tatsuro Sakaguchi

2.6.2 (2024-11-07)

  • Fix handling of empty input point cloud in computePublish method (#467)
  • point_cloud.hpp ros2 types fixed (#425)
  • Fix [Could NOT find Boost (missing: Boost_INCLUDE_DIR)]{.title-ref} (#452)
  • Fix ament_cpplint
  • Fix ament_lint_cmake
  • Switch to build_export_depend for libpcl-all-dev (#447)
  • porting pointcoud_to_pcd to ros2 (#444)
  • Contributors: Ar-Ray, Balint Rozgonyi, Ramon Wijnands, ShepelIlya, Yadu

1.6.2 (2018-05-20)

  • Fix exported includes in Ubuntu Artful
  • Increase limits on CropBox filter parameters
  • Contributors: James Ward, Jiri Horner

1.6.1 (2018-05-08)

  • Add 1.6.0 section to CHANGELOG.rst
  • Fix the use of Eigen3 in cmake
  • Contributors: Kentaro Wada

1.6.0 (2018-04-30)

  • Fix build and update maintainers
  • Add message_filters to find_package
  • Remove unnecessary dependency on genmsg
  • Contributors: Paul Bovbel, Kentaro Wada

1.5.4 (2018-03-31)

  • update to use non deprecated pluginlib macro
  • Fix config path of sample_voxel_grid.launch
  • remove hack now that upstream pcl has been rebuilt
  • Looser hzerror in test for extract_clusters to make it pass on Travis
  • Add sample & test for surface/convex_hull

File truncated at 100 lines see the full file

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged pcl_ros at Robotics Stack Exchange

Package symbol

pcl_ros package from perception_pcl repo

pcl_conversions pcl_ros perception_pcl

ROS Distro
rolling

Package Summary

Tags No category tags.
Version 2.7.3
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Description PCL (Point Cloud Library) ROS interface stack
Checkout URI https://github.com/ros-perception/perception_pcl.git
VCS Type git
VCS Version ros2
Last Updated 2025-08-28
Dev Status MAINTAINED
Released RELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred bridge for 3D applications involving n-D Point Clouds and 3D geometry processing in ROS.

Additional Links

Maintainers

  • Paul Bovbel
  • Steve Macenski
  • Kentaro Wada

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall
README
No README found. See repository README.
CHANGELOG

Changelog for package pcl_ros

2.7.3 (2025-06-05)

  • Fix ament_export_dependencies (#500)
  • Contributors: Thomas Emter

2.7.2 (2025-05-23)

  • Remove calls to [ament_target_dependencies]{.title-ref} (#498)
  • Contributors: Ramon Wijnands

2.7.1 (2025-05-16)

  • Fix warning: 'subscribe<>' is deprecated: use rclcpp::QoS (#497)
  • Bump minimum cmake version to 3.20 (#496)
  • Contributors: Ramon Wijnands

2.7.0 (2025-05-15)

  • Fix downstream CMake error: rosbag2_transport not found (#494)
  • Port bag_to_pcd to ROS 2 (#486)
  • Add CombinedPointCloudToPCD Node for Accumulating Multiple Point Clouds into a Single PCD (#479)
  • Fix deprecation of .h files in message_filters (#493)
  • Improve pointcloud_to_pcd by keeping all field available in sensor_msgs (#491)
  • Added crop box marker publisher (#488)
  • Properly order the header includes for cpplint (#490)
  • Contributors: Adraub, Alireza Moayyedi, Ramon Wijnands, Tim Clephas, Valerio Passamano, vladimirjendrol

2.6.3 (2025-04-07)

  • Fix pcd timestamp format output in pointcloud_to_pcd (#481)
  • Split off pcl_ros_filter into separate library (#480)
  • Add lazy feature to ros2 branch (#477)
  • Deprecating tf2 C Headers (#469)
  • Contributors: Adraub, BÅ‚ażej Sowa, Lucas Wendland, Paul Bovbel, Tatsuro Sakaguchi

2.6.2 (2024-11-07)

  • Fix handling of empty input point cloud in computePublish method (#467)
  • point_cloud.hpp ros2 types fixed (#425)
  • Fix [Could NOT find Boost (missing: Boost_INCLUDE_DIR)]{.title-ref} (#452)
  • Fix ament_cpplint
  • Fix ament_lint_cmake
  • Switch to build_export_depend for libpcl-all-dev (#447)
  • porting pointcoud_to_pcd to ros2 (#444)
  • Contributors: Ar-Ray, Balint Rozgonyi, Ramon Wijnands, ShepelIlya, Yadu

1.6.2 (2018-05-20)

  • Fix exported includes in Ubuntu Artful
  • Increase limits on CropBox filter parameters
  • Contributors: James Ward, Jiri Horner

1.6.1 (2018-05-08)

  • Add 1.6.0 section to CHANGELOG.rst
  • Fix the use of Eigen3 in cmake
  • Contributors: Kentaro Wada

1.6.0 (2018-04-30)

  • Fix build and update maintainers
  • Add message_filters to find_package
  • Remove unnecessary dependency on genmsg
  • Contributors: Paul Bovbel, Kentaro Wada

1.5.4 (2018-03-31)

  • update to use non deprecated pluginlib macro
  • Fix config path of sample_voxel_grid.launch
  • remove hack now that upstream pcl has been rebuilt
  • Looser hzerror in test for extract_clusters to make it pass on Travis
  • Add sample & test for surface/convex_hull

File truncated at 100 lines see the full file

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged pcl_ros at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 2.6.1
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Description Learn OpenCV : C++ and Python Examples
Checkout URI https://github.com/spmallick/learnopencv.git
VCS Type git
VCS Version master
Last Updated 2025-10-22
Dev Status UNKNOWN
Released UNRELEASED
Tags opencv machine-learning deep-neural-networks ai computer-vision deep-learning deeplearning opencv-library opencv-python computervision opencv3 opencv-tutorial opencv-cpp
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred bridge for 3D applications involving n-D Point Clouds and 3D geometry processing in ROS.

Additional Links

Maintainers

  • Paul Bovbel
  • Steve Macenski
  • Kentaro Wada

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall
README
No README found. See repository README.
CHANGELOG

Changelog for package pcl_ros

1.6.2 (2018-05-20)

  • Fix exported includes in Ubuntu Artful
  • Increase limits on CropBox filter parameters
  • Contributors: James Ward, Jiri Horner

1.6.1 (2018-05-08)

  • Add 1.6.0 section to CHANGELOG.rst
  • Fix the use of Eigen3 in cmake
  • Contributors: Kentaro Wada

1.6.0 (2018-04-30)

  • Fix build and update maintainers
  • Add message_filters to find_package
  • Remove unnecessary dependency on genmsg
  • Contributors: Paul Bovbel, Kentaro Wada

1.5.4 (2018-03-31)

  • update to use non deprecated pluginlib macro
  • Fix config path of sample_voxel_grid.launch
  • remove hack now that upstream pcl has been rebuilt
  • Looser hzerror in test for extract_clusters to make it pass on Travis
  • Add sample & test for surface/convex_hull
  • Add sample & test for segmentation/extract_clusters.cpp
  • Add sample & test for io/concatenate_data.cpp
  • Add sample & test for features/normal_3d.cpp
  • Organize samples of pcl_ros/features
  • Add test arg to avoid duplicated testing
  • LazyNodelet for features/*
  • LazyNodelet for filters/ProjectInliers
  • Refactor io/PCDReader and io/PCDWriter as child of PCLNodelet
  • LazyNodelet for io/PointCloudConcatenateFieldsSynchronizer
  • LazyNodelet for io/PointCloudConcatenateDataSynchronizer
  • LazyNodelet for segmentation/SegmentDifferences
  • LazyNodelet for segmentation/SACSegmentationFromNormals
  • LazyNodelet for segmentation/SACSegmentation
  • LazyNodelet for segmentation/ExtractPolygonalPrismData
  • LazyNodelet for segmentation/EuclideanClusterExtraction
  • LazyNodelet for surface/MovingLeastSquares
  • LazyNodelet for surface/ConvexHull2D
  • Add missing COMPONENTS of PCL
  • Inherit NodeletLazy for pipeline with less cpu load
  • Set leaf_size 0.02
  • Install samples
  • Add sample and test for pcl/StatisticalOutlierRemoval Conflicts: pcl_ros/CMakeLists.txt
  • Add sample and test for pcl/VoxelGrid Conflicts: pcl_ros/CMakeLists.txt
  • no need to remove duplicates
  • spourious line change
  • remove now unnecessary build_depend on qtbase5
  • exclude PCL IO libraries exporting Qt flag
  • find only PCL components used instead of all PCL
  • Remove dependency on vtk/libproj-dev (#145) * Remove dependency on vtk/libproj-dev These dependencies were introduced in #124 to temporarily fix missing / wrong dependencies in upstream vtk. This hack is no longer necessary, since fixed vtk packages have been uploaded to packages.ros.org (see #124 and ros-infrastructure/reprepro-updater#32).
    • Remove vtk hack from CMakeLists.txt
  • Contributors: Kentaro Wada, Mikael Arguedas

1.5.3 (2017-05-03)

1.5.2 (2017-04-29)

  • Find Qt5Widgets to fix -lQt5::Widgets error
  • Contributors: Kentaro Wada

1.5.1 (2017-04-26)

  • Add my name as a maintainer
  • Contributors: Kentaro Wada

1.5.0 (2017-04-25)

  • Fix lib name duplication error in ubunt:zesty
  • Detect automatically the version of PCL in cmake
  • Install xml files declaring nodelets
  • Fix syntax of nodelet manifest file by splitting files for each library.
  • Contributors: Kentaro Wada

1.4.0 (2016-04-22)

File truncated at 100 lines see the full file

Dependant Packages

Name Deps
radar_odom
lidar_detection
pointcloud_ogm
map_loader
map_loader
map_tf_generator
map_tf_generator
lanelet2_map_preprocessor
lanelet2_map_preprocessor
dummy_perception_publisher
obstacle_stop_planner_custom
airship_localization
grid_map_pcl
grid_map_sdf
perception_pcl
perception_pcl
perception_pcl
perception_pcl
apriltag_localization_simulations
pcl_recorder
autonomous_emergency_braking
obstacle_collision_checker
front_vehicle_velocity_estimator
ground_segmentation
image_projection_based_fusion
lidar_centerpoint
lidar_centerpoint_tvm
occupancy_grid_map_outlier_filter
probabilistic_occupancy_grid_map
costmap_generator
costmap_generator
obstacle_stop_planner
obstacle_velocity_limiter
pointcloud_preprocessor
pointcloud_preprocessor
radar_scan_to_pointcloud2
autoware_point_types
autoware_point_types
autoware_point_types
object_recognition_utils
tier4_autoware_utils
ndt_omp
ndt_omp
ndt_omp
ndt_omp
ndt_omp
lidar_centerpoint_collect
direct_visual_lidar_calibration
multi_lidar_calibration
multi_lidar_calibration
perception
local_planner
local_planner
local_planner
local_planner
sensor_scan_generation
sensor_scan_generation
sensor_scan_generation
sensor_scan_generation
terrain_analysis
terrain_analysis
terrain_analysis
terrain_analysis
terrain_analysis
terrain_analysis_ext
terrain_analysis_ext
terrain_analysis_ext
terrain_analysis_ext
terrain_analysis_ext
vehicle_simulator
vehicle_simulator
vehicle_simulator
visualization_tools
visualization_tools
visualization_tools
waypoint_example
waypoint_example
waypoint_example
tare_planner
tare_planner
far_planner
far_planner
far_planner
far_planner
point_lio_unilidar
carla_pointcloud
carla_pointcloud
autoware_object_recognition_utils
autoware_ground_filter
map_file
object_map
op_ros_helpers
tvm_utility
imm_ukf_pda_track
lidar_apollo_cnn_seg_detect
lidar_euclidean_cluster_detect
lidar_fake_perception
lidar_localizer
lidar_naive_l_shape_detect
lidar_point_pillars
lidar_shape_estimation
pixel_cloud_fusion
points_downsampler
points_preprocessor
road_occupancy_processor
astar_search
dp_planner
lattice_planner
op_global_planner
op_local_planner
op_simulation_package
way_planner
waypoint_planner
autoware_camera_lidar_calibrator
data_preprocessor
kitti_player
map_tools
multi_lidar_calibrator
oculus_socket
detected_objects_visualizer
points2image
sick_ldmrs_tools
autoware_universe_utils
autoware_autonomous_emergency_braking
autoware_obstacle_collision_checker
autoware_lidar_marker_localizer
autoware_bevfusion
autoware_ground_segmentation
autoware_lidar_centerpoint
autoware_lidar_frnet
autoware_lidar_transfusion
autoware_occupancy_grid_map_outlier_filter
autoware_probabilistic_occupancy_grid_map
autoware_raindrop_cluster_filter
autoware_costmap_generator
autoware_motion_velocity_obstacle_velocity_limiter_module
autoware_calibration_status_classifier
autoware_pointcloud_preprocessor
reaction_analyzer
botanbot_gazebo
ground_plane_calibrator
lidar_to_lidar_2d_calibrator
mapping_based_calibrator
marker_radar_lidar_calibrator
tag_based_pnp_calibrator
tag_based_sfm_calibrator
point_cloud_accumulator
tier4_ground_plane_utils
lidar_to_grid
centerpoint
costmap_depth_camera
point_cloud
fast_lio
fast_lio
fast_lio
fast_lio
fast_lio
point_lio
point_lio
linefit_ground_segmentation
linefit_ground_segmentation
linefit_ground_segmentation
degeneracy_detection
genmos_object_search_ros
lidar_processor_cpp
livox_ros_driver
cam_laser_calib
pcl_tutorials
lidar_obstacle_detection
hdl_global_localization
hdl_global_localization
hdl_localization
hdl_localization
icp_localization_ros2
local_3d_planner
navigation_features_3d
pcl_filters
lesson_perception
lesson_perception
py_perception
pick_and_place_perception
collision_avoidance_pick_and_place
collision_avoidance_pick_and_place
pick_and_place_application
kalman_arch
lidar_cluster
graph_based_slam
lidar_graph_slam_utils
lidar_scan_matcher
points_prefiltering
base_local_planner
costmap_2d
navfn
localization_common
scan_context
ti_mmwave_ros2_pkg
base_placement_plugin
map_creator
rsd
tms_ss_xtion
ma2010_server
multiple_object_tracking_lidar
ground_seg
occupancy_cpp
octomap_server
octomap_server
openbot_ros
map_generator
quad_utils
loam_interface
pcd2pgm
pcd2pgm
person_tracking
multi_object_tracking_lidar
race
pointcloud_to_grid
pylon_ros2_camera_component
ground_plane_segmenter
region_detection_roscpp_demo
point_lio_cxr
remove_pointcloud
interbotix_perception_modules
interbotix_perception_pipelines
data_parameters
pcl_object_detection
rosbag2_to_pcd
boundary_handler
graph_decoder
fast_gicp
faster_lio
obstacle_generater
pointcloud_repub
sloam
sloam
object_modeller
stretch_octomap
stretch_web_teleop
okvis_ros
pose_graph
velodyne_pcl
capturedata
dtv2_tactile_camera
challenge_restaurant
dll
ur_robotiq_moveit_api
vox_nav_control
vox_nav_map_server
vox_nav_misc
vox_nav_utilities
vtr_lidar
vtr_radar
vtr_radar_lidar
occupancy_segmentation

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged pcl_ros at Robotics Stack Exchange

Package symbol

pcl_ros package from perception_pcl repo

pcl_conversions pcl_ros perception_pcl

ROS Distro
galactic

Package Summary

Tags No category tags.
Version 2.2.1
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Description PCL (Point Cloud Library) ROS interface stack
Checkout URI https://github.com/ros-perception/perception_pcl.git
VCS Type git
VCS Version foxy-devel
Last Updated 2021-09-14
Dev Status MAINTAINED
Released RELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred bridge for 3D applications involving n-D Point Clouds and 3D geometry processing in ROS.

Additional Links

Maintainers

  • Paul Bovbel
  • Steve Macenski
  • Kentaro Wada

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall
README
No README found. See repository README.
CHANGELOG

Changelog for package pcl_ros

1.6.2 (2018-05-20)

  • Fix exported includes in Ubuntu Artful
  • Increase limits on CropBox filter parameters
  • Contributors: James Ward, Jiri Horner

1.6.1 (2018-05-08)

  • Add 1.6.0 section to CHANGELOG.rst
  • Fix the use of Eigen3 in cmake
  • Contributors: Kentaro Wada

1.6.0 (2018-04-30)

  • Fix build and update maintainers
  • Add message_filters to find_package
  • Remove unnecessary dependency on genmsg
  • Contributors: Paul Bovbel, Kentaro Wada

1.5.4 (2018-03-31)

  • update to use non deprecated pluginlib macro
  • Fix config path of sample_voxel_grid.launch
  • remove hack now that upstream pcl has been rebuilt
  • Looser hzerror in test for extract_clusters to make it pass on Travis
  • Add sample & test for surface/convex_hull
  • Add sample & test for segmentation/extract_clusters.cpp
  • Add sample & test for io/concatenate_data.cpp
  • Add sample & test for features/normal_3d.cpp
  • Organize samples of pcl_ros/features
  • Add test arg to avoid duplicated testing
  • LazyNodelet for features/*
  • LazyNodelet for filters/ProjectInliers
  • Refactor io/PCDReader and io/PCDWriter as child of PCLNodelet
  • LazyNodelet for io/PointCloudConcatenateFieldsSynchronizer
  • LazyNodelet for io/PointCloudConcatenateDataSynchronizer
  • LazyNodelet for segmentation/SegmentDifferences
  • LazyNodelet for segmentation/SACSegmentationFromNormals
  • LazyNodelet for segmentation/SACSegmentation
  • LazyNodelet for segmentation/ExtractPolygonalPrismData
  • LazyNodelet for segmentation/EuclideanClusterExtraction
  • LazyNodelet for surface/MovingLeastSquares
  • LazyNodelet for surface/ConvexHull2D
  • Add missing COMPONENTS of PCL
  • Inherit NodeletLazy for pipeline with less cpu load
  • Set leaf_size 0.02
  • Install samples
  • Add sample and test for pcl/StatisticalOutlierRemoval Conflicts: pcl_ros/CMakeLists.txt
  • Add sample and test for pcl/VoxelGrid Conflicts: pcl_ros/CMakeLists.txt
  • no need to remove duplicates
  • spourious line change
  • remove now unnecessary build_depend on qtbase5
  • exclude PCL IO libraries exporting Qt flag
  • find only PCL components used instead of all PCL
  • Remove dependency on vtk/libproj-dev (#145) * Remove dependency on vtk/libproj-dev These dependencies were introduced in #124 to temporarily fix missing / wrong dependencies in upstream vtk. This hack is no longer necessary, since fixed vtk packages have been uploaded to packages.ros.org (see #124 and ros-infrastructure/reprepro-updater#32).
    • Remove vtk hack from CMakeLists.txt
  • Contributors: Kentaro Wada, Mikael Arguedas

1.5.3 (2017-05-03)

1.5.2 (2017-04-29)

  • Find Qt5Widgets to fix -lQt5::Widgets error
  • Contributors: Kentaro Wada

1.5.1 (2017-04-26)

  • Add my name as a maintainer
  • Contributors: Kentaro Wada

1.5.0 (2017-04-25)

  • Fix lib name duplication error in ubunt:zesty
  • Detect automatically the version of PCL in cmake
  • Install xml files declaring nodelets
  • Fix syntax of nodelet manifest file by splitting files for each library.
  • Contributors: Kentaro Wada

1.4.0 (2016-04-22)

File truncated at 100 lines see the full file

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged pcl_ros at Robotics Stack Exchange

Package symbol

pcl_ros package from perception_pcl repo

pcl_conversions pcl_ros perception_pcl

ROS Distro
iron

Package Summary

Tags No category tags.
Version 2.7.3
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Description PCL (Point Cloud Library) ROS interface stack
Checkout URI https://github.com/ros-perception/perception_pcl.git
VCS Type git
VCS Version ros2
Last Updated 2025-08-28
Dev Status MAINTAINED
Released RELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred bridge for 3D applications involving n-D Point Clouds and 3D geometry processing in ROS.

Additional Links

Maintainers

  • Paul Bovbel
  • Steve Macenski
  • Kentaro Wada

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall
README
No README found. See repository README.
CHANGELOG

Changelog for package pcl_ros

2.7.3 (2025-06-05)

  • Fix ament_export_dependencies (#500)
  • Contributors: Thomas Emter

2.7.2 (2025-05-23)

  • Remove calls to [ament_target_dependencies]{.title-ref} (#498)
  • Contributors: Ramon Wijnands

2.7.1 (2025-05-16)

  • Fix warning: 'subscribe<>' is deprecated: use rclcpp::QoS (#497)
  • Bump minimum cmake version to 3.20 (#496)
  • Contributors: Ramon Wijnands

2.7.0 (2025-05-15)

  • Fix downstream CMake error: rosbag2_transport not found (#494)
  • Port bag_to_pcd to ROS 2 (#486)
  • Add CombinedPointCloudToPCD Node for Accumulating Multiple Point Clouds into a Single PCD (#479)
  • Fix deprecation of .h files in message_filters (#493)
  • Improve pointcloud_to_pcd by keeping all field available in sensor_msgs (#491)
  • Added crop box marker publisher (#488)
  • Properly order the header includes for cpplint (#490)
  • Contributors: Adraub, Alireza Moayyedi, Ramon Wijnands, Tim Clephas, Valerio Passamano, vladimirjendrol

2.6.3 (2025-04-07)

  • Fix pcd timestamp format output in pointcloud_to_pcd (#481)
  • Split off pcl_ros_filter into separate library (#480)
  • Add lazy feature to ros2 branch (#477)
  • Deprecating tf2 C Headers (#469)
  • Contributors: Adraub, BÅ‚ażej Sowa, Lucas Wendland, Paul Bovbel, Tatsuro Sakaguchi

2.6.2 (2024-11-07)

  • Fix handling of empty input point cloud in computePublish method (#467)
  • point_cloud.hpp ros2 types fixed (#425)
  • Fix [Could NOT find Boost (missing: Boost_INCLUDE_DIR)]{.title-ref} (#452)
  • Fix ament_cpplint
  • Fix ament_lint_cmake
  • Switch to build_export_depend for libpcl-all-dev (#447)
  • porting pointcoud_to_pcd to ros2 (#444)
  • Contributors: Ar-Ray, Balint Rozgonyi, Ramon Wijnands, ShepelIlya, Yadu

1.6.2 (2018-05-20)

  • Fix exported includes in Ubuntu Artful
  • Increase limits on CropBox filter parameters
  • Contributors: James Ward, Jiri Horner

1.6.1 (2018-05-08)

  • Add 1.6.0 section to CHANGELOG.rst
  • Fix the use of Eigen3 in cmake
  • Contributors: Kentaro Wada

1.6.0 (2018-04-30)

  • Fix build and update maintainers
  • Add message_filters to find_package
  • Remove unnecessary dependency on genmsg
  • Contributors: Paul Bovbel, Kentaro Wada

1.5.4 (2018-03-31)

  • update to use non deprecated pluginlib macro
  • Fix config path of sample_voxel_grid.launch
  • remove hack now that upstream pcl has been rebuilt
  • Looser hzerror in test for extract_clusters to make it pass on Travis
  • Add sample & test for surface/convex_hull

File truncated at 100 lines see the full file

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged pcl_ros at Robotics Stack Exchange

Package symbol

pcl_ros package from perception_pcl repo

pcl_conversions pcl_ros perception_pcl

ROS Distro
melodic

Package Summary

Tags No category tags.
Version 1.7.5
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Description PCL (Point Cloud Library) ROS interface stack
Checkout URI https://github.com/ros-perception/perception_pcl.git
VCS Type git
VCS Version melodic-devel
Last Updated 2024-07-10
Dev Status MAINTAINED
Released RELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred bridge for 3D applications involving n-D Point Clouds and 3D geometry processing in ROS.

Additional Links

Maintainers

  • Paul Bovbel
  • Kentaro Wada
  • Steve Macenski

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall
README
No README found. See repository README.
CHANGELOG

Changelog for package pcl_ros

1.7.5 (2023-01-19)

  • Adding separate leaf sizes for each axis in the VoxelGrid filter (#393)
  • Add logic for missing pcl/point_traits.h in newer PCL versions (#381) point_traits.h is no longer available, starting with PCL 1.13.0 Since PCL 1.11.0, type_traits.h should be used instead
  • Add boost include, missing in upcoming PCL versions (#373) Was removed in pcl/conversions.h here: https://github.com/PointCloudLibrary/pcl/commit/292593abd3b69af315c7fe3379363bdce7800d5a
  • Switch to hpp headers of pluginlib (#370) Co-authored-by: Jochen Sprickerhof <<jspricke@debian.org>>
  • Contributors: Jochen Sprickerhof, Markus Vieth, Tom Moore

1.7.0 (2019-07-03)

  • Added option for fixed filename (via local parameter) (#102) (cherry picked from commit bd38533523fa5c00f320e6505a2c533e90f9d97e)

  • rewrote pcd_to_pointcloud to publish using a latched topic (#213)

    • pointcloud is published as a latched topic now
    • added functionality: ability to set config via parameters
  • Fix #150: Allow bag_to_pcd to properly respond to topic argument (#215)

    * Properly respond to topic argument fixing #150 Previously providing a topic name in argv[2], as indicated in the usage string, modified the printouts indicating to the user that they were going to be exporting the correct topic, but the rosbag::View::Query used still grabbed the first sensor_msgs/PointCloud2 topic which was not necessarily what they had specified.

    • Added more useful printouts and type-checking on input topic
  • Catch tf::TransformException in transformPointCloud (#223)

    * Catch TransformException in transformPointCloud This allows to catch all exceptions, not only tf::LookupException and tf::ExtrapolationException. Note that most of the code using transformPointCloud already (implicitly) assumes this function doesn't throw any exception, and they check the return value, which is false when an exception happened (or something went wrong).

    * Check for transformPointCloud return value In pcl_ros/src/pcl_ros/io/concatenate_data.cpp, which seems to be the only place where that check was missed.

  • Split off pcl_ros_filter into separate library (#239)

  • [Windows][melodic-devel] Fix Boost linkage issue and binary install location. (#238)

    • fix Windows build break. (#6)
    • Fix install path. (#7)
  • Wait for transform in transformPointCloud(). (#214)

  • Added tf2 versions of functions in transforms.h/hpp. (#231)

  • Switch to industrial_ci (#233)

    • Use industrial_ci
    • Run for all melodic target platforms
    • Artful EOL; verbose build and tests
    • Use travis_wait
    • Remove travis_wait
    • Download to devel space
    • Mark SYSTEM includes to avoid spurious warnings
    • Don't double-build PRs
  • use <chrono> and <thread> on Windows (#221)

    • Changing from usleep to c++14 style sleep_for for Windows support
  • Contributors: Enrique Fernandez Perdomo, James Xu, Jarvis Schultz, Martin Pecka, Paul Bovbel, Sean Yen, Stefan Kohlbrecher, Wolfgang Merkt, moooeeeep

File truncated at 100 lines see the full file

Messages

No message files found.

Services

No service files found

Recent questions tagged pcl_ros at Robotics Stack Exchange

Package symbol

pcl_ros package from perception_pcl repo

pcl_conversions pcl_ros perception_pcl

ROS Distro
noetic

Package Summary

Tags No category tags.
Version 1.7.5
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Description PCL (Point Cloud Library) ROS interface stack
Checkout URI https://github.com/ros-perception/perception_pcl.git
VCS Type git
VCS Version melodic-devel
Last Updated 2024-07-10
Dev Status MAINTAINED
Released RELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred bridge for 3D applications involving n-D Point Clouds and 3D geometry processing in ROS.

Additional Links

Maintainers

  • Paul Bovbel
  • Kentaro Wada
  • Steve Macenski

Authors

  • Open Perception
  • Julius Kammerl
  • William Woodall
README
No README found. See repository README.
CHANGELOG

Changelog for package pcl_ros

1.7.5 (2023-01-19)

  • Adding separate leaf sizes for each axis in the VoxelGrid filter (#393)
  • Add logic for missing pcl/point_traits.h in newer PCL versions (#381) point_traits.h is no longer available, starting with PCL 1.13.0 Since PCL 1.11.0, type_traits.h should be used instead
  • Add boost include, missing in upcoming PCL versions (#373) Was removed in pcl/conversions.h here: https://github.com/PointCloudLibrary/pcl/commit/292593abd3b69af315c7fe3379363bdce7800d5a
  • Switch to hpp headers of pluginlib (#370) Co-authored-by: Jochen Sprickerhof <<jspricke@debian.org>>
  • Contributors: Jochen Sprickerhof, Markus Vieth, Tom Moore

1.7.0 (2019-07-03)

  • Added option for fixed filename (via local parameter) (#102) (cherry picked from commit bd38533523fa5c00f320e6505a2c533e90f9d97e)

  • rewrote pcd_to_pointcloud to publish using a latched topic (#213)

    • pointcloud is published as a latched topic now
    • added functionality: ability to set config via parameters
  • Fix #150: Allow bag_to_pcd to properly respond to topic argument (#215)

    * Properly respond to topic argument fixing #150 Previously providing a topic name in argv[2], as indicated in the usage string, modified the printouts indicating to the user that they were going to be exporting the correct topic, but the rosbag::View::Query used still grabbed the first sensor_msgs/PointCloud2 topic which was not necessarily what they had specified.

    • Added more useful printouts and type-checking on input topic
  • Catch tf::TransformException in transformPointCloud (#223)

    * Catch TransformException in transformPointCloud This allows to catch all exceptions, not only tf::LookupException and tf::ExtrapolationException. Note that most of the code using transformPointCloud already (implicitly) assumes this function doesn't throw any exception, and they check the return value, which is false when an exception happened (or something went wrong).

    * Check for transformPointCloud return value In pcl_ros/src/pcl_ros/io/concatenate_data.cpp, which seems to be the only place where that check was missed.

  • Split off pcl_ros_filter into separate library (#239)

  • [Windows][melodic-devel] Fix Boost linkage issue and binary install location. (#238)

    • fix Windows build break. (#6)
    • Fix install path. (#7)
  • Wait for transform in transformPointCloud(). (#214)

  • Added tf2 versions of functions in transforms.h/hpp. (#231)

  • Switch to industrial_ci (#233)

    • Use industrial_ci
    • Run for all melodic target platforms
    • Artful EOL; verbose build and tests
    • Use travis_wait
    • Remove travis_wait
    • Download to devel space
    • Mark SYSTEM includes to avoid spurious warnings
    • Don't double-build PRs
  • use <chrono> and <thread> on Windows (#221)

    • Changing from usleep to c++14 style sleep_for for Windows support
  • Contributors: Enrique Fernandez Perdomo, James Xu, Jarvis Schultz, Martin Pecka, Paul Bovbel, Sean Yen, Stefan Kohlbrecher, Wolfgang Merkt, moooeeeep

File truncated at 100 lines see the full file

Messages

No message files found.

Services

No service files found

Recent questions tagged pcl_ros at Robotics Stack Exchange