Public Member Functions | Private Attributes | List of all members
robot_hardware::HandController Class Reference

#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::RobotHWhw_
 
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
 

Detailed Description

Definition at line 11 of file seed_r7_hand_controller.h.

Constructor & Destructor Documentation

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.

Member Function Documentation

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.

Member Data Documentation

ros::ServiceServer robot_hardware::HandController::grasp_control_server_
private

Definition at line 20 of file seed_r7_hand_controller.h.

robot_hardware::RobotHW* robot_hardware::HandController::hw_
private

Definition at line 21 of file seed_r7_hand_controller.h.

int robot_hardware::HandController::left_number_
private

Definition at line 25 of file seed_r7_hand_controller.h.

ros::NodeHandle robot_hardware::HandController::nh_
private

Definition at line 22 of file seed_r7_hand_controller.h.

int robot_hardware::HandController::right_number_
private

Definition at line 24 of file seed_r7_hand_controller.h.

const uint16_t robot_hardware::HandController::SCRIPT_CANCEL = 4
private

Definition at line 29 of file seed_r7_hand_controller.h.

const uint16_t robot_hardware::HandController::SCRIPT_GRASP = 2
private

Definition at line 27 of file seed_r7_hand_controller.h.

const uint16_t robot_hardware::HandController::SCRIPT_UNGRASP = 3
private

Definition at line 28 of file seed_r7_hand_controller.h.


The documentation for this class was generated from the following files:


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