Public Member Functions | Private Member Functions | Private Attributes
youbot_joy_teleop Class Reference

Provides a bridge between the joy topic and the cmd_vel topic. More...

#include <youbot_joy_teleop.h>

List of all members.

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

Detailed Description

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.


Constructor & Destructor Documentation

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.


Member Function Documentation

void youbot_joy_teleop::joy_cback ( const sensor_msgs::Joy::ConstPtr &  joy) [private]

joy topic callback function.

Parameters:
joythe message for the joy topic

Definition at line 68 of file youbot_joy_teleop.cpp.


Member Data Documentation

the cmd_vel topic

Definition at line 85 of file youbot_joy_teleop.h.

the joy topic

Definition at line 86 of file youbot_joy_teleop.h.

a handle for this ROS node

Definition at line 83 of file youbot_joy_teleop.h.


The documentation for this class was generated from the following files:
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Properties Friends


rail_youbot_teleop
Author(s): Russell Toris
autogenerated on Sun May 19 2013 13:57:33