Classes | Defines | Functions
jaco_joy_teleop.h File Reference
#include <ros/ros.h>
#include <wpi_jaco_msgs/AngularCommand.h>
#include <wpi_jaco_msgs/CartesianCommand.h>
#include <wpi_jaco_msgs/EStop.h>
#include <sensor_msgs/Joy.h>
Include dependency graph for jaco_joy_teleop.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  jaco_joy_teleop
 Allows for control of the JACO arm with a joystick. More...

Defines

#define ANALOG   0
#define ARM_CONTROL   0
 Allows for control of the jaco arm with a joystick.
#define DIGITAL   1
#define FINGER_CONTROL   1
#define MAX_ANG_VEL   1.047
#define MAX_FINGER_VEL   30
#define MAX_TRANS_VEL   .175

Functions

int main (int argc, char **argv)
 Creates and runs the jaco_joy_teleop node.

Define Documentation

#define ANALOG   0

Definition at line 26 of file jaco_joy_teleop.h.

#define ARM_CONTROL   0

Allows for control of the jaco arm with a joystick.

.h jaco_joy_teleop creates a ROS node that allows for the control of the JACO arm with a joystick. This node listens to a /joy topic.

Author:
David Kent, GT - dekent@gatech.edu
Date:
June 25, 2014

Definition at line 22 of file jaco_joy_teleop.h.

#define DIGITAL   1

Definition at line 27 of file jaco_joy_teleop.h.

#define FINGER_CONTROL   1

Definition at line 23 of file jaco_joy_teleop.h.

#define MAX_ANG_VEL   1.047

The maximum angular velocity.

Definition at line 47 of file jaco_joy_teleop.h.

#define MAX_FINGER_VEL   30

The maximum velocity for a finger.

Definition at line 40 of file jaco_joy_teleop.h.

#define MAX_TRANS_VEL   .175

The maximum translational velocity.

Definition at line 34 of file jaco_joy_teleop.h.


Function Documentation

int main ( int  argc,
char **  argv 
)

Creates and runs the jaco_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 432 of file jaco_joy_teleop.cpp.



jaco_teleop
Author(s): David Kent
autogenerated on Thu Jun 6 2019 19:43:28