Function easynav::points_to_rosmsg

Function Documentation

sensor_msgs::msg::PointCloud2 easynav::points_to_rosmsg(const pcl::PointCloud<pcl::PointXYZ> &points)

Converts a PCL point cloud into a sensor_msgs::msg::PointCloud2 message.

Parameters:

points – Input point cloud.

Returns:

The resulting ROS PointCloud2 message.