Function ouster_ros::lidar_packet_to_telemetry_msg
Defined in File os_ros.h
Function Documentation
-
ouster_sensor_msgs::msg::Telemetry ouster_ros::lidar_packet_to_telemetry_msg(const ouster::sensor::LidarPacket &lidar_packet, const rclcpp::Time ×tamp, const ouster::sensor::packet_format &pf)
Parse a LidarPacket and generate the Telemetry message
- Parameters:
lidar_packet – [in] lidar packet to parse telemetry data from
timestamp – [in] the timestamp to give the resulting ROS message
pf – [in] the packet format
- Returns:
ROS sensor message with fields populated from the packet