16 #ifndef PSEN_SCAN_V2_LASERSCAN_ROS_CONVERSIONS_H
17 #define PSEN_SCAN_V2_LASERSCAN_ROS_CONVERSIONS_H
19 #include <sensor_msgs/LaserScan.h>
29 const std::string& frame_id,
30 const double x_axis_rotation)
32 sensor_msgs::LaserScan ros_message;
35 throw std::invalid_argument(
"Laserscan message has an invalid timestamp: " + std::to_string(laserscan.
timestamp()));
38 ros_message.header.frame_id = frame_id;
49 ros_message.ranges.insert(
52 ros_message.intensities.insert(
60 #endif // PSEN_SCAN_V2_LASERSCAN_ROS_CONVERSIONS_H