Public Member Functions | |
ErraticKeyboardTeleopNode () | |
void | keyboardLoop () |
void | stopRobot () |
~ErraticKeyboardTeleopNode () | |
Private Attributes | |
geometry_msgs::Twist | cmdvel_ |
ros::NodeHandle | n_ |
ros::Publisher | pub_ |
double | run_vel_ |
double | walk_vel_ |
double | yaw_rate_ |
double | yaw_rate_run_ |
Definition at line 58 of file teleop_keyboard.cpp.
ErraticKeyboardTeleopNode::ErraticKeyboardTeleopNode | ( | ) | [inline] |
Definition at line 71 of file teleop_keyboard.cpp.
Definition at line 81 of file teleop_keyboard.cpp.
Definition at line 119 of file teleop_keyboard.cpp.
void ErraticKeyboardTeleopNode::stopRobot | ( | ) | [inline] |
Definition at line 84 of file teleop_keyboard.cpp.
geometry_msgs::Twist ErraticKeyboardTeleopNode::cmdvel_ [private] |
Definition at line 66 of file teleop_keyboard.cpp.
ros::NodeHandle ErraticKeyboardTeleopNode::n_ [private] |
Definition at line 67 of file teleop_keyboard.cpp.
Definition at line 68 of file teleop_keyboard.cpp.
double ErraticKeyboardTeleopNode::run_vel_ [private] |
Definition at line 62 of file teleop_keyboard.cpp.
double ErraticKeyboardTeleopNode::walk_vel_ [private] |
Definition at line 61 of file teleop_keyboard.cpp.
double ErraticKeyboardTeleopNode::yaw_rate_ [private] |
Definition at line 63 of file teleop_keyboard.cpp.
double ErraticKeyboardTeleopNode::yaw_rate_run_ [private] |
Definition at line 64 of file teleop_keyboard.cpp.