Public Member Functions | |
| TeleopStingbot () | |
Private Member Functions | |
| void | joyCallback (const sensor_msgs::Joy::ConstPtr &joy) |
Private Attributes | |
| double | a_scale_ |
| double | angular_ |
| ros::Subscriber | joy_sub_ |
| double | l_scale_ |
| double | linear_ |
| ros::NodeHandle | nh_ |
| ros::Publisher | vel_pub_ |
Definition at line 9 of file stingbot_teleop_wii.cpp.
Definition at line 27 of file stingbot_teleop_wii.cpp.
| void TeleopStingbot::joyCallback | ( | const sensor_msgs::Joy::ConstPtr & | joy | ) | [private] |
Definition at line 41 of file stingbot_teleop_wii.cpp.
double TeleopStingbot::a_scale_ [private] |
Definition at line 20 of file stingbot_teleop_wii.cpp.
double TeleopStingbot::angular_ [private] |
Definition at line 19 of file stingbot_teleop_wii.cpp.
ros::Subscriber TeleopStingbot::joy_sub_ [private] |
Definition at line 22 of file stingbot_teleop_wii.cpp.
double TeleopStingbot::l_scale_ [private] |
Definition at line 20 of file stingbot_teleop_wii.cpp.
double TeleopStingbot::linear_ [private] |
Definition at line 19 of file stingbot_teleop_wii.cpp.
ros::NodeHandle TeleopStingbot::nh_ [private] |
Definition at line 17 of file stingbot_teleop_wii.cpp.
ros::Publisher TeleopStingbot::vel_pub_ [private] |
Definition at line 21 of file stingbot_teleop_wii.cpp.