moveit2
The MoveIt Motion Planning Framework for ROS 2.
Loading...
Searching...
No Matches
trajectory_generator.h
Go to the documentation of this file.
1/*********************************************************************
2 * Software License Agreement (BSD License)
3 *
4 * Copyright (c) 2018 Pilz GmbH & Co. KG
5 * All rights reserved.
6 *
7 * Redistribution and use in source and binary forms, with or without
8 * modification, are permitted provided that the following conditions
9 * are met:
10 *
11 * * Redistributions of source code must retain the above copyright
12 * notice, this list of conditions and the following disclaimer.
13 * * Redistributions in binary form must reproduce the above
14 * copyright notice, this list of conditions and the following
15 * disclaimer in the documentation and/or other materials provided
16 * with the distribution.
17 * * Neither the name of Pilz GmbH & Co. KG nor the names of its
18 * contributors may be used to endorse or promote products derived
19 * from this software without specific prior written permission.
20 *
21 * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
22 * "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT
23 * LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS
24 * FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE
25 * COPYRIGHT OWNER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT,
26 * INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING,
27 * BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES;
28 * LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER
29 * CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
30 * LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN
31 * ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE
32 * POSSIBILITY OF SUCH DAMAGE.
33 *********************************************************************/
34
35#pragma once
36
37#include <sstream>
38#include <string>
39
40#include <Eigen/Geometry>
41#include <kdl/frames.hpp>
42#include <kdl/trajectory.hpp>
46
51
53{
54CREATE_MOVEIT_ERROR_CODE_EXCEPTION(TrajectoryGeneratorInvalidLimitsException,
55 moveit_msgs::msg::MoveItErrorCodes::FAILURE);
56
57CREATE_MOVEIT_ERROR_CODE_EXCEPTION(VelocityScalingIncorrect, moveit_msgs::msg::MoveItErrorCodes::INVALID_MOTION_PLAN);
58CREATE_MOVEIT_ERROR_CODE_EXCEPTION(AccelerationScalingIncorrect,
59 moveit_msgs::msg::MoveItErrorCodes::INVALID_MOTION_PLAN);
60CREATE_MOVEIT_ERROR_CODE_EXCEPTION(UnknownPlanningGroup, moveit_msgs::msg::MoveItErrorCodes::INVALID_GROUP_NAME);
61
62CREATE_MOVEIT_ERROR_CODE_EXCEPTION(NoJointNamesInStartState, moveit_msgs::msg::MoveItErrorCodes::INVALID_ROBOT_STATE);
63CREATE_MOVEIT_ERROR_CODE_EXCEPTION(SizeMismatchInStartState, moveit_msgs::msg::MoveItErrorCodes::INVALID_ROBOT_STATE);
64CREATE_MOVEIT_ERROR_CODE_EXCEPTION(JointsOfStartStateOutOfRange,
65 moveit_msgs::msg::MoveItErrorCodes::INVALID_ROBOT_STATE);
66CREATE_MOVEIT_ERROR_CODE_EXCEPTION(NonZeroVelocityInStartState, moveit_msgs::msg::MoveItErrorCodes::INVALID_ROBOT_STATE);
67
68CREATE_MOVEIT_ERROR_CODE_EXCEPTION(NotExactlyOneGoalConstraintGiven,
69 moveit_msgs::msg::MoveItErrorCodes::INVALID_GOAL_CONSTRAINTS);
70CREATE_MOVEIT_ERROR_CODE_EXCEPTION(OnlyOneGoalTypeAllowed, moveit_msgs::msg::MoveItErrorCodes::INVALID_GOAL_CONSTRAINTS);
71
72CREATE_MOVEIT_ERROR_CODE_EXCEPTION(StartStateGoalStateMismatch,
73 moveit_msgs::msg::MoveItErrorCodes::INVALID_GOAL_CONSTRAINTS);
74CREATE_MOVEIT_ERROR_CODE_EXCEPTION(JointConstraintDoesNotBelongToGroup,
75 moveit_msgs::msg::MoveItErrorCodes::INVALID_GOAL_CONSTRAINTS);
76CREATE_MOVEIT_ERROR_CODE_EXCEPTION(JointsOfGoalOutOfRange, moveit_msgs::msg::MoveItErrorCodes::INVALID_GOAL_CONSTRAINTS);
77
78CREATE_MOVEIT_ERROR_CODE_EXCEPTION(PositionConstraintNameMissing,
79 moveit_msgs::msg::MoveItErrorCodes::INVALID_GOAL_CONSTRAINTS);
80CREATE_MOVEIT_ERROR_CODE_EXCEPTION(OrientationConstraintNameMissing,
81 moveit_msgs::msg::MoveItErrorCodes::INVALID_GOAL_CONSTRAINTS);
82CREATE_MOVEIT_ERROR_CODE_EXCEPTION(PositionOrientationConstraintNameMismatch,
83 moveit_msgs::msg::MoveItErrorCodes::INVALID_GOAL_CONSTRAINTS);
84CREATE_MOVEIT_ERROR_CODE_EXCEPTION(NoIKSolverAvailable, moveit_msgs::msg::MoveItErrorCodes::NO_IK_SOLUTION);
85CREATE_MOVEIT_ERROR_CODE_EXCEPTION(NoPrimitivePoseGiven, moveit_msgs::msg::MoveItErrorCodes::INVALID_GOAL_CONSTRAINTS);
86
93{
94public:
95 TrajectoryGenerator(const moveit::core::RobotModelConstPtr& robot_model,
97 : robot_model_(robot_model), planner_limits_(planner_limits), clock_(std::make_unique<rclcpp::Clock>())
98 {
99 }
100
101 virtual ~TrajectoryGenerator() = default;
102
109 void generate(const planning_scene::PlanningSceneConstPtr& scene, const planning_interface::MotionPlanRequest& req,
110 planning_interface::MotionPlanResponse& res, double sampling_time = 0.1);
111
112protected:
118 {
119 public:
120 std::string group_name;
121 std::string link_name;
122 Eigen::Isometry3d start_pose;
123 Eigen::Isometry3d goal_pose;
124 std::map<std::string, double> start_joint_position;
125 std::map<std::string, double> goal_joint_position;
126 std::pair<std::string, Eigen::Vector3d> circ_path_point;
127 };
128
137 std::unique_ptr<KDL::VelocityProfile> cartesianTrapVelocityProfile(double max_velocity_scaling_factor,
138 double max_acceleration_scaling_factor,
139 const std::unique_ptr<KDL::Path>& path) const;
140
141private:
142 virtual void cmdSpecificRequestValidation(const planning_interface::MotionPlanRequest& req) const;
143
153 virtual void extractMotionPlanInfo(const planning_scene::PlanningSceneConstPtr& scene,
154 const planning_interface::MotionPlanRequest& req, MotionPlanInfo& info) const = 0;
155
156 virtual void plan(const planning_scene::PlanningSceneConstPtr& scene,
157 const planning_interface::MotionPlanRequest& req, const MotionPlanInfo& plan_info,
158 double sampling_time, trajectory_msgs::msg::JointTrajectory& joint_trajectory) = 0;
159
160private:
202 void validateRequest(const planning_interface::MotionPlanRequest& req) const;
203
207 void setSuccessResponse(const moveit::core::RobotState& start_rs, const std::string& group_name,
208 const trajectory_msgs::msg::JointTrajectory& joint_trajectory,
209 const rclcpp::Time& planning_start, planning_interface::MotionPlanResponse& res) const;
210
211 void setFailureResponse(const rclcpp::Time& planning_start, planning_interface::MotionPlanResponse& res) const;
212
213 void checkForValidGroupName(const std::string& group_name) const;
214
226 void checkStartState(const moveit_msgs::msg::RobotState& start_state, const std::string& group) const;
227
228 void checkGoalConstraints(const moveit_msgs::msg::MotionPlanRequest::_goal_constraints_type& goal_constraints,
229 const std::vector<std::string>& expected_joint_names, const std::string& group_name) const;
230
231 void checkJointGoalConstraint(const moveit_msgs::msg::Constraints& constraint,
232 const std::vector<std::string>& expected_joint_names,
233 const std::string& group_name) const;
234
235 void checkCartesianGoalConstraint(const moveit_msgs::msg::Constraints& constraint,
236 const std::string& group_name) const;
237
238private:
242 sensor_msgs::msg::JointState filterGroupValues(const sensor_msgs::msg::JointState& robot_state,
243 const std::string& group) const;
244
248 static bool isScalingFactorValid(double scaling_factor);
249 static void checkVelocityScaling(double scaling_factor);
250 static void checkAccelerationScaling(double scaling_factor);
251
256 static bool isCartesianGoalGiven(const moveit_msgs::msg::Constraints& constraint);
257
261 static bool isJointGoalGiven(const moveit_msgs::msg::Constraints& constraint);
262
267 static bool isOnlyOneGoalTypeGiven(const moveit_msgs::msg::Constraints& constraint);
268
269protected:
270 const moveit::core::RobotModelConstPtr robot_model_;
272 static constexpr double MIN_SCALING_FACTOR{ 0.0001 };
273 static constexpr double MAX_SCALING_FACTOR{ 1. };
274 static constexpr double VELOCITY_TOLERANCE{ 1e-8 };
275 const std::unique_ptr<rclcpp::Clock> clock_;
276};
277
278inline bool TrajectoryGenerator::isScalingFactorValid(double scaling_factor)
279{
280 return (scaling_factor > MIN_SCALING_FACTOR && scaling_factor <= MAX_SCALING_FACTOR);
281}
282
283inline bool TrajectoryGenerator::isCartesianGoalGiven(const moveit_msgs::msg::Constraints& constraint)
284{
285 return constraint.position_constraints.size() == 1 && constraint.orientation_constraints.size() == 1;
286}
287
288inline bool TrajectoryGenerator::isJointGoalGiven(const moveit_msgs::msg::Constraints& constraint)
289{
290 return !constraint.joint_constraints.empty();
291}
292
293inline bool TrajectoryGenerator::isOnlyOneGoalTypeGiven(const moveit_msgs::msg::Constraints& constraint)
294{
295 return (isJointGoalGiven(constraint) && !isCartesianGoalGiven(constraint)) ||
296 (!isJointGoalGiven(constraint) && isCartesianGoalGiven(constraint));
297}
298
299} // namespace pilz_industrial_motion_planner
Representation of a robot's state. This includes position, velocity, acceleration and effort.
Definition robot_state.h:90
This class combines CartesianLimit and JointLimits into on single class.
This class is used to extract needed information from motion plan request.
const moveit::core::RobotModelConstPtr robot_model_
TrajectoryGenerator(const moveit::core::RobotModelConstPtr &robot_model, const pilz_industrial_motion_planner::LimitsContainer &planner_limits)
const pilz_industrial_motion_planner::LimitsContainer planner_limits_
void generate(const planning_scene::PlanningSceneConstPtr &scene, const planning_interface::MotionPlanRequest &req, planning_interface::MotionPlanResponse &res, double sampling_time=0.1)
generate robot trajectory with given sampling time
std::unique_ptr< KDL::VelocityProfile > cartesianTrapVelocityProfile(double max_velocity_scaling_factor, double max_acceleration_scaling_factor, const std::unique_ptr< KDL::Path > &path) const
build cartesian velocity profile for the path
moveit_msgs::msg::MotionPlanRequest MotionPlanRequest
Response to a planning query.
#define CREATE_MOVEIT_ERROR_CODE_EXCEPTION(EXCEPTION_CLASS_NAME, ERROR_CODE)