yaml_menu_handler.h
Go to the documentation of this file.
1 #ifndef __YAML_MENU_HANDLER_H__
2 #define __YAML_MENU_HANDLER_H__
3 
4 #include <vector>
5 #include <yaml-cpp/yaml.h>
8 #include <std_msgs/String.h>
9 #include <map>
10 
11 namespace jsk_interactive_marker {
13  public:
16  std::map<std::string, ros::Publisher> _publisher_map;
17  YamlMenuHandler(ros::NodeHandle* node_ptr, std::string file_name);
18  bool initMenu(std::string file);
19  void pubTopic(const visualization_msgs::InteractiveMarkerFeedbackConstPtr &feedback, std::string topic_name);
20  void applyMenu(interactive_markers::InteractiveMarkerServer* server_ptr, std::string name);
21  };
22 };
23 
24 #endif
YamlMenuHandler(ros::NodeHandle *node_ptr, std::string file_name)
interactive_markers::MenuHandler _menu_handler
std::map< std::string, ros::Publisher > _publisher_map
void applyMenu(interactive_markers::InteractiveMarkerServer *server_ptr, std::string name)
void pubTopic(const visualization_msgs::InteractiveMarkerFeedbackConstPtr &feedback, std::string topic_name)


jsk_interactive_marker
Author(s): furuta
autogenerated on Sat Mar 20 2021 03:03:33