#include <cancel_action.h>
Classes | |
struct | topicListLayout |
Public Slots | |
void | setTopic (const QString &topic) |
Public Member Functions | |
CancelAction (QWidget *parent=0) | |
virtual void | load (const rviz::Config &config) |
virtual void | save (rviz::Config config) const |
Protected Slots | |
void | addTopic () |
void | addTopicList (std::string topic_name) |
void | initComboBox () |
void | OnClickDeleteButton (int id) |
void | sendTopic () |
void | updateTopic () |
Protected Attributes | |
QComboBox * | add_topic_box_ |
QPushButton * | add_topic_button_ |
QVBoxLayout * | layout |
QSignalMapper * | m_sigmap |
ros::NodeHandle | nh_ |
QString | output_topic_ |
QLineEdit * | output_topic_editor_ |
QPushButton * | send_topic_button_ |
std::vector< topicListLayout > | topic_list_layouts_ |
ros::Publisher | velocity_publisher_ |
Definition at line 16 of file cancel_action.h.
jsk_rviz_plugin::CancelAction::CancelAction | ( | QWidget * | parent = 0 | ) |
Definition at line 19 of file cancel_action.cpp.
void jsk_rviz_plugin::CancelAction::addTopic | ( | ) | [protected, slot] |
Definition at line 93 of file cancel_action.cpp.
void jsk_rviz_plugin::CancelAction::addTopicList | ( | std::string | topic_name | ) | [protected, slot] |
Definition at line 105 of file cancel_action.cpp.
void jsk_rviz_plugin::CancelAction::initComboBox | ( | ) | [protected, slot] |
Definition at line 53 of file cancel_action.cpp.
void jsk_rviz_plugin::CancelAction::load | ( | const rviz::Config & | config | ) | [virtual] |
Reimplemented from rviz::Panel.
Definition at line 158 of file cancel_action.cpp.
void jsk_rviz_plugin::CancelAction::OnClickDeleteButton | ( | int | id | ) | [protected, slot] |
Definition at line 73 of file cancel_action.cpp.
void jsk_rviz_plugin::CancelAction::save | ( | rviz::Config | config | ) | const [virtual] |
Reimplemented from rviz::Panel.
Definition at line 143 of file cancel_action.cpp.
void jsk_rviz_plugin::CancelAction::sendTopic | ( | ) | [protected, slot] |
Definition at line 134 of file cancel_action.cpp.
void jsk_rviz_plugin::CancelAction::setTopic | ( | const QString & | topic | ) | [slot] |
void jsk_rviz_plugin::CancelAction::updateTopic | ( | ) | [protected, slot] |
QComboBox* jsk_rviz_plugin::CancelAction::add_topic_box_ [protected] |
Definition at line 51 of file cancel_action.h.
QPushButton* jsk_rviz_plugin::CancelAction::add_topic_button_ [protected] |
Definition at line 49 of file cancel_action.h.
QVBoxLayout* jsk_rviz_plugin::CancelAction::layout [protected] |
Definition at line 57 of file cancel_action.h.
QSignalMapper* jsk_rviz_plugin::CancelAction::m_sigmap [protected] |
Definition at line 55 of file cancel_action.h.
ros::NodeHandle jsk_rviz_plugin::CancelAction::nh_ [protected] |
Definition at line 73 of file cancel_action.h.
QString jsk_rviz_plugin::CancelAction::output_topic_ [protected] |
Definition at line 47 of file cancel_action.h.
QLineEdit* jsk_rviz_plugin::CancelAction::output_topic_editor_ [protected] |
Definition at line 45 of file cancel_action.h.
QPushButton* jsk_rviz_plugin::CancelAction::send_topic_button_ [protected] |
Definition at line 53 of file cancel_action.h.
Definition at line 67 of file cancel_action.h.
Definition at line 70 of file cancel_action.h.