18 #ifndef LASER_CONVERTER_HPP
19 #define LASER_CONVERTER_HPP
30 #include <sensor_msgs/LaserScan.h>
40 typedef boost::function<void(sensor_msgs::LaserScan&)>
Callback_t;
47 void callAll(
const std::vector<message_actions::MessageAction>& actions );
51 void setLaserRanges(
const float &range_min,
const float &range_max);
59 std::map<message_actions::MessageAction, Callback_t>
callbacks_;
60 sensor_msgs::LaserScan
msg_;