Public Member Functions | |
GraspInfo () | |
void | reset () |
Static Public Member Functions | |
static geometry_msgs::Pose | identityPose () |
static geometry_msgs::Quaternion | identityQuaternion () |
static geometry_msgs::Pose | verticalGripper () |
Public Attributes | |
object_manipulation_msgs::Grasp | grasp_ |
object_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 114 of file interactive_manipulation_backend.h.
static geometry_msgs::Pose pr2_interactive_manipulation::InteractiveManipulationBackend::GraspInfo::identityPose | ( | ) | [inline, static] |
Definition at line 99 of file interactive_manipulation_backend.h.
static geometry_msgs::Quaternion pr2_interactive_manipulation::InteractiveManipulationBackend::GraspInfo::identityQuaternion | ( | ) | [inline, static] |
Definition at line 106 of file interactive_manipulation_backend.h.
Definition at line 118 of file interactive_manipulation_backend.h.
static geometry_msgs::Pose pr2_interactive_manipulation::InteractiveManipulationBackend::GraspInfo::verticalGripper | ( | ) | [inline, static] |
Definition at line 87 of file interactive_manipulation_backend.h.
object_manipulation_msgs::Grasp pr2_interactive_manipulation::InteractiveManipulationBackend::GraspInfo::grasp_ |
Definition at line 128 of file interactive_manipulation_backend.h.
object_manipulation_msgs::GraspableObject pr2_interactive_manipulation::InteractiveManipulationBackend::GraspInfo::object_ |
Definition at line 127 of file interactive_manipulation_backend.h.
std::string pr2_interactive_manipulation::InteractiveManipulationBackend::GraspInfo::object_collision_name_ |
Definition at line 126 of file interactive_manipulation_backend.h.
geometry_msgs::Quaternion pr2_interactive_manipulation::InteractiveManipulationBackend::GraspInfo::object_orientation_ |
Definition at line 129 of file interactive_manipulation_backend.h.