Public Member Functions | |
GraspInfo () | |
void | reset () |
Static Public Member Functions | |
static geometry_msgs::PoseStamped | identityPose (std::string frame_id) |
static geometry_msgs::Quaternion | identityQuaternion () |
static geometry_msgs::PoseStamped | verticalGripper () |
Public Attributes | |
manipulation_msgs::Grasp | grasp_ |
manipulation_msgs::GraspableObject | object_ |
std::string | object_collision_name_ |
geometry_msgs::Quaternion | object_orientation_ |
Definition at line 85 of file interactive_manipulation_backend.h.
Definition at line 118 of file interactive_manipulation_backend.h.
static geometry_msgs::PoseStamped pr2_interactive_manipulation::InteractiveManipulationBackend::GraspInfo::identityPose | ( | std::string | frame_id | ) | [inline, static] |
Definition at line 101 of file interactive_manipulation_backend.h.
static geometry_msgs::Quaternion pr2_interactive_manipulation::InteractiveManipulationBackend::GraspInfo::identityQuaternion | ( | ) | [inline, static] |
Definition at line 110 of file interactive_manipulation_backend.h.
Definition at line 122 of file interactive_manipulation_backend.h.
static geometry_msgs::PoseStamped pr2_interactive_manipulation::InteractiveManipulationBackend::GraspInfo::verticalGripper | ( | ) | [inline, static] |
Definition at line 87 of file interactive_manipulation_backend.h.
manipulation_msgs::Grasp pr2_interactive_manipulation::InteractiveManipulationBackend::GraspInfo::grasp_ |
Definition at line 132 of file interactive_manipulation_backend.h.
manipulation_msgs::GraspableObject pr2_interactive_manipulation::InteractiveManipulationBackend::GraspInfo::object_ |
Definition at line 131 of file interactive_manipulation_backend.h.
std::string pr2_interactive_manipulation::InteractiveManipulationBackend::GraspInfo::object_collision_name_ |
Definition at line 130 of file interactive_manipulation_backend.h.
geometry_msgs::Quaternion pr2_interactive_manipulation::InteractiveManipulationBackend::GraspInfo::object_orientation_ |
Definition at line 133 of file interactive_manipulation_backend.h.