#include <robot_command_interface.h>

| Public Member Functions | |
| RobotCommandInterfaceAction (QWidget *parent=0) | |
| Protected Slots | |
| void | buttonCallback (int i) | 
| bool | callRequestEusCommand (const std::string &command) | 
| Protected Member Functions | |
| void | popupDialog (const std::string &text) | 
| Protected Attributes | |
| std::map< int, std::string > | emptyservice_mapping_ | 
| std::map< int, std::string > | euscommand_mapping_ | 
| ros::NodeHandle | nh_ | 
| QSignalMapper * | signal_mapper_ | 
Definition at line 12 of file robot_command_interface.h.
| jsk_rviz_plugins::RobotCommandInterfaceAction::RobotCommandInterfaceAction | ( | QWidget * | parent = 0 | ) | 
Definition at line 21 of file robot_command_interface.cpp.
| void jsk_rviz_plugins::RobotCommandInterfaceAction::buttonCallback | ( | int | i | ) |  [protected, slot] | 
Definition at line 136 of file robot_command_interface.cpp.
| bool jsk_rviz_plugins::RobotCommandInterfaceAction::callRequestEusCommand | ( | const std::string & | command | ) |  [protected, slot] | 
Definition at line 129 of file robot_command_interface.cpp.
| void jsk_rviz_plugins::RobotCommandInterfaceAction::popupDialog | ( | const std::string & | text | ) |  [protected] | 
Definition at line 155 of file robot_command_interface.cpp.
| std::map<int, std::string> jsk_rviz_plugins::RobotCommandInterfaceAction::emptyservice_mapping_  [protected] | 
Definition at line 27 of file robot_command_interface.h.
| std::map<int, std::string> jsk_rviz_plugins::RobotCommandInterfaceAction::euscommand_mapping_  [protected] | 
Definition at line 26 of file robot_command_interface.h.
Definition at line 24 of file robot_command_interface.h.
| QSignalMapper* jsk_rviz_plugins::RobotCommandInterfaceAction::signal_mapper_  [protected] | 
Definition at line 25 of file robot_command_interface.h.