#include <seed_r7_hand_controller.h>
Public Member Functions | |
| bool | HandControlCallback (seed_r7_ros_controller::HandControl::Request &_req, seed_r7_ros_controller::HandControl::Response &_res) |
| HandController (const ros::NodeHandle &_nh, robot_hardware::RobotHW *_in_hw) | |
| ~HandController () | |
Private Attributes | |
| ros::ServiceServer | grasp_control_server_ |
| robot_hardware::RobotHW * | hw_ |
| int | left_number_ |
| ros::NodeHandle | nh_ |
| int | right_number_ |
| const uint16_t | SCRIPT_CANCEL = 4 |
| const uint16_t | SCRIPT_GRASP = 2 |
| const uint16_t | SCRIPT_UNGRASP = 3 |
Definition at line 11 of file seed_r7_hand_controller.h.
| robot_hardware::HandController::HandController | ( | const ros::NodeHandle & | _nh, |
| robot_hardware::RobotHW * | _in_hw | ||
| ) |
Definition at line 5 of file seed_r7_hand_controller.cpp.
| robot_hardware::HandController::~HandController | ( | ) |
Definition at line 28 of file seed_r7_hand_controller.cpp.
| bool robot_hardware::HandController::HandControlCallback | ( | seed_r7_ros_controller::HandControl::Request & | _req, |
| seed_r7_ros_controller::HandControl::Response & | _res | ||
| ) |
Definition at line 33 of file seed_r7_hand_controller.cpp.
|
private |
Definition at line 20 of file seed_r7_hand_controller.h.
|
private |
Definition at line 21 of file seed_r7_hand_controller.h.
|
private |
Definition at line 25 of file seed_r7_hand_controller.h.
|
private |
Definition at line 22 of file seed_r7_hand_controller.h.
|
private |
Definition at line 24 of file seed_r7_hand_controller.h.
|
private |
Definition at line 29 of file seed_r7_hand_controller.h.
|
private |
Definition at line 27 of file seed_r7_hand_controller.h.
|
private |
Definition at line 28 of file seed_r7_hand_controller.h.