Main Page
+
Namespaces
Namespace List
+
Classes
Class List
Class Hierarchy
+
Class Members
+
All
a
b
c
d
e
f
g
h
i
j
k
l
m
n
o
p
r
s
t
u
v
w
x
y
~
+
Functions
a
c
g
h
i
l
m
o
r
s
t
u
v
w
~
+
Variables
a
b
c
d
f
g
h
i
j
k
l
m
n
o
p
r
s
t
u
v
w
x
y
Enumerations
+
Enumerator
c
e
f
n
p
r
v
+
Files
File List
+
File Members
All
Functions
Macros
include
seed_r7_ros_controller
seed_r7_hand_controller.h
Go to the documentation of this file.
1
#ifndef _HAND_CONTROLLER_H_
2
#define _HAND_CONTROLLER_H_
3
4
#include "
seed_r7_ros_controller/seed_r7_robot_hardware.h
"
5
#include <seed_r7_ros_controller/HandControl.h>
6
7
8
namespace
robot_hardware
9
{
10
11
class
HandController
12
{
13
public
:
14
HandController
(
const
ros::NodeHandle
& _nh,
robot_hardware::RobotHW
*_in_hw);
15
~HandController
();
16
17
bool
HandControlCallback
(seed_r7_ros_controller::HandControl::Request& _req, seed_r7_ros_controller::HandControl::Response& _res);
18
19
private
:
20
ros::ServiceServer
grasp_control_server_
;
21
robot_hardware::RobotHW
*
hw_
;
22
ros::NodeHandle
nh_
;
23
24
int
right_number_
;
25
int
left_number_
;
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
robot_hardware::HandController::nh_
ros::NodeHandle nh_
Definition:
seed_r7_hand_controller.h:22
robot_hardware
Definition:
seed_r7_hand_controller.h:8
ros::NodeHandle
robot_hardware::HandController::~HandController
~HandController()
Definition:
seed_r7_hand_controller.cpp:28
robot_hardware::RobotHW
Definition:
seed_r7_robot_hardware.h:71
robot_hardware::HandController::SCRIPT_UNGRASP
const uint16_t SCRIPT_UNGRASP
Definition:
seed_r7_hand_controller.h:28
ros::ServiceServer
robot_hardware::HandController::right_number_
int right_number_
Definition:
seed_r7_hand_controller.h:24
robot_hardware::HandController::HandController
HandController(const ros::NodeHandle &_nh, robot_hardware::RobotHW *_in_hw)
Definition:
seed_r7_hand_controller.cpp:5
robot_hardware::HandController::hw_
robot_hardware::RobotHW * hw_
Definition:
seed_r7_hand_controller.h:21
robot_hardware::HandController
Definition:
seed_r7_hand_controller.h:11
seed_r7_robot_hardware.h
robot_hardware::HandController::HandControlCallback
bool HandControlCallback(seed_r7_ros_controller::HandControl::Request &_req, seed_r7_ros_controller::HandControl::Response &_res)
Definition:
seed_r7_hand_controller.cpp:33
robot_hardware::HandController::SCRIPT_CANCEL
const uint16_t SCRIPT_CANCEL
Definition:
seed_r7_hand_controller.h:29
robot_hardware::HandController::left_number_
int left_number_
Definition:
seed_r7_hand_controller.h:25
robot_hardware::HandController::grasp_control_server_
ros::ServiceServer grasp_control_server_
Definition:
seed_r7_hand_controller.h:20
robot_hardware::HandController::SCRIPT_GRASP
const uint16_t SCRIPT_GRASP
Definition:
seed_r7_hand_controller.h:27
seed_r7_ros_controller
Author(s): Yohei Kakiuchi
autogenerated on Sat Mar 4 2023 03:56:25