#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 55 of file manipulation_plan.h.
Definition at line 57 of file manipulation_plan.h.
| moveit_msgs::AttachedCollisionObject pick_place::ManipulationPlanSharedData::diff_attached_object_ |
Definition at line 78 of file manipulation_plan.h.
| const robot_model::JointModelGroup* pick_place::ManipulationPlanSharedData::end_effector_group_ |
Definition at line 67 of file manipulation_plan.h.
| const robot_model::LinkModel* pick_place::ManipulationPlanSharedData::ik_link_ |
Definition at line 68 of file manipulation_plan.h.
Definition at line 70 of file manipulation_plan.h.
Definition at line 74 of file manipulation_plan.h.
| moveit_msgs::Constraints pick_place::ManipulationPlanSharedData::path_constraints_ |
Definition at line 76 of file manipulation_plan.h.
Definition at line 72 of file manipulation_plan.h.
| const robot_model::JointModelGroup* pick_place::ManipulationPlanSharedData::planning_group_ |
Definition at line 66 of file manipulation_plan.h.
Definition at line 80 of file manipulation_plan.h.