Public Member Functions | Private Attributes | List of all members
choreo_process_planning::ProcessPlanningManager Class Reference

#include <choreo_process_planning.h>

Public Member Functions

bool handleMoveToTargetPosePlanAndExecution (choreo_msgs::MoveToTargetPose::Request &req, choreo_msgs::MoveToTargetPose::Response &res)
 
bool handlePickNPlacePlanning (choreo_msgs::ProcessPlanning::Request &req, choreo_msgs::ProcessPlanning::Response &res)
 
bool handlePrintPlanning (choreo_msgs::ProcessPlanning::Request &req, choreo_msgs::ProcessPlanning::Response &res)
 
bool handleProcessPlanning (choreo_msgs::ProcessPlanning::Request &req, choreo_msgs::ProcessPlanning::Response &res)
 
 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)
 

Private Attributes

std::string hotend_group_name_
 
descartes_core::RobotModelPtr hotend_model_
 
moveit::core::RobotModelConstPtr moveit_model_
 
ros::NodeHandle nh_
 
ros::ServiceClient planning_scene_diff_client_
 
pluginlib::ClassLoader< descartes_core::RobotModel > plugin_loader_
 
std::string world_frame_
 

Detailed Description

Definition at line 26 of file choreo_process_planning.h.

Constructor & Destructor Documentation

choreo_process_planning::ProcessPlanningManager::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 
)

Definition at line 16 of file choreo_process_planning.cpp.

Member Function Documentation

bool choreo_process_planning::ProcessPlanningManager::handleMoveToTargetPosePlanAndExecution ( choreo_msgs::MoveToTargetPose::Request &  req,
choreo_msgs::MoveToTargetPose::Response &  res 
)

Definition at line 27 of file move_to_target_pose_planning.cpp.

bool choreo_process_planning::ProcessPlanningManager::handlePickNPlacePlanning ( choreo_msgs::ProcessPlanning::Request &  req,
choreo_msgs::ProcessPlanning::Response &  res 
)

Definition at line 25 of file picknplace_planning.cpp.

bool choreo_process_planning::ProcessPlanningManager::handlePrintPlanning ( choreo_msgs::ProcessPlanning::Request &  req,
choreo_msgs::ProcessPlanning::Response &  res 
)

Definition at line 28 of file print_process_planning.cpp.

bool choreo_process_planning::ProcessPlanningManager::handleProcessPlanning ( choreo_msgs::ProcessPlanning::Request &  req,
choreo_msgs::ProcessPlanning::Response &  res 
)

Definition at line 49 of file choreo_process_planning.cpp.

Member Data Documentation

std::string choreo_process_planning::ProcessPlanningManager::hotend_group_name_
private

Definition at line 62 of file choreo_process_planning.h.

descartes_core::RobotModelPtr choreo_process_planning::ProcessPlanningManager::hotend_model_
private

Definition at line 55 of file choreo_process_planning.h.

moveit::core::RobotModelConstPtr choreo_process_planning::ProcessPlanningManager::moveit_model_
private

Definition at line 58 of file choreo_process_planning.h.

ros::NodeHandle choreo_process_planning::ProcessPlanningManager::nh_
private

Definition at line 66 of file choreo_process_planning.h.

ros::ServiceClient choreo_process_planning::ProcessPlanningManager::planning_scene_diff_client_
private

Definition at line 67 of file choreo_process_planning.h.

pluginlib::ClassLoader<descartes_core::RobotModel> choreo_process_planning::ProcessPlanningManager::plugin_loader_
private

Definition at line 60 of file choreo_process_planning.h.

std::string choreo_process_planning::ProcessPlanningManager::world_frame_
private

Definition at line 63 of file choreo_process_planning.h.


The documentation for this class was generated from the following files:


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