#include <manipulation_plan.h>
Public Member Functions | |
ManipulationPlanSharedData () | |
Public Attributes | |
moveit_msgs::AttachedCollisionObject | diff_attached_object_ |
const robot_model::JointModelGroup * | end_effector_group_ |
const robot_model::LinkModel * | ik_link_ |
unsigned int | max_goal_sampling_attempts_ |
bool | minimize_object_distance_ |
moveit_msgs::Constraints | path_constraints_ |
std::string | planner_id_ |
const robot_model::JointModelGroup * | planning_group_ |
ros::WallTime | timeout_ |
Definition at line 56 of file manipulation_plan.h.
Definition at line 58 of file manipulation_plan.h.
moveit_msgs::AttachedCollisionObject pick_place::ManipulationPlanSharedData::diff_attached_object_ |
Definition at line 79 of file manipulation_plan.h.
const robot_model::JointModelGroup* pick_place::ManipulationPlanSharedData::end_effector_group_ |
Definition at line 68 of file manipulation_plan.h.
const robot_model::LinkModel* pick_place::ManipulationPlanSharedData::ik_link_ |
Definition at line 69 of file manipulation_plan.h.
Definition at line 71 of file manipulation_plan.h.
Definition at line 75 of file manipulation_plan.h.
moveit_msgs::Constraints pick_place::ManipulationPlanSharedData::path_constraints_ |
Definition at line 77 of file manipulation_plan.h.
Definition at line 73 of file manipulation_plan.h.
const robot_model::JointModelGroup* pick_place::ManipulationPlanSharedData::planning_group_ |
Definition at line 67 of file manipulation_plan.h.
Definition at line 81 of file manipulation_plan.h.