59 #include <moveit_task_constructor_msgs/ExecuteTaskSolutionAction.h>
82 void loadParameters();
84 static constexpr
char LOGNAME[]{
"pick_place_task" };
88 std::string task_name_;
89 moveit::task_constructor::TaskPtr task_;
92 std::string arm_group_name_;
93 std::string eef_name_;
94 std::string hand_group_name_;
95 std::string hand_frame_;
98 std::vector<std::string> support_surfaces_;
99 std::string object_reference_frame_;
100 std::string surface_link_;
101 std::string object_name_;
102 std::string world_frame_;
103 std::vector<double> object_dimensions_;
106 std::string hand_open_pose_;
107 std::string hand_close_pose_;
108 std::string arm_home_pose_;
111 Eigen::Isometry3d grasp_frame_transform_;
112 double approach_object_min_dist_;
113 double approach_object_max_dist_;
114 double lift_object_min_dist_;
115 double lift_object_max_dist_;
118 geometry_msgs::Pose place_pose_;
119 double place_surface_offset_;