#include <teleop_wiimote.h>
Public Member Functions | |
TeleopWiimote () | |
Private Member Functions | |
void | joyCallback (const sensor_msgs::Joy::ConstPtr &joy) |
void | rumbleFeedback (int useconds) |
void | setLEDFeedback (double value) |
void | wiimoteStateCallback (const wiimote::State::ConstPtr &wiistate) |
Private Attributes | |
double | angular_z_max_velocity_ |
double | angular_z_min_velocity_ |
bool | dpad_in_use_ = false |
ros::Publisher | joy_pub_ |
ros::Subscriber | joy_sub_ |
double | linear_x_max_velocity_ |
double | linear_x_min_velocity_ |
bool | njoy_in_use_ = false |
double | percent_angular_throttle_ |
double | percent_linear_throttle_ |
ros::Publisher | vel_pub_ |
ros::Subscriber | wiimote_sub_ |
Definition at line 42 of file teleop_wiimote.h.
TeleopWiimote::TeleopWiimote | ( | ) |
Definition at line 29 of file teleop_wiimote.cpp.
|
private |
Definition at line 190 of file teleop_wiimote.cpp.
|
private |
Definition at line 169 of file teleop_wiimote.cpp.
|
private |
Definition at line 123 of file teleop_wiimote.cpp.
|
private |
Definition at line 287 of file teleop_wiimote.cpp.
|
private |
Definition at line 55 of file teleop_wiimote.h.
|
private |
Definition at line 56 of file teleop_wiimote.h.
|
private |
Definition at line 66 of file teleop_wiimote.h.
|
private |
Definition at line 62 of file teleop_wiimote.h.
|
private |
Definition at line 63 of file teleop_wiimote.h.
|
private |
Definition at line 53 of file teleop_wiimote.h.
|
private |
Definition at line 54 of file teleop_wiimote.h.
|
private |
Definition at line 67 of file teleop_wiimote.h.
|
private |
Definition at line 59 of file teleop_wiimote.h.
|
private |
Definition at line 58 of file teleop_wiimote.h.
|
private |
Definition at line 61 of file teleop_wiimote.h.
|
private |
Definition at line 64 of file teleop_wiimote.h.