#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>

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 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.
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.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Creates and runs the jaco_joy_teleop node.
| argc | argument count that is passed to ros::init |
| argv | arguments that are passed to ros::init |
Definition at line 432 of file jaco_joy_teleop.cpp.