Wraps the Object Manipulator in a ROS API. More...
Public Member Functions | |
ObjectManipulatorNode () | |
Private Member Functions | |
void | pickupCallback (const object_manipulation_msgs::PickupGoal::ConstPtr &goal) |
Callback for the pickup action. | |
void | placeCallback (const object_manipulation_msgs::PlaceGoal::ConstPtr &goal) |
Callback for the placing action. | |
Private Attributes | |
ObjectManipulator | object_manipulator_ |
The instance of the manipulator used to perform all tasks. | |
actionlib::SimpleActionServer < object_manipulation_msgs::PickupAction > | pickup_action_server_ |
The action server for grasping. | |
actionlib::SimpleActionServer < object_manipulation_msgs::PlaceAction > | place_action_server_ |
The action server for placing. | |
ros::NodeHandle | priv_nh_ |
The private ROS node handle. |
Wraps the Object Manipulator in a ROS API.
Definition at line 43 of file object_manipulator_node.cpp.
object_manipulator::ObjectManipulatorNode::ObjectManipulatorNode | ( | ) | [inline] |
Definition at line 71 of file object_manipulator_node.cpp.
void object_manipulator::ObjectManipulatorNode::pickupCallback | ( | const object_manipulation_msgs::PickupGoal::ConstPtr & | goal | ) | [inline, private] |
Callback for the pickup action.
Definition at line 59 of file object_manipulator_node.cpp.
void object_manipulator::ObjectManipulatorNode::placeCallback | ( | const object_manipulation_msgs::PlaceGoal::ConstPtr & | goal | ) | [inline, private] |
Callback for the placing action.
Definition at line 65 of file object_manipulator_node.cpp.
The instance of the manipulator used to perform all tasks.
Definition at line 50 of file object_manipulator_node.cpp.
actionlib::SimpleActionServer<object_manipulation_msgs::PickupAction> object_manipulator::ObjectManipulatorNode::pickup_action_server_ [private] |
The action server for grasping.
Definition at line 53 of file object_manipulator_node.cpp.
actionlib::SimpleActionServer<object_manipulation_msgs::PlaceAction> object_manipulator::ObjectManipulatorNode::place_action_server_ [private] |
The action server for placing.
Definition at line 56 of file object_manipulator_node.cpp.
ros::NodeHandle object_manipulator::ObjectManipulatorNode::priv_nh_ [private] |
The private ROS node handle.
Definition at line 47 of file object_manipulator_node.cpp.