Classes | Typedefs | Functions | Variables
test_gripper_joint_trajectory.cpp File Reference
#include <ros/ros.h>
#include <control_msgs/JointTrajectoryAction.h>
#include <actionlib/client/simple_action_client.h>
#include <sensor_msgs/JointState.h>
Include dependency graph for test_gripper_joint_trajectory.cpp:

Go to the source code of this file.

Classes

class  TestGripperJointTrajectory
 A joint angle below this value indicates there is nothing inside the gripper. More...

Typedefs

typedef
actionlib::SimpleActionClient
< control_msgs::JointTrajectoryAction > 
TrajClient

Functions

int main (int argc, char **argv)

Variables

static const double GRIPPER_CLOSED_ANGLE = -0.44
 Constants for gripper fully open or fully closed (should be equal to the value in the urdf description)
static const double GRIPPER_OPEN_ANGLE = 0.30
 Constants for gripper fully open or fully closed (should be equal to the value in the urdf description)

Typedef Documentation

typedef actionlib::SimpleActionClient<control_msgs::JointTrajectoryAction> TrajClient

Definition at line 32 of file test_gripper_joint_trajectory.cpp.


Function Documentation

int main ( int  argc,
char **  argv 
)

Definition at line 216 of file test_gripper_joint_trajectory.cpp.


Variable Documentation

const double GRIPPER_CLOSED_ANGLE = -0.44 [static]

Constants for gripper fully open or fully closed (should be equal to the value in the urdf description)

Definition at line 38 of file test_gripper_joint_trajectory.cpp.

const double GRIPPER_OPEN_ANGLE = 0.30 [static]

Constants for gripper fully open or fully closed (should be equal to the value in the urdf description)

Definition at line 35 of file test_gripper_joint_trajectory.cpp.



katana_gazebo_plugins
Author(s): Martin Günther
autogenerated on Thu Jun 6 2019 21:42:23