1 #ifndef CHOREO_PROCESS_PLANNING_H 2 #define CHOREO_PROCESS_PLANNING_H 5 #include <choreo_msgs/ProcessPlanning.h> 6 #include <choreo_msgs/MoveToTargetPose.h> 9 #include <choreo_msgs/ElementCandidatePoses.h> 10 #include <moveit_msgs/CollisionObject.h> 13 #include <descartes_core/robot_model.h> 30 const std::string& hotend_group,
const std::string& hotend_tcp,
const std::string& hotend_base,
31 const std::string& robot_model_plugin);
36 choreo_msgs::ProcessPlanning::Response&
res);
40 choreo_msgs::ProcessPlanning::Response& res);
44 choreo_msgs::ProcessPlanning::Request& req,
45 choreo_msgs::ProcessPlanning::Response& res);
49 choreo_msgs::MoveToTargetPose::Request& req,
50 choreo_msgs::MoveToTargetPose::Response& res);
bool handleProcessPlanning(choreo_msgs::ProcessPlanning::Request &req, choreo_msgs::ProcessPlanning::Response &res)
descartes_core::RobotModelPtr hotend_model_
moveit::core::RobotModelConstPtr moveit_model_
pluginlib::ClassLoader< descartes_core::RobotModel > plugin_loader_
ProcessPlanningManager(const std::string &world_frame, const std::string &hotend_group, const std::string &hotend_tcp, const std::string &hotend_base, const std::string &robot_model_plugin)
std::string hotend_group_name_
bool handlePrintPlanning(choreo_msgs::ProcessPlanning::Request &req, choreo_msgs::ProcessPlanning::Response &res)
bool handleMoveToTargetPosePlanAndExecution(choreo_msgs::MoveToTargetPose::Request &req, choreo_msgs::MoveToTargetPose::Response &res)
ros::ServiceClient planning_scene_diff_client_
bool handlePickNPlacePlanning(choreo_msgs::ProcessPlanning::Request &req, choreo_msgs::ProcessPlanning::Response &res)