#include <TeleoperatorInstanceWidget.h>
Public Types | |
| enum | InputMethod { Joystick = 0, Keyboard = 1, Mouse = 2 } |
Public Slots | |
| void | redraw () |
Signals | |
| void | redrawSignal () |
Public Member Functions | |
| TeleoperatorInstanceWidget (ros::NodeHandle &nodeHandle, InputMethod inputMethod, int robotNumber, string velocityTopic, string feedbackVelocityFeedback) | |
| virtual | ~TeleoperatorInstanceWidget () |
Private Member Functions | |
| void | initJoystick (InputMethod method) |
| void | initTopics (InputMethod method, string feedbackTopicName, string velocityTopic) |
| string | inputMethodStr (InputMethod method) |
| void | keyboardCallback (double linear, double angular) |
| void | onVelocityMessage (const geometry_msgs::Twist::Ptr velocityMessage) |
| void | uiJoystickCallback (double linearPercent, double angularPercent) |
Private Attributes | |
| double | _angularVelocity |
| volatile bool | _closed |
| InputMethod | _inputMethod |
| mr_rqt::KeyboardTeleop * | _keyboardWidget |
| double | _linearVelocity |
| ros::NodeHandle & | _nodeHandle |
| ros::Publisher | _publisher |
| int | _robotNumber |
| ros::Subscriber | _subscriber |
| mr_rqt::VelocityWidget * | _velocityWidget |
| Ui_teleoperatorInstance | _widget |
Definition at line 49 of file TeleoperatorInstanceWidget.h.
Definition at line 55 of file TeleoperatorInstanceWidget.h.
| TeleoperatorInstanceWidget::TeleoperatorInstanceWidget | ( | ros::NodeHandle & | nodeHandle, |
| InputMethod | inputMethod, | ||
| int | robotNumber, | ||
| string | velocityTopic, | ||
| string | feedbackVelocityFeedback | ||
| ) | [inline] |
Definition at line 59 of file TeleoperatorInstanceWidget.h.
| void TeleoperatorInstanceWidget::initJoystick | ( | InputMethod | method | ) | [inline, private] |
Definition at line 137 of file TeleoperatorInstanceWidget.h.
| void TeleoperatorInstanceWidget::initTopics | ( | InputMethod | method, |
| string | feedbackTopicName, | ||
| string | velocityTopic | ||
| ) | [inline, private] |
Definition at line 154 of file TeleoperatorInstanceWidget.h.
| string TeleoperatorInstanceWidget::inputMethodStr | ( | InputMethod | method | ) | [inline, private] |
Definition at line 204 of file TeleoperatorInstanceWidget.h.
| void TeleoperatorInstanceWidget::keyboardCallback | ( | double | linear, |
| double | angular | ||
| ) | [inline, private] |
Definition at line 172 of file TeleoperatorInstanceWidget.h.
| void TeleoperatorInstanceWidget::onVelocityMessage | ( | const geometry_msgs::Twist::Ptr | velocityMessage | ) | [inline, private] |
Definition at line 185 of file TeleoperatorInstanceWidget.h.
| void TeleoperatorInstanceWidget::redraw | ( | ) | [inline, slot] |
Executed on UI Thread
Definition at line 108 of file TeleoperatorInstanceWidget.h.
| void TeleoperatorInstanceWidget::redrawSignal | ( | ) | [signal] |
| void TeleoperatorInstanceWidget::uiJoystickCallback | ( | double | linearPercent, |
| double | angularPercent | ||
| ) | [inline, private] |
Definition at line 161 of file TeleoperatorInstanceWidget.h.
| virtual TeleoperatorInstanceWidget::~TeleoperatorInstanceWidget | ( | ) | [inline, virtual] |
Definition at line 97 of file TeleoperatorInstanceWidget.h.
double TeleoperatorInstanceWidget::_angularVelocity [private] |
Definition at line 132 of file TeleoperatorInstanceWidget.h.
volatile bool TeleoperatorInstanceWidget::_closed [private] |
Definition at line 134 of file TeleoperatorInstanceWidget.h.
Definition at line 120 of file TeleoperatorInstanceWidget.h.
Definition at line 129 of file TeleoperatorInstanceWidget.h.
double TeleoperatorInstanceWidget::_linearVelocity [private] |
Definition at line 131 of file TeleoperatorInstanceWidget.h.
Definition at line 122 of file TeleoperatorInstanceWidget.h.
Definition at line 124 of file TeleoperatorInstanceWidget.h.
int TeleoperatorInstanceWidget::_robotNumber [private] |
Definition at line 119 of file TeleoperatorInstanceWidget.h.
Definition at line 125 of file TeleoperatorInstanceWidget.h.
Definition at line 128 of file TeleoperatorInstanceWidget.h.
Definition at line 127 of file TeleoperatorInstanceWidget.h.