Public Member Functions | |
| void | keyboardLoop () |
| void | stateCallback (const sensor_msgs::JointStateConstPtr &msg) |
| TeleopJointsKeyboard () | |
| ~TeleopJointsKeyboard () | |
Private Attributes | |
| std_msgs::Float64MultiArray | cmd_ |
| bool | has_recieved_joints_ |
| ros::Publisher | joints_pub_ |
| ros::Subscriber | joints_sub_ |
| ros::NodeHandle | nh_ |
Definition at line 85 of file keyboard_teleop.cpp.
| TeleopJointsKeyboard::TeleopJointsKeyboard | ( | ) | [inline] |
Definition at line 89 of file keyboard_teleop.cpp.
| TeleopJointsKeyboard::~TeleopJointsKeyboard | ( | ) | [inline] |
Definition at line 100 of file keyboard_teleop.cpp.
| void TeleopJointsKeyboard::keyboardLoop | ( | ) | [inline] |
Definition at line 123 of file keyboard_teleop.cpp.
| void TeleopJointsKeyboard::stateCallback | ( | const sensor_msgs::JointStateConstPtr & | msg | ) | [inline] |
Definition at line 103 of file keyboard_teleop.cpp.
std_msgs::Float64MultiArray TeleopJointsKeyboard::cmd_ [private] |
Definition at line 242 of file keyboard_teleop.cpp.
bool TeleopJointsKeyboard::has_recieved_joints_ [private] |
Definition at line 243 of file keyboard_teleop.cpp.
Definition at line 240 of file keyboard_teleop.cpp.
Definition at line 241 of file keyboard_teleop.cpp.
ros::NodeHandle TeleopJointsKeyboard::nh_ [private] |
Definition at line 239 of file keyboard_teleop.cpp.