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
const util::TenthOfDegree & maxScanAngle() const
static constexpr double TIME_PER_SCAN_IN_S
Time & fromNSec(uint64_t t)
static constexpr double RANGE_MAX_IN_M
const MeasurementData & measurements() const
const IntensityData & intensities() const
const util::TenthOfDegree & minScanAngle() const
constexpr double toRad() const
sensor_msgs::LaserScan toLaserScanMsg(const LaserScan &laserscan, const std::string &frame_id, const double x_axis_rotation)
int64_t timestamp() const
Root namespace in which the software components to communicate with the scanner (firmware-version: 2)...
Root namespace for the ROS part.
const util::TenthOfDegree & scanResolution() const
This class represents a single laser scan in the <tf_prefix> target frame.
static constexpr double RANGE_MIN_IN_M