Provides a bridge between the joy topic and the cmd_vel topic. More...
#include <youbot_joy_teleop.h>
Public Member Functions | |
| youbot_joy_teleop () | |
| Creates a youbot_joy_teleop. | |
Private Member Functions | |
| void | joy_cback (const sensor_msgs::Joy::ConstPtr &joy) |
| joy topic callback function. | |
Private Attributes | |
| ros::Publisher | cmd_vel |
| ros::Subscriber | joy_sub |
| ros::NodeHandle | node |
Provides a bridge between the joy topic and the cmd_vel topic.
The youbot_joy_teleop handles the translation between joystick commands and communication to the YouBot's /cmd_vel topic.
Definition at line 65 of file youbot_joy_teleop.h.
Creates a youbot_joy_teleop.
Creates a youbot_joy_teleop object that can be used control the Kuka YouBot with a joystick. ROS nodes, services, and publishers are created and maintained within this object.
Definition at line 59 of file youbot_joy_teleop.cpp.
| void youbot_joy_teleop::joy_cback | ( | const sensor_msgs::Joy::ConstPtr & | joy | ) | [private] |
joy topic callback function.
| joy | the message for the joy topic |
Definition at line 68 of file youbot_joy_teleop.cpp.
ros::Publisher youbot_joy_teleop::cmd_vel [private] |
the cmd_vel topic
Definition at line 85 of file youbot_joy_teleop.h.
ros::Subscriber youbot_joy_teleop::joy_sub [private] |
the joy topic
Definition at line 86 of file youbot_joy_teleop.h.
ros::NodeHandle youbot_joy_teleop::node [private] |
a handle for this ROS node
Definition at line 83 of file youbot_joy_teleop.h.