Function ros2_ouster::toMsg(const uint8_t *, const std::string&, const ouster::sensor::packet_format&, const uint64_t)
Defined in File conversions.hpp
Function Documentation
-
inline sensor_msgs::msg::Imu ros2_ouster::toMsg(const uint8_t *buf, const std::string &frame, const ouster::sensor::packet_format &pf, const uint64_t override_ts = 0)
Parse an imu packet message into a ROS imu message.
- Parameters:
pm – packet message populated by read_imu_packet
frame – the frame to set in the resulting ROS message
- Returns:
ROS sensor message with fields populated from the packet