Classes | Defines | Functions
youbot_joy_teleop.h File Reference

Allows for control of the KUKA youBot with a joystick. More...

#include <geometry_msgs/Twist.h>
#include <ros/ros.h>
#include <sensor_msgs/Joy.h>
Include dependency graph for youbot_joy_teleop.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

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

Defines

#define MAX_ANG_VEL   1.2
#define MAX_TRANS_VEL   .8

Functions

int main (int argc, char **argv)

Detailed Description

Allows for control of the KUKA youBot with a joystick.

youbot_joy_teleop creates a ROS node that allows the control of a KUKA youBot with a joystick. This node listens to a /joy topic and sends messages to the /cmd_vel topic. Arm control is currently unimplemented.

Author:
Russell Toris, WPI - rctoris@wpi.edu
Date:
May 21, 2013

Definition in file youbot_joy_teleop.h.


Define Documentation

#define MAX_ANG_VEL   1.2

Definition at line 20 of file youbot_joy_teleop.h.

#define MAX_TRANS_VEL   .8

Definition at line 19 of file youbot_joy_teleop.h.


Function Documentation

int main ( int  argc,
char **  argv 
)

Creates and runs the youbot_joy_teleop node.

Parameters:
argcargument count that is passed to ros::init
argvarguments that are passed to ros::init
Returns:
EXIT_SUCCESS if the node runs correctly

Definition at line 139 of file pick_and_place_demo.cpp.



youbot_teleop
Author(s): Russell Toris , Graylin Trevor Jay
autogenerated on Mon Oct 6 2014 09:08:50