perception_pcl
perception_pcl copied to clipboard
ROS2 - Unable to include pcl_ros/point_cloud.hpp
Hi, I'm a bit confused by the many issues and discussions regarding the ROS2 port.
Is there currently a way to use pcl_ros/point_cloud.hpp
with ros2?
It seems to be only half ported as there are still some ros1-msgs:
sensor_msgs::PointCloud2
instead of sensor_msgs::msg::PointCloud2
See also here
Thanks!