path_transitions.h
Go to the documentation of this file.
1 //
2 // Created by yijiangh on 7/5/17.
3 //
4 
5 #ifndef CHOREO_PROCESS_PLANNING_PATH_TRANSITIONS_H
6 #define CHOREO_PROCESS_PLANNING_PATH_TRANSITIONS_H
7 
8 #include "common_utils.h"
9 
10 // msgs
11 #include <choreo_msgs/AssemblySequencePickNPlace.h>
12 #include <choreo_msgs/ElementCandidatePoses.h>
14 
16 
17 #include <descartes_core/robot_model.h>
19 
20 #include <Eigen/Geometry>
21 
23 {
24 
25 
27 {
28  double linear_vel;
29  double linear_disc;
30 
31  // used only in spatial extrusion
32  double angular_disc;
33  double retract_dist;
34 };
35 
36 // TODO: overload for picknplace
37 std::vector<descartes_planner::ConstrainedSegmentPickNPlace> toDescartesConstrainedPath(
38  const choreo_msgs::AssemblySequencePickNPlace& task_sequence,
39  const std::vector<std::vector<planning_scene::PlanningScenePtr>>& planning_scene_pick,
40  const double& linear_vel, const double& linear_disc);
41 
42 // TODO: should update this to a more universal one
43 // this version is dedicated to spatial extrusion
44 std::vector<descartes_planner::ConstrainedSegment> toDescartesConstrainedPath(
45  const std::vector<choreo_msgs::ElementCandidatePoses>& task_sequence,
46  const ConstrainedSegParameters& transition_params);
47 
48 std::vector<descartes_planner::ConstrainedSegment> toDescartesConstrainedPath(
49  const std::vector<choreo_msgs::ElementCandidatePoses>& task_sequence,
50  const double& linear_vel, const double& linear_disc,
51  const double& angular_disc, const double& retract_dist);
52 
53 bool retractPath(const std::vector<double>& start_joint, double retract_dist, double TCP_speed,
54  const std::vector<Eigen::Matrix3d>& eef_directions,
55  descartes_core::RobotModelPtr& descartes_model,
56  std::vector<std::vector<double>>& retract_jt_traj);
57 }
58 
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)


choreo_process_planning
Author(s): Yijiang Huang
autogenerated on Thu Jul 18 2019 03:59:02