5 #ifndef CHOREO_PROCESS_PLANNING_PATH_TRANSITIONS_H 6 #define CHOREO_PROCESS_PLANNING_PATH_TRANSITIONS_H 11 #include <choreo_msgs/AssemblySequencePickNPlace.h> 12 #include <choreo_msgs/ElementCandidatePoses.h> 17 #include <descartes_core/robot_model.h> 20 #include <Eigen/Geometry> 38 const choreo_msgs::AssemblySequencePickNPlace& task_sequence,
39 const std::vector<std::vector<planning_scene::PlanningScenePtr>>& planning_scene_pick,
45 const std::vector<choreo_msgs::ElementCandidatePoses>& task_sequence,
49 const std::vector<choreo_msgs::ElementCandidatePoses>& task_sequence,
54 const std::vector<Eigen::Matrix3d>& eef_directions,
55 descartes_core::RobotModelPtr& descartes_model,
56 std::vector<std::vector<double>>& retract_jt_traj);
59 #endif //CHOREO_PROCESS_PLANNING_PATH_TRANSITIONS_H
bool retractPath(const std::vector< double > &start_joint, double retract_dist, double TCP_speed, const std::vector< Eigen::Matrix3d > &eef_directions, descartes_core::RobotModelPtr &model, std::vector< std::vector< double >> &retract_jt_traj)
std::vector< descartes_planner::ConstrainedSegmentPickNPlace > toDescartesConstrainedPath(const choreo_msgs::AssemblySequencePickNPlace &as_pnp, const std::vector< std::vector< planning_scene::PlanningScenePtr >> &planning_scene_subprocess, const double &linear_vel, const double &linear_disc)