seed_r7_hand_controller.h
Go to the documentation of this file.
1 #ifndef _HAND_CONTROLLER_H_
2 #define _HAND_CONTROLLER_H_
3 
5 #include <seed_r7_ros_controller/HandControl.h>
6 
7 
8 namespace robot_hardware
9 {
10 
12 {
13 public:
16 
17  bool HandControlCallback(seed_r7_ros_controller::HandControl::Request& _req, seed_r7_ros_controller::HandControl::Response& _res);
18 
19 private:
23 
26 
27  const uint16_t SCRIPT_GRASP = 2;
28  const uint16_t SCRIPT_UNGRASP = 3;
29  const uint16_t SCRIPT_CANCEL = 4;
30 
31 
32 };
33 
34 }
35 
36 #endif
HandController(const ros::NodeHandle &_nh, robot_hardware::RobotHW *_in_hw)
bool HandControlCallback(seed_r7_ros_controller::HandControl::Request &_req, seed_r7_ros_controller::HandControl::Response &_res)


seed_r7_ros_controller
Author(s): Yohei Kakiuchi
autogenerated on Sun Apr 18 2021 02:40:34