#include <robot_command_interface.h>

Public Member Functions | |
| RobotCommandInterfaceAction (QWidget *parent=0) | |
Public Member Functions inherited from rviz::Panel | |
| virtual QString | getClassId () const |
| virtual QString | getDescription () const |
| virtual QString | getName () const |
| void | initialize (VisualizationManager *manager) |
| virtual void | load (const Config &config) |
| virtual void | onInitialize () |
| Panel (QWidget *parent=0) | |
| virtual void | save (Config config) const |
| virtual void | setClassId (const QString &class_id) |
| virtual void | setDescription (const QString &description) |
| virtual void | setName (const QString &name) |
| virtual | ~Panel () |
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_ |
Protected Attributes inherited from rviz::Panel | |
| VisualizationManager * | vis_manager_ |
Additional Inherited Members | |
Signals inherited from rviz::Panel | |
| void | configChanged () |
Definition at line 18 of file robot_command_interface.h.
| jsk_rviz_plugins::RobotCommandInterfaceAction::RobotCommandInterfaceAction | ( | QWidget * | parent = 0 | ) |
Definition at line 21 of file robot_command_interface.cpp.
|
protectedslot |
Definition at line 136 of file robot_command_interface.cpp.
|
protectedslot |
Definition at line 129 of file robot_command_interface.cpp.
|
protected |
Definition at line 155 of file robot_command_interface.cpp.
|
protected |
Definition at line 33 of file robot_command_interface.h.
|
protected |
Definition at line 32 of file robot_command_interface.h.
|
protected |
Definition at line 30 of file robot_command_interface.h.
|
protected |
Definition at line 31 of file robot_command_interface.h.