24 #ifndef WIIMOTE_TELEOP_WIIMOTE_H 25 #define WIIMOTE_TELEOP_WIIMOTE_H 28 #include "sensor_msgs/Joy.h" 29 #include "wiimote/State.h" 35 #define DEFAULT_MAX_LINEAR_X 0.65024 // m/s 37 #define DEFAULT_MAX_ANGULAR_Z M_PI // rad/s 39 #define DEFAULT_PERCENT_LINEAR_THROTTLE 0.75 40 #define DEFAULT_PERCENT_ANGULAR_THROTTLE 0.75 50 void joyCallback(
const sensor_msgs::Joy::ConstPtr& joy);
70 #endif // WIIMOTE_TELEOP_WIIMOTE_H void joyCallback(const sensor_msgs::Joy::ConstPtr &joy)
double linear_x_min_velocity_
void wiimoteStateCallback(const wiimote::State::ConstPtr &wiistate)
double linear_x_max_velocity_
void rumbleFeedback(int useconds)
void setLEDFeedback(double value)
ros::Subscriber wiimote_sub_
double angular_z_max_velocity_
double percent_angular_throttle_
double angular_z_min_velocity_
double percent_linear_throttle_