Public Member Functions | |
GraspInfo () | |
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 57 of file interactive_manipulation_backend.h.
pr2_interactive_manipulation::InteractiveManipulationBackend::GraspInfo::GraspInfo | ( | ) | [inline] |
Definition at line 86 of file interactive_manipulation_backend.h.
static geometry_msgs::Pose pr2_interactive_manipulation::InteractiveManipulationBackend::GraspInfo::identityPose | ( | ) | [inline, static] |
Definition at line 71 of file interactive_manipulation_backend.h.
static geometry_msgs::Quaternion pr2_interactive_manipulation::InteractiveManipulationBackend::GraspInfo::identityQuaternion | ( | ) | [inline, static] |
Definition at line 78 of file interactive_manipulation_backend.h.
static geometry_msgs::Pose pr2_interactive_manipulation::InteractiveManipulationBackend::GraspInfo::verticalGripper | ( | ) | [inline, static] |
Definition at line 59 of file interactive_manipulation_backend.h.
object_manipulation_msgs::Grasp pr2_interactive_manipulation::InteractiveManipulationBackend::GraspInfo::grasp_ |
Definition at line 94 of file interactive_manipulation_backend.h.
object_manipulation_msgs::GraspableObject pr2_interactive_manipulation::InteractiveManipulationBackend::GraspInfo::object_ |
Definition at line 93 of file interactive_manipulation_backend.h.
std::string pr2_interactive_manipulation::InteractiveManipulationBackend::GraspInfo::object_collision_name_ |
Definition at line 92 of file interactive_manipulation_backend.h.
geometry_msgs::Quaternion pr2_interactive_manipulation::InteractiveManipulationBackend::GraspInfo::object_orientation_ |
Definition at line 95 of file interactive_manipulation_backend.h.