moveit2
The MoveIt Motion Planning Framework for ROS 2.
Classes | Namespaces | Typedefs | Functions
plan_components_builder.h File Reference
#include <memory>
#include <string>
#include <moveit/robot_model/robot_model.h>
#include <moveit/robot_trajectory/robot_trajectory.h>
#include <moveit/planning_interface/planning_interface.h>
#include <pilz_industrial_motion_planner/trajectory_blend_request.h>
#include <pilz_industrial_motion_planner/trajectory_blender.h>
#include <pilz_industrial_motion_planner/trajectory_functions.h>
#include <pilz_industrial_motion_planner/trajectory_generation_exceptions.h>
Include dependency graph for plan_components_builder.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  pilz_industrial_motion_planner::PlanComponentsBuilder
 Helper class to encapsulate the merge and blend process of trajectories. More...
 

Namespaces

 pilz_industrial_motion_planner
 

Typedefs

using pilz_industrial_motion_planner::TipFrameFunc_t = std::function< const std::string &(const std::string &)>
 

Functions

 pilz_industrial_motion_planner::CREATE_MOVEIT_ERROR_CODE_EXCEPTION (NoBlenderSetException, moveit_msgs::msg::MoveItErrorCodes::FAILURE)
 
 pilz_industrial_motion_planner::CREATE_MOVEIT_ERROR_CODE_EXCEPTION (NoTipFrameFunctionSetException, moveit_msgs::msg::MoveItErrorCodes::FAILURE)
 
 pilz_industrial_motion_planner::CREATE_MOVEIT_ERROR_CODE_EXCEPTION (NoRobotModelSetException, moveit_msgs::msg::MoveItErrorCodes::FAILURE)
 
 pilz_industrial_motion_planner::CREATE_MOVEIT_ERROR_CODE_EXCEPTION (BlendingFailedException, moveit_msgs::msg::MoveItErrorCodes::FAILURE)