ros-perception / pointcloud_to_laserscan

Converts a 3D Point Cloud into a 2D laser scan.
http://wiki.ros.org/pointcloud_to_laserscan
BSD 3-Clause "New" or "Revised" License
388 stars 268 forks source link

ROS 2 pointcloud <-> laserscan converters

This is a ROS 2 package that provides components to convert sensor_msgs/msg/PointCloud2 messages to sensor_msgs/msg/LaserScan messages and back. It is essentially a port of the original ROS 1 package.

pointcloud_to_laserscan::PointCloudToLaserScanNode

This ROS 2 component projects sensor_msgs/msg/PointCloud2 messages into sensor_msgs/msg/LaserScan messages.

Published Topics

Subscribed Topics

Parameters

pointcloud_to_laserscan::LaserScanToPointCloudNode

This ROS 2 component re-publishes sensor_msgs/msg/LaserScan messages as sensor_msgs/msg/PointCloud2 messages.

Published Topics

Subscribed Topics

Parameters