18 #ifndef SONAR_CONVERTER_HPP
19 #define SONAR_CONVERTER_HPP
30 #include <sensor_msgs/Range.h>
40 typedef boost::function<void(std::vector<sensor_msgs::Range>&)>
Callback_t;
52 void callAll(
const std::vector<message_actions::MessageAction>& actions );
56 std::map<message_actions::MessageAction, Callback_t>
callbacks_;
70 std::vector<sensor_msgs::Range>
msgs_;