Function ouster_ros::cloud_to_cloud_msg
Defined in File os_ros.h
Function Documentation
-
sensor_msgs::msg::PointCloud2 ouster_ros::cloud_to_cloud_msg(const Cloud &cloud, const rclcpp::Time ×tamp, const std::string &frame)
Serialize a PCL point cloud to a ROS message
- Parameters:
cloud – [in] the PCL point cloud to convert
timestamp – [in] the timestamp to apply to the resulting ROS message
frame – [in] the frame to set in the resulting ROS message
- Returns:
a ROS message containing the point cloud