#include <franka_gripper/franka_gripper.h>
#include <cmath>
#include <functional>
#include <thread>
#include <ros/node_handle.h>
#include <franka/exception.h>
#include <franka/gripper_state.h>
#include <franka_gripper/GraspAction.h>
#include <franka_gripper/HomingAction.h>
#include <franka_gripper/MoveAction.h>
#include <franka_gripper/StopAction.h>
Go to the source code of this file.
Namespaces | |
franka_gripper | |
Functions | |
bool | franka_gripper::grasp (const franka::Gripper &gripper, const GraspGoalConstPtr &goal) |
Calls the libfranka grasp service of the gripper. More... | |
void | franka_gripper::gripperCommandExecuteCallback (const franka::Gripper &gripper, const GraspEpsilon &grasp_epsilon, double default_speed, actionlib::SimpleActionServer< control_msgs::GripperCommandAction > *action_server, const control_msgs::GripperCommandGoalConstPtr &goal) |
Wraps the execution of a gripper command action to catch exceptions and report results. More... | |
bool | franka_gripper::homing (const franka::Gripper &gripper, const HomingGoalConstPtr &) |
Calls the libfranka homing service of the gripper. More... | |
bool | franka_gripper::move (const franka::Gripper &gripper, const MoveGoalConstPtr &goal) |
Calls the libfranka move service of the gripper. More... | |
bool | franka_gripper::stop (const franka::Gripper &gripper, const StopGoalConstPtr &) |
Calls the libfranka stop service of the gripper to stop applying force. More... | |
bool | franka_gripper::updateGripperState (const franka::Gripper &gripper, franka::GripperState *state) |
Reads a gripper state if possible. More... | |