Classes | Typedefs | Functions
descartes_planner Namespace Reference

Classes

struct  CapRung
 
class  CapsulatedLadderTreeRRTstar
 
class  CapVert
 
struct  ConstrainedSegment
 
struct  ConstrainedSegmentPickNPlace
 

Typedefs

typedef boost::function< double(const double *, const double *)> CostFunction
 
typedef boost::function< double(const double *, const double *)> CostFunction
 

Functions

void appendInTime (LadderGraph &current, const LadderGraph &next)
 
bool checkFeasibility (descartes_core::RobotModel &model, const std::vector< Eigen::Affine3d > &poses, descartes_planner::CapRung &cap_rung, descartes_planner::CapVert &cap_vert)
 
bool checkFeasibilityPickNPlace (descartes_core::RobotModel &model, const std::vector< std::vector< Eigen::Affine3d >> &poses, descartes_planner::CapRung &cap_rung, descartes_planner::CapVert &cap_vert)
 
std::vector< Eigen::Vector3d > discretizePositions (const Eigen::Vector3d &start, const Eigen::Vector3d &stop, const double ds)
 
bool domainDiscreteEnumerationCheck (descartes_core::RobotModel &model, descartes_planner::CapRung &cap_rung, descartes_planner::CapVert &cap_vert)
 
LadderGraph generateLadderGraphFromPoses (const descartes_core::RobotModel &model, const std::vector< Eigen::Affine3d > &ps, const double dt)
 
std::vector< Eigen::Affine3d > generateSample (const descartes_planner::CapRung &cap_rung, descartes_planner::CapVert &cap_vert)
 
std::vector< std::vector< Eigen::Affine3d > > generateSamplePickNPlace (const descartes_planner::CapRung &cap_rung, descartes_planner::CapVert &cap_vert)
 
Eigen::Affine3d makePose (const Eigen::Vector3d &position, const Eigen::Matrix3d &orientation, const double z_axis_angle)
 
Eigen::Affine3d makePose (const Eigen::Vector3d &position, const Eigen::Matrix3d &orientation)
 
double randomSampleDouble (double lower, double upper)
 
int randomSampleInt (int lower, int upper)
 
LadderGraph sampleConstrainedPaths (const descartes_core::RobotModel &model, ConstrainedSegment &segment)
 
LadderGraph sampleSingleConfig (const descartes_core::RobotModel &model, const std::vector< Eigen::Vector3d > &origins, const double dt, const Eigen::Matrix3d &orientation, const double z_axis_angle)
 
LadderGraph sampleSingleConfig (const descartes_core::RobotModel &model, const std::vector< Eigen::Vector3d > &origins, const Eigen::Matrix3d &orientation, const double dt)
 

Typedef Documentation

typedef boost::function<double(const double*, const double*)> descartes_planner::CostFunction

Definition at line 16 of file path_transitions.cpp.



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