#include <kdl/tree.hpp>#include <kdl/jntarray.hpp>#include <kdl/frames.hpp>#include "r2_msgs/GripperPositionState.h"#include "r2_msgs/StringArray.h"#include "r2_msgs/GripperPositionCommand.h"#include "r2_msgs/JointControlDataArray.h"#include "actionlib_msgs/GoalStatusArray.h"#include "robodyn_utilities/BaseGripperConverter.h"

Go to the source code of this file.
Classes | |
| struct | EndEffectorData |
| struct | GripperControlModes |
| class | GripperSupervisor |
Enumerations | |
| enum | GripperSupervisorStates { IDLE = 0, FAULT, FAILURE, LOCK, RELEASE, SET, RELEASE_PENDING, SET_PENDING, LOCK_PENDING, REQUEST_PENDING } |
| IDLE | |
| FAULT | |
| FAILURE | |
| LOCK | |
| RELEASE | |
| SET | |
| RELEASE_PENDING | |
| SET_PENDING | |
| LOCK_PENDING | |
| REQUEST_PENDING |
Definition at line 22 of file GripperSupervisor.h.