Classes | |
| struct | Axis |
| struct | Button |
Public Member Functions | |
| void | execute () |
| sensor_msgs::Joy::_axes_type::value_type | getAxis (const sensor_msgs::JoyConstPtr &joy, Axis axis) |
| sensor_msgs::Joy::_buttons_type::value_type | getButton (const sensor_msgs::JoyConstPtr &joy, int button) |
| void | joyTwistCallback (const sensor_msgs::JoyConstPtr &joy) |
| void | stop () |
| Teleop () | |
| ~Teleop () | |
Private Attributes | |
| struct { | |
| Axis x | |
| Axis y | |
| Axis yaw | |
| Axis z | |
| } | axes_ |
| double | frequency_ |
| ros::Subscriber | joy_subscriber_ |
| ros::NodeHandle | node_handle_ |
| geometry_msgs::Twist | velocity_ |
| ros::Publisher | velocity_publisher_ |
Definition at line 35 of file quadrotor_teleop.cpp.
| Teleop::Teleop | ( | ) | [inline] |
Definition at line 66 of file quadrotor_teleop.cpp.
| Teleop::~Teleop | ( | ) | [inline] |
Definition at line 87 of file quadrotor_teleop.cpp.
| void Teleop::execute | ( | ) | [inline] |
Definition at line 92 of file quadrotor_teleop.cpp.
| sensor_msgs::Joy::_axes_type::value_type Teleop::getAxis | ( | const sensor_msgs::JoyConstPtr & | joy, |
| Axis | axis | ||
| ) | [inline] |
Definition at line 111 of file quadrotor_teleop.cpp.
| sensor_msgs::Joy::_buttons_type::value_type Teleop::getButton | ( | const sensor_msgs::JoyConstPtr & | joy, |
| int | button | ||
| ) | [inline] |
Definition at line 127 of file quadrotor_teleop.cpp.
| void Teleop::joyTwistCallback | ( | const sensor_msgs::JoyConstPtr & | joy | ) | [inline] |
Definition at line 103 of file quadrotor_teleop.cpp.
| void Teleop::stop | ( | ) | [inline] |
Definition at line 138 of file quadrotor_teleop.cpp.
struct { ... } Teleop::axes_ [private] |
double Teleop::frequency_ [private] |
Definition at line 63 of file quadrotor_teleop.cpp.
ros::Subscriber Teleop::joy_subscriber_ [private] |
Definition at line 39 of file quadrotor_teleop.cpp.
ros::NodeHandle Teleop::node_handle_ [private] |
Definition at line 38 of file quadrotor_teleop.cpp.
geometry_msgs::Twist Teleop::velocity_ [private] |
Definition at line 42 of file quadrotor_teleop.cpp.
ros::Publisher Teleop::velocity_publisher_ [private] |
Definition at line 41 of file quadrotor_teleop.cpp.
Definition at line 57 of file quadrotor_teleop.cpp.
Definition at line 58 of file quadrotor_teleop.cpp.
Definition at line 60 of file quadrotor_teleop.cpp.
Definition at line 59 of file quadrotor_teleop.cpp.