1 #ifndef __YAML_MENU_HANDLER_H__ 2 #define __YAML_MENU_HANDLER_H__ 5 #include <yaml-cpp/yaml.h> 8 #include <std_msgs/String.h> 19 void pubTopic(
const visualization_msgs::InteractiveMarkerFeedbackConstPtr &feedback, std::string topic_name);
YamlMenuHandler(ros::NodeHandle *node_ptr, std::string file_name)
bool initMenu(std::string file)
interactive_markers::MenuHandler _menu_handler
std::map< std::string, ros::Publisher > _publisher_map
void applyMenu(interactive_markers::InteractiveMarkerServer *server_ptr, std::string name)
ros::NodeHandle * _node_ptr
void pubTopic(const visualization_msgs::InteractiveMarkerFeedbackConstPtr &feedback, std::string topic_name)