Classes | |
struct | jointactuator |
Public Member Functions | |
HandController () | |
void | jointCallback (const sensor_msgs::JointStateConstPtr &simjs) |
void | ManagerThread () |
bool | service_cb (roseus::StringString::Request &req, roseus::StringString::Response &res) |
void | startSubscribe () |
~HandController () | |
Protected Types | |
typedef struct HandController::jointactuator | jointactuator |
Protected Attributes | |
bool | auto_start_ |
boost::shared_ptr < pr2_controller_manager::ControllerManager > | cm_ |
pr2_hardware_interface::HardwareInterface * | hw_ |
std::map< std::string, jointactuator > | jointactuator_map_ |
ros::NodeHandle | nh_ |
ros::Publisher | pub_ |
boost::thread | spinner_thread_ |
ros::ServiceServer | srv_ |
ros::Subscriber | sub_ |
Definition at line 10 of file hand_controller.cpp.
typedef struct HandController::jointactuator HandController::jointactuator [protected] |
HandController::HandController | ( | ) | [inline] |
Definition at line 12 of file hand_controller.cpp.
HandController::~HandController | ( | ) | [inline] |
Definition at line 96 of file hand_controller.cpp.
void HandController::jointCallback | ( | const sensor_msgs::JointStateConstPtr & | simjs | ) | [inline] |
Definition at line 125 of file hand_controller.cpp.
void HandController::ManagerThread | ( | ) | [inline] |
Definition at line 209 of file hand_controller.cpp.
bool HandController::service_cb | ( | roseus::StringString::Request & | req, |
roseus::StringString::Response & | res | ||
) | [inline] |
Definition at line 104 of file hand_controller.cpp.
void HandController::startSubscribe | ( | ) | [inline] |
Definition at line 100 of file hand_controller.cpp.
bool HandController::auto_start_ [protected] |
Definition at line 234 of file hand_controller.cpp.
boost::shared_ptr<pr2_controller_manager::ControllerManager> HandController::cm_ [protected] |
Definition at line 226 of file hand_controller.cpp.
Definition at line 225 of file hand_controller.cpp.
std::map<std::string, jointactuator> HandController::jointactuator_map_ [protected] |
Definition at line 232 of file hand_controller.cpp.
ros::NodeHandle HandController::nh_ [protected] |
Definition at line 223 of file hand_controller.cpp.
ros::Publisher HandController::pub_ [protected] |
Definition at line 227 of file hand_controller.cpp.
boost::thread HandController::spinner_thread_ [protected] |
Definition at line 224 of file hand_controller.cpp.
ros::ServiceServer HandController::srv_ [protected] |
Definition at line 229 of file hand_controller.cpp.
ros::Subscriber HandController::sub_ [protected] |
Definition at line 228 of file hand_controller.cpp.