5 #ifndef CHOREO_DESCARTES_CAPSULATED_LADDER_TREE_RRTSTAR_H 6 #define CHOREO_DESCARTES_CAPSULATED_LADDER_TREE_RRTSTAR_H 12 #include <descartes_trajectory/joint_trajectory_pt.h> 22 const std::vector<ConstrainedSegment>& segs,
23 const std::vector<planning_scene::PlanningScenePtr>& planning_scenes,
24 const std::vector<planning_scene::PlanningScenePtr>& planning_scenes_completed
25 = std::vector<planning_scene::PlanningScenePtr>());
29 const std::vector<ConstrainedSegmentPickNPlace>& segs);
36 std::vector<std::vector<int>> p_ids;
40 p_ids.push_back(c.sub_segment_ids_);
49 double solve(descartes_core::RobotModel& model,
double clt_rrt_unit_process_timeout,
double clt_rrt_timeout);
52 double solvePickNPlace(descartes_core::RobotModel& model,
double clt_rrt_unit_process_timeout,
double clt_rrt_timeout);
56 std::vector<descartes_core::TrajectoryPtPtr>& sol,
57 std::vector<descartes_planner::LadderGraph>& graphs,
58 std::vector<int>& graph_indices,
59 const bool use_saved_graph);
76 #endif //DESCARTES_CAPSULATED_LADDER_TREE_RRTSTAR_H
double solve(descartes_core::RobotModel &model, double clt_rrt_unit_process_timeout, double clt_rrt_timeout)
CapsulatedLadderTreeRRTstar(const std::vector< ConstrainedSegment > &segs, const std::vector< planning_scene::PlanningScenePtr > &planning_scenes, const std::vector< planning_scene::PlanningScenePtr > &planning_scenes_completed=std::vector< planning_scene::PlanningScenePtr >())
double solvePickNPlace(descartes_core::RobotModel &model, double clt_rrt_unit_process_timeout, double clt_rrt_timeout)
void extractSolution(descartes_core::RobotModel &model, std::vector< descartes_core::TrajectoryPtPtr > &sol, std::vector< descartes_planner::LadderGraph > &graphs, std::vector< int > &graph_indices, const bool use_saved_graph)
std::vector< std::vector< int > > getGraphPartitionIds() const
std::vector< CapRung > cap_rungs_
~CapsulatedLadderTreeRRTstar()