5 #ifndef FRAMEFAB_PATH_POST_PROCESSOR_PROCESSPATH_H 6 #define FRAMEFAB_PATH_POST_PROCESSOR_PROCESSPATH_H 8 #include <choreo_msgs/ElementCandidatePoses.h> 9 #include <moveit_msgs/CollisionObject.h> 20 Eigen::Vector3d st_pt, Eigen::Vector3d end_pt,
21 std::vector<Eigen::Vector3d> feasible_orients,
23 double element_diameter,
25 std::string world_frame)
48 const int&
id,
const Eigen::Vector3d& st_pt,
const Eigen::Vector3d& end_pt,
49 const double& element_diameter, std::string&& shrink_type_suffix =
"")
const;
52 double shrink_length);
55 const Eigen::Vector3d& st_pt,
const Eigen::Vector3d& end_pt)
const;
72 #endif //FRAMEFAB_PATH_POST_PROCESSOR_PROCESSPATH_H UnitProcess(int index, int wireframe_id, Eigen::Vector3d st_pt, Eigen::Vector3d end_pt, std::vector< Eigen::Vector3d > feasible_orients, std::string type_str, double element_diameter, double shrink_length, std::string world_frame)
std::vector< Eigen::Vector3d > getFeasibleOrients()
Eigen::Vector3d getStartPt()
Eigen::Vector3d getEndPt()
void createShrinkedEndPoint(Eigen::Vector3d &st_pt, Eigen::Vector3d &end_st, double shrink_length)
std::vector< Eigen::Vector3d > feasible_orients_
choreo_msgs::ElementCandidatePoses asElementCandidatePoses()
geometry_msgs::Pose computeCylinderPose(const Eigen::Vector3d &st_pt, const Eigen::Vector3d &end_pt) const
moveit_msgs::CollisionObject createCollisionObject(const int &id, const Eigen::Vector3d &st_pt, const Eigen::Vector3d &end_pt, const double &element_diameter, std::string &&shrink_type_suffix="") const