Nav2 Navigation Stack - rolling  main
ROS 2 Navigation Stack
standard_traj_generator.cpp
1 /*
2  * Software License Agreement (BSD License)
3  *
4  * Copyright (c) 2017, Locus Robotics
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 the copyright holder 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 HOLDER 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 #include "dwb_plugins/standard_traj_generator.hpp"
36 #include <string>
37 #include <vector>
38 #include <algorithm>
39 #include <memory>
40 #include "dwb_plugins/xy_theta_iterator.hpp"
41 #include "pluginlib/class_list_macros.hpp"
42 #include "dwb_core/exceptions.hpp"
43 #include "nav2_ros_common/node_utils.hpp"
44 #include "tf2/utils.hpp"
45 #include "tf2_geometry_msgs/tf2_geometry_msgs.hpp"
46 
47 namespace dwb_plugins
48 {
49 
51  const nav2::LifecycleNode::SharedPtr & nh,
52  const std::string & plugin_name)
53 {
54  plugin_name_ = plugin_name;
55  kinematics_handler_ = std::make_shared<KinematicsHandler>();
56  kinematics_handler_->initialize(nh, plugin_name_);
58 
59  nav2::declare_parameter_if_not_declared(
60  nh,
61  plugin_name + ".sim_time", rclcpp::ParameterValue(1.7));
62  nav2::declare_parameter_if_not_declared(
63  nh,
64  plugin_name + ".discretize_by_time", rclcpp::ParameterValue(false));
65 
66  nav2::declare_parameter_if_not_declared(
67  nh,
68  plugin_name + ".time_granularity", rclcpp::ParameterValue(0.5));
69  nav2::declare_parameter_if_not_declared(
70  nh,
71  plugin_name + ".linear_granularity", rclcpp::ParameterValue(0.5));
72  nav2::declare_parameter_if_not_declared(
73  nh,
74  plugin_name + ".angular_granularity", rclcpp::ParameterValue(0.025));
75  nav2::declare_parameter_if_not_declared(
76  nh,
77  plugin_name + ".include_last_point", rclcpp::ParameterValue(true));
78 
79  nav2::declare_parameter_if_not_declared(
80  nh,
81  plugin_name + ".limit_vel_cmd_in_traj", rclcpp::ParameterValue(false));
82 
83  /*
84  * If discretize_by_time, then sim_granularity represents the amount of time that should be between
85  * two successive points on the trajectory.
86  *
87  * If discretize_by_time is false, then sim_granularity is the maximum amount of distance between
88  * two successive points on the trajectory, and angular_sim_granularity is the maximum amount of
89  * angular distance between two successive points.
90  */
91  nh->get_parameter(plugin_name + ".sim_time", sim_time_);
92  nh->get_parameter(plugin_name + ".discretize_by_time", discretize_by_time_);
93  nh->get_parameter(plugin_name + ".time_granularity", time_granularity_);
94  nh->get_parameter(plugin_name + ".linear_granularity", linear_granularity_);
95  nh->get_parameter(plugin_name + ".angular_granularity", angular_granularity_);
96  nh->get_parameter(plugin_name + ".include_last_point", include_last_point_);
97  nh->get_parameter(plugin_name + ".limit_vel_cmd_in_traj", limit_vel_cmd_in_traj_);
98 }
99 
101  const nav2::LifecycleNode::SharedPtr & nh)
102 {
103  velocity_iterator_ = std::make_shared<XYThetaIterator>();
104  velocity_iterator_->initialize(nh, kinematics_handler_, plugin_name_);
105 }
106 
108  const nav_2d_msgs::msg::Twist2D & current_velocity)
109 {
110  velocity_iterator_->startNewIteration(current_velocity, sim_time_);
111 }
112 
114 {
115  return velocity_iterator_->hasMoreTwists();
116 }
117 
118 nav_2d_msgs::msg::Twist2D StandardTrajectoryGenerator::nextTwist()
119 {
120  return velocity_iterator_->nextTwist();
121 }
122 
124  const nav_2d_msgs::msg::Twist2D & cmd_vel)
125 {
126  std::vector<double> steps;
127  if (discretize_by_time_) {
128  steps.resize(ceil(sim_time_ / time_granularity_));
129  } else { // discretize by distance
130  double vmag = hypot(cmd_vel.x, cmd_vel.y);
131 
132  // the distance the robot would travel in sim_time if it did not change velocity
133  double projected_linear_distance = vmag * sim_time_;
134 
135  // the angle the robot would rotate in sim_time
136  double projected_angular_distance = fabs(cmd_vel.theta) * sim_time_;
137 
138  // Pick the maximum of the two
139  int num_steps = ceil(
140  std::max(
141  projected_linear_distance / linear_granularity_,
142  projected_angular_distance / angular_granularity_));
143  steps.resize(num_steps);
144  }
145  if (steps.size() == 0) {
146  steps.resize(1);
147  }
148  std::fill(steps.begin(), steps.end(), sim_time_ / steps.size());
149  return steps;
150 }
151 
153  const geometry_msgs::msg::Pose & start_pose,
154  const nav_2d_msgs::msg::Twist2D & start_vel,
155  const nav_2d_msgs::msg::Twist2D & cmd_vel)
156 {
157  dwb_msgs::msg::Trajectory2D traj;
158  traj.velocity = cmd_vel;
159  // simulate the trajectory
160  geometry_msgs::msg::Pose pose = start_pose;
161  nav_2d_msgs::msg::Twist2D vel = start_vel;
162  double running_time = 0.0;
163  std::vector<double> steps = getTimeSteps(cmd_vel);
164  traj.poses.push_back(start_pose);
165  bool first_vel = false;
166  for (double dt : steps) {
167  // calculate velocities
168  vel = computeNewVelocity(cmd_vel, vel, dt);
169  if (!first_vel && limit_vel_cmd_in_traj_) {
170  traj.velocity = vel;
171  first_vel = true;
172  }
173 
174  // update the position of the robot using the velocities passed in
175  pose = computeNewPosition(pose, vel, dt);
176 
177  traj.poses.push_back(pose);
178  traj.time_offsets.push_back(rclcpp::Duration::from_seconds(running_time));
179  running_time += dt;
180  } // end for simulation steps
181 
182  if (include_last_point_) {
183  traj.poses.push_back(pose);
184  traj.time_offsets.push_back(rclcpp::Duration::from_seconds(running_time));
185  }
186 
187  return traj;
188 }
189 
194  const nav_2d_msgs::msg::Twist2D & cmd_vel,
195  const nav_2d_msgs::msg::Twist2D & start_vel, const double dt)
196 {
197  KinematicParameters kinematics = kinematics_handler_->getKinematics();
198  nav_2d_msgs::msg::Twist2D new_vel;
199  new_vel.x = projectVelocity(
200  start_vel.x, kinematics.getAccX(),
201  kinematics.getDecelX(), dt, cmd_vel.x);
202  new_vel.y = projectVelocity(
203  start_vel.y, kinematics.getAccY(),
204  kinematics.getDecelY(), dt, cmd_vel.y);
205  new_vel.theta = projectVelocity(
206  start_vel.theta,
207  kinematics.getAccTheta(), kinematics.getDecelTheta(),
208  dt, cmd_vel.theta);
209  return new_vel;
210 }
211 
213  const geometry_msgs::msg::Pose start_pose,
214  const nav_2d_msgs::msg::Twist2D & vel, const double dt)
215 {
216  geometry_msgs::msg::Pose new_pose;
217 
218  double theta = tf2::getYaw(start_pose.orientation);
219  new_pose.position.x = start_pose.position.x +
220  (vel.x * cos(theta) + vel.y * cos(M_PI_2 + theta)) * dt;
221  new_pose.position.y = start_pose.position.y +
222  (vel.x * sin(theta) + vel.y * sin(M_PI_2 + theta)) * dt;
223 
224  double new_theta = theta + vel.theta * dt;
225  tf2::Quaternion q;
226  q.setRPY(0.0, 0.0, new_theta);
227  new_pose.orientation = tf2::toMsg(q);
228 
229  return new_pose;
230 }
231 
232 } // namespace dwb_plugins
233 
234 PLUGINLIB_EXPORT_CLASS(
Interface for iterating through possible velocities and creating trajectories.
Standard DWA-like trajectory generator.
void startNewIteration(const nav_2d_msgs::msg::Twist2D &current_velocity) override
Start a new iteration based on the current velocity.
double angular_granularity_
If not discretizing by time, the amount of angular space between points.
virtual nav_2d_msgs::msg::Twist2D computeNewVelocity(const nav_2d_msgs::msg::Twist2D &cmd_vel, const nav_2d_msgs::msg::Twist2D &start_vel, const double dt)
Calculate the velocity after a set period of time, given the desired velocity and acceleration limits...
std::string plugin_name_
the name of the overlying plugin ID
bool hasMoreTwists() override
Test to see whether there are more twists to test.
virtual std::vector< double > getTimeSteps(const nav_2d_msgs::msg::Twist2D &cmd_vel)
Compute an array of time deltas between the points in the generated trajectory.
bool limit_vel_cmd_in_traj_
Option to limit velocity in the trajectory generator by using current velocity.
double linear_granularity_
If not discretizing by time, the amount of linear space between points.
virtual geometry_msgs::msg::Pose computeNewPosition(const geometry_msgs::msg::Pose start_pose, const nav_2d_msgs::msg::Twist2D &vel, const double dt)
Use the robot's kinematic model to predict new positions for the robot.
double time_granularity_
If discretizing by time, the amount of time between each point in the traj.
void initialize(const nav2::LifecycleNode::SharedPtr &nh, const std::string &plugin_name) override
Initialize parameters as needed.
virtual void initializeIterator(const nav2::LifecycleNode::SharedPtr &nh)
Initialize the VelocityIterator pointer. Put in its own function for easy overriding.
dwb_msgs::msg::Trajectory2D generateTrajectory(const geometry_msgs::msg::Pose &start_pose, const nav_2d_msgs::msg::Twist2D &start_vel, const nav_2d_msgs::msg::Twist2D &cmd_vel) override
Given a cmd_vel in the robot's frame and initial conditions, generate a Trajectory2D.
nav_2d_msgs::msg::Twist2D nextTwist() override
Return the next twist and advance the iteration.
A struct containing one representation of the robot's kinematics.