$search

pr2_wrappers::GripperController Class Reference

#include <gripper_controller.h>

List of all members.

Public Member Functions

bool commandGripperValue (std::string arm_name, double value)
 Sends a command to the gripper action, does not wait for result.
bool getGripperValue (std::string arm_name, double &value)
 Returns the current value of the gripper joint.
 GripperController ()
 ~GripperController ()

Static Public Attributes

static const double GRIPPER_CLOSED = 0.0
 Consts for gripper fully open or fully closed for gripper controller.
static const double GRIPPER_OPEN = 0.086
 Consts for gripper fully open or fully closed for gripper controller.

Private Member Functions

std::string virtualJointName (std::string arm_name)
 Gets the virtual gripper joint name for the given arm.

Private Attributes

object_manipulator::MultiArmActionWrapper
< pr2_controllers_msgs::Pr2GripperCommandAction
gripper_action_client_
 The gripper command action.
ros::NodeHandle priv_nh_
 The private namespace node handle.
ros::NodeHandle root_nh_
 The root namespace node handle.

Detailed Description

Definition at line 47 of file gripper_controller.h.


Constructor & Destructor Documentation

pr2_wrappers::GripperController::GripperController (  ) 

Definition at line 41 of file gripper_controller.cpp.

pr2_wrappers::GripperController::~GripperController (  ) 

Definition at line 48 of file gripper_controller.cpp.


Member Function Documentation

bool pr2_wrappers::GripperController::commandGripperValue ( std::string  arm_name,
double  value 
)

Sends a command to the gripper action, does not wait for result.

Definition at line 90 of file gripper_controller.cpp.

bool pr2_wrappers::GripperController::getGripperValue ( std::string  arm_name,
double &  value 
)

Returns the current value of the gripper joint.

Definition at line 58 of file gripper_controller.cpp.

std::string pr2_wrappers::GripperController::virtualJointName ( std::string  arm_name  )  [private]

Gets the virtual gripper joint name for the given arm.

Definition at line 52 of file gripper_controller.cpp.


Member Data Documentation

The gripper command action.

Definition at line 58 of file gripper_controller.h.

Consts for gripper fully open or fully closed for gripper controller.

Definition at line 80 of file gripper_controller.h.

const double pr2_wrappers::GripperController::GRIPPER_OPEN = 0.086 [static]

Consts for gripper fully open or fully closed for gripper controller.

Definition at line 78 of file gripper_controller.h.

The private namespace node handle.

Definition at line 55 of file gripper_controller.h.

The root namespace node handle.

Definition at line 52 of file gripper_controller.h.


The documentation for this class was generated from the following files:
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Properties Friends


pr2_wrappers
Author(s): Adam Leeper
autogenerated on Tue Mar 5 14:28:04 2013