mpc_local_planner_ros.cpp
Go to the documentation of this file.
1 /*********************************************************************
2  *
3  * Software License Agreement
4  *
5  * Copyright (c) 2020, Christoph Rösmann, All rights reserved.
6  *
7  * This program is free software: you can redistribute it and/or modify
8  * it under the terms of the GNU General Public License as published by
9  * the Free Software Foundation, either version 3 of the License, or
10  * (at your option) any later version.
11  *
12  * This program is distributed in the hope that it will be useful,
13  * but WITHOUT ANY WARRANTY; without even the implied warranty of
14  * MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE. See the
15  * GNU General Public License for more details.
16  *
17  * You should have received a copy of the GNU General Public License
18  * along with this program. If not, see <https://www.gnu.org/licenses/>.
19  *
20  * Authors: Christoph Rösmann
21  *********************************************************************/
22 
24 
26 
27 #include <tf2_eigen/tf2_eigen.h>
29 
30 #include <boost/algorithm/string.hpp>
31 
32 // MBF return codes
33 #include <mbf_msgs/ExePathResult.h>
34 
35 // pluginlib macros
37 
38 // register this planner both as a BaseLocalPlanner and as a MBF's CostmapController plugin
41 
42 namespace mpc_local_planner {
43 
45  : _costmap_ros(nullptr),
46  _tf(nullptr),
47  _costmap_model(nullptr),
48  _costmap_converter_loader("costmap_converter", "costmap_converter::BaseCostmapToPolygons"),
49  /*dynamic_recfg_(NULL),*/
50  _goal_reached(false),
51  _no_infeasible_plans(0),
52  /*last_preferred_rotdir_(RotType::none),*/
53  _initialized(false)
54 {
55 }
56 
58 
59 /*
60 void MpcLocalPlannerROS::reconfigureCB(TebLocalPlannerReconfigureConfig& config, uint32_t level)
61 {
62  cfg_.reconfigure(config);
63 }
64 */
65 
67 {
68  // check if the plugin is already initialized
69  if (!_initialized)
70  {
71  // create Node Handle with name of plugin (as used in move_base for loading)
72  ros::NodeHandle nh("~/" + name);
73 
74  // load plugin related main parameters
75  nh.param("controller/xy_goal_tolerance", _params.xy_goal_tolerance, _params.xy_goal_tolerance);
76  nh.param("controller/yaw_goal_tolerance", _params.yaw_goal_tolerance, _params.yaw_goal_tolerance);
77  nh.param("controller/global_plan_overwrite_orientation", _params.global_plan_overwrite_orientation,
79  nh.param("controller/global_plan_prune_distance", _params.global_plan_prune_distance, _params.global_plan_prune_distance);
80  nh.param("controller/max_global_plan_lookahead_dist", _params.max_global_plan_lookahead_dist, _params.max_global_plan_lookahead_dist);
81  nh.param("controller/global_plan_viapoint_sep", _params.global_plan_viapoint_sep, _params.global_plan_viapoint_sep);
83 
84  // special parameters
85  nh.param("odom_topic", _params.odom_topic, _params.odom_topic);
86  nh.param("footprint_model/is_footprint_dynamic", _params.is_footprint_dynamic, _params.is_footprint_dynamic);
87  nh.param("collision_avoidance/include_costmap_obstacles", _params.include_costmap_obstacles, _params.include_costmap_obstacles);
88  nh.param("collision_avoidance/costmap_obstacles_behind_robot_dist", _params.costmap_obstacles_behind_robot_dist,
90 
91  nh.param("collision_avoidance/collision_check_no_poses", _params.collision_check_no_poses, _params.collision_check_no_poses);
92  nh.param("collision_avoidance/collision_check_min_resolution_angular", _params.collision_check_min_resolution_angular,
94 
95  // costmap converter plugin related parameters
98  nh.param("costmap_converter_spin_thread", _costmap_conv_params.costmap_converter_spin_thread,
100 
101  // reserve some memory for obstacles
102  _obstacles.reserve(700);
103 
104  // init other variables
105  _tf = tf;
106  _costmap_ros = costmap_ros;
107  _costmap = _costmap_ros->getCostmap(); // locking should be done in MoveBase.
108 
109  _costmap_model = std::make_shared<base_local_planner::CostmapModel>(*_costmap);
110 
113 
114  // create robot footprint/contour model for optimization
116 
117  // create the planner instance
119  {
120  ROS_ERROR("Controller configuration failed.");
121  return;
122  }
123 
124  // create visualization instance
126 
127  // Initialize a costmap to polygon converter
129  {
130  try
131  {
134  // replace '::' by '/' to convert the c++ namespace to a NodeHandle namespace
135  boost::replace_all(converter_name, "::", "/");
136  _costmap_converter->setOdomTopic(_params.odom_topic);
137  _costmap_converter->initialize(ros::NodeHandle(nh, "costmap_converter/" + converter_name));
138  _costmap_converter->setCostmap2D(_costmap);
139 
142  ROS_INFO_STREAM("Costmap conversion plugin " << _costmap_conv_params.costmap_converter_plugin << " loaded.");
143  }
145  {
146  ROS_WARN(
147  "The specified costmap converter plugin cannot be loaded. All occupied costmap cells are treaten as point obstacles. Error "
148  "message: %s",
149  ex.what());
150  _costmap_converter.reset();
151  }
152  }
153  else
154  ROS_INFO("No costmap conversion plugin specified. All occupied costmap cells are treaten as point obstacles.");
155 
156  // Get footprint of the robot and minimum and maximum distance from the center of the robot to its footprint vertices.
159 
160  // init the odom helper to receive the robot's velocity from odom messages
162 
163  // setup dynamic reconfigure
164  /*
165  dynamic_recfg_ = boost::make_shared<dynamic_reconfigure::Server<MpcLocalPlannerReconfigureConfig>>(nh);
166  dynamic_reconfigure::Server<MpcLocalPlannerReconfigureConfig>::CallbackType cb =
167  boost::bind(&MpcLocalPlanner::reconfigureCB, this, _1, _2);
168  dynamic_recfg_->setCallback(cb);
169  */
170 
171  // validate optimization footprint and costmap footprint
172  validateFootprints(_robot_model->getInscribedRadius(), _robot_inscribed_radius, _controller.getInequalityConstraint()->getMinimumDistance());
173 
174  // setup callback for custom obstacles
176 
177  // setup callback for custom via-points
179 
180  // additional move base params
181  ros::NodeHandle nh_move_base("~");
182  nh_move_base.param("controller_frequency", _params.controller_frequency, _params.controller_frequency);
183 
184  // set initialized flag
185  _initialized = true;
186 
187  ROS_DEBUG("mpc_local_planner plugin initialized.");
188  }
189  else
190  {
191  ROS_WARN("mpc_local_planner has already been initialized, doing nothing.");
192  }
193 }
194 
195 bool MpcLocalPlannerROS::setPlan(const std::vector<geometry_msgs::PoseStamped>& orig_global_plan)
196 {
197  // check if plugin is initialized
198  if (!_initialized)
199  {
200  ROS_ERROR("mpc_local_planner has not been initialized, please call initialize() before using this planner");
201  return false;
202  }
203 
204  // store the global plan
205  _global_plan.clear();
206  _global_plan = orig_global_plan;
207 
208  // we do not clear the local planner here, since setPlan is called frequently whenever the global planner updates the plan.
209  // the local planner checks whether it is required to reinitialize the trajectory or not within each velocity computation step.
210 
211  // reset goal_reached_ flag
212  _goal_reached = false;
213 
214  return true;
215 }
216 
217 bool MpcLocalPlannerROS::computeVelocityCommands(geometry_msgs::Twist& cmd_vel)
218 {
219  std::string dummy_message;
220  geometry_msgs::PoseStamped dummy_pose;
221  geometry_msgs::TwistStamped dummy_velocity, cmd_vel_stamped;
222  uint32_t outcome = computeVelocityCommands(dummy_pose, dummy_velocity, cmd_vel_stamped, dummy_message);
223  cmd_vel = cmd_vel_stamped.twist;
224  return outcome == mbf_msgs::ExePathResult::SUCCESS;
225 }
226 
227 uint32_t MpcLocalPlannerROS::computeVelocityCommands(const geometry_msgs::PoseStamped& pose, const geometry_msgs::TwistStamped& velocity,
228  geometry_msgs::TwistStamped& cmd_vel, std::string& message)
229 {
230  // check if plugin initialized
231  if (!_initialized)
232  {
233  ROS_ERROR("mpc_local_planner has not been initialized, please call initialize() before using this planner");
234  message = "mpc_local_planner has not been initialized";
235  return mbf_msgs::ExePathResult::NOT_INITIALIZED;
236  }
237 
238  static uint32_t seq = 0;
239  cmd_vel.header.seq = seq++;
240  cmd_vel.header.stamp = ros::Time::now();
241  cmd_vel.header.frame_id = _robot_base_frame;
242  cmd_vel.twist.linear.x = cmd_vel.twist.linear.y = cmd_vel.twist.angular.z = 0;
243  _goal_reached = false;
244 
245  // Get robot pose
246  geometry_msgs::PoseStamped robot_pose;
247  _costmap_ros->getRobotPose(robot_pose);
248  _robot_pose = PoseSE2(robot_pose.pose);
249 
250  // Get robot velocity
251  geometry_msgs::PoseStamped robot_vel_tf;
252  _odom_helper.getRobotVel(robot_vel_tf);
253  _robot_vel.linear.x = robot_vel_tf.pose.position.x;
254  _robot_vel.linear.y = robot_vel_tf.pose.position.y;
255  _robot_vel.angular.z = tf2::getYaw(robot_vel_tf.pose.orientation);
256 
257  // prune global plan to cut off parts of the past (spatially before the robot)
259 
260  // Transform global plan to the frame of interest (w.r.t. the local costmap)
261  std::vector<geometry_msgs::PoseStamped> transformed_plan;
262  int goal_idx;
263  geometry_msgs::TransformStamped tf_plan_to_global;
265  &goal_idx, &tf_plan_to_global))
266  {
267  ROS_WARN("Could not transform the global plan to the frame of the controller");
268  message = "Could not transform the global plan to the frame of the controller";
269  return mbf_msgs::ExePathResult::INTERNAL_ERROR;
270  }
271 
272  // update via-points container
274 
275  // check if global goal is reached
276  geometry_msgs::PoseStamped global_goal;
277  tf2::doTransform(_global_plan.back(), global_goal, tf_plan_to_global);
278  double dx = global_goal.pose.position.x - _robot_pose.x();
279  double dy = global_goal.pose.position.y - _robot_pose.y();
280  double delta_orient = g2o::normalize_theta(tf2::getYaw(global_goal.pose.orientation) - _robot_pose.theta());
281  if (std::abs(std::sqrt(dx * dx + dy * dy)) < _params.xy_goal_tolerance && std::abs(delta_orient) < _params.yaw_goal_tolerance)
282  {
283  _goal_reached = true;
284  return mbf_msgs::ExePathResult::SUCCESS;
285  }
286 
287  // Return false if the transformed global plan is empty
288  if (transformed_plan.empty())
289  {
290  ROS_WARN("Transformed plan is empty. Cannot determine a local plan.");
291  message = "Transformed plan is empty";
292  return mbf_msgs::ExePathResult::INVALID_PATH;
293  }
294 
295  // Get current goal point (last point of the transformed plan)
296  _robot_goal.x() = transformed_plan.back().pose.position.x;
297  _robot_goal.y() = transformed_plan.back().pose.position.y;
298  // Overwrite goal orientation if needed
300  {
301  _robot_goal.theta() = estimateLocalGoalOrientation(_global_plan, transformed_plan.back(), goal_idx, tf_plan_to_global);
302  // overwrite/update goal orientation of the transformed plan with the actual goal (enable using the plan as initialization)
304  q.setRPY(0, 0, _robot_goal.theta());
305  tf2::convert(q, transformed_plan.back().pose.orientation);
306  }
307  else
308  {
309  _robot_goal.theta() = tf2::getYaw(transformed_plan.back().pose.orientation);
310  }
311 
312  // overwrite/update start of the transformed plan with the actual robot position (allows using the plan as initial trajectory)
313  if (transformed_plan.size() == 1) // plan only contains the goal
314  {
315  transformed_plan.insert(transformed_plan.begin(), geometry_msgs::PoseStamped()); // insert start (not yet initialized)
316  }
317  transformed_plan.front() = robot_pose; // update start
318 
319  // clear currently existing obstacles
320  _obstacles.clear();
321 
322  // Update obstacle container with costmap information or polygons provided by a costmap_converter plugin
323  if (_costmap_converter)
325  else
327 
328  // also consider custom obstacles (must be called after other updates, since the container is not cleared)
330 
331  // estimate current state vector and previous control
332  // updateControlFromTwist()
333 
334  // Do not allow config changes during the following optimization step
335  // TODO(roesmann): we need something similar in case we allow dynamic reconfiguration:
336  // boost::mutex::scoped_lock cfg_lock(cfg_.configMutex());
337 
338  // Now perform the actual planning
339  // bool success = planner_->plan(transformed_plan, &robot_vel_, cfg_.goal_tolerance.free_goal_vel);
341  // controller_frequency might not be established in case planning takes longer:
342  // value dt affects e.g. control deviation bounds (acceleration limits) and we want a goot start value
343  // let's test how it works with the expected frequency instead of using the actual one
344  double dt = 1.0 / _params.controller_frequency;
345  // double dt = time_last_cmd_.isZero() ? 0.0 : (t - time_last_cmd_).toSec();
346 
347  // set previous control value for control deviation bounds
348  if (_u_seq && !_u_seq->isEmpty()) _controller.getOptimalControlProblem()->setPreviousControlInput(_u_seq->getValuesMap(0), dt);
349 
350  bool success = false;
351 
352  {
353  std::lock_guard<std::mutex> vp_lock(_via_point_mutex);
354  std::lock_guard<std::mutex> obst_lock(_custom_obst_mutex);
355  success = _controller.step(transformed_plan, _robot_vel, dt, t, _u_seq, _x_seq);
356  }
357 
358  if (!success)
359  {
360  _controller.reset(); // force reinitialization for next time
361  ROS_WARN("mpc_local_planner was not able to obtain a local plan for the current setting.");
362 
363  ++_no_infeasible_plans; // increase number of infeasible solutions in a row
365  _last_cmd = cmd_vel.twist;
366  message = "mpc_local_planner was not able to obtain a local plan";
367  return mbf_msgs::ExePathResult::NO_VALID_CMD;
368  }
369 
370  // Check feasibility (but within the first few states only)
372  {
373  // Update footprint of the robot and minimum and maximum distance from the center of the robot to its footprint vertices.
376  }
377 
380  if (!feasible)
381  {
382  cmd_vel.twist.linear.x = cmd_vel.twist.linear.y = cmd_vel.twist.angular.z = 0;
383 
384  // now we reset everything to start again with the initialization of new trajectories.
385  _controller.reset(); // force reinitialization for next time
386  ROS_WARN("MpcLocalPlannerROS: trajectory is not feasible. Resetting planner...");
387  ++_no_infeasible_plans; // increase number of infeasible solutions in a row
389  _last_cmd = cmd_vel.twist;
390  message = "mpc_local_planner trajectory is not feasible";
391  return mbf_msgs::ExePathResult::NO_VALID_CMD;
392  }
393 
394  // Get the velocity command for this sampling interval
395  // TODO(roesmann): we might also command more than just the imminent action, e.g. in a separate thread, until a new command is available
396  if (!_u_seq || !_controller.getRobotDynamics()->getTwistFromControl(_u_seq->getValuesMap(0), cmd_vel.twist))
397  {
398  _controller.reset();
399  ROS_WARN("MpcLocalPlannerROS: velocity command invalid. Resetting controller...");
400  ++_no_infeasible_plans; // increase number of infeasible solutions in a row
402  _last_cmd = cmd_vel.twist;
403  message = "mpc_local_planner velocity command invalid";
404  return mbf_msgs::ExePathResult::NO_VALID_CMD;
405  }
406 
407  // Saturate velocity, if the optimization results violates the constraints (could be possible due to early termination or soft cosntraints).
408  // saturateVelocity(cmd_vel.twist.linear.x, cmd_vel.twist.linear.y, cmd_vel.twist.angular.z, cfg_.robot.max_vel_x, cfg_.robot.max_vel_y,
409  // cfg_.robot.max_vel_theta, cfg_.robot.max_vel_x_backwards);
410 
411  // a feasible solution should be found, reset counter
413 
414  // store last command (for recovery analysis etc.)
415  _last_cmd = cmd_vel.twist;
417 
418  // Now visualize everything
424  return mbf_msgs::ExePathResult::SUCCESS;
425 }
426 
428 {
429  if (_goal_reached)
430  {
431  ROS_INFO("GOAL Reached!");
432  // planner_->clearPlanner();
433  return true;
434  }
435  return false;
436 }
437 
439 {
440  // Add costmap obstacles if desired
442  {
443  Eigen::Vector2d robot_orient = _robot_pose.orientationUnitVec();
444 
445  for (unsigned int i = 0; i < _costmap->getSizeInCellsX() - 1; ++i)
446  {
447  for (unsigned int j = 0; j < _costmap->getSizeInCellsY() - 1; ++j)
448  {
450  {
451  Eigen::Vector2d obs;
452  _costmap->mapToWorld(i, j, obs.coeffRef(0), obs.coeffRef(1));
453 
454  // check if obstacle is interesting (e.g. not far behind the robot)
455  Eigen::Vector2d obs_dir = obs - _robot_pose.position();
456  if (obs_dir.dot(robot_orient) < 0 && obs_dir.norm() > _params.costmap_obstacles_behind_robot_dist) continue;
457 
458  _obstacles.push_back(ObstaclePtr(new PointObstacle(obs)));
459  }
460  }
461  }
462  }
463 }
464 
466 {
467  if (!_costmap_converter) return;
468 
469  // Get obstacles from costmap converter
471  if (!obstacles) return;
472 
473  for (std::size_t i = 0; i < obstacles->obstacles.size(); ++i)
474  {
475  const costmap_converter::ObstacleMsg* obstacle = &obstacles->obstacles.at(i);
476  const geometry_msgs::Polygon* polygon = &obstacle->polygon;
477 
478  if (polygon->points.size() == 1 && obstacle->radius > 0) // Circle
479  {
480  _obstacles.push_back(ObstaclePtr(new CircularObstacle(polygon->points[0].x, polygon->points[0].y, obstacle->radius)));
481  }
482  else if (polygon->points.size() == 1) // Point
483  {
484  _obstacles.push_back(ObstaclePtr(new PointObstacle(polygon->points[0].x, polygon->points[0].y)));
485  }
486  else if (polygon->points.size() == 2) // Line
487  {
488  _obstacles.push_back(
489  ObstaclePtr(new LineObstacle(polygon->points[0].x, polygon->points[0].y, polygon->points[1].x, polygon->points[1].y)));
490  }
491  else if (polygon->points.size() > 2) // Real polygon
492  {
493  PolygonObstacle* polyobst = new PolygonObstacle;
494  for (std::size_t j = 0; j < polygon->points.size(); ++j)
495  {
496  polyobst->pushBackVertex(polygon->points[j].x, polygon->points[j].y);
497  }
498  polyobst->finalizePolygon();
499  _obstacles.push_back(ObstaclePtr(polyobst));
500  }
501 
502  // Set velocity, if obstacle is moving
503  if (!_obstacles.empty()) _obstacles.back()->setCentroidVelocity(obstacles->obstacles[i].velocities, obstacles->obstacles[i].orientation);
504  }
505 }
506 
508 {
509  // Add custom obstacles obtained via message
510  std::lock_guard<std::mutex> l(_custom_obst_mutex);
511 
512  if (!_custom_obstacle_msg.obstacles.empty())
513  {
514  // We only use the global header to specify the obstacle coordinate system instead of individual ones
515  Eigen::Affine3d obstacle_to_map_eig;
516  try
517  {
518  geometry_msgs::TransformStamped obstacle_to_map =
520  _custom_obstacle_msg.header.frame_id, ros::Duration(0.5));
521  obstacle_to_map_eig = tf2::transformToEigen(obstacle_to_map);
522  }
523  catch (tf::TransformException ex)
524  {
525  ROS_ERROR("%s", ex.what());
526  obstacle_to_map_eig.setIdentity();
527  }
528 
529  for (size_t i = 0; i < _custom_obstacle_msg.obstacles.size(); ++i)
530  {
531  if (_custom_obstacle_msg.obstacles.at(i).polygon.points.size() == 1 && _custom_obstacle_msg.obstacles.at(i).radius > 0) // circle
532  {
533  Eigen::Vector3d pos(_custom_obstacle_msg.obstacles.at(i).polygon.points.front().x,
534  _custom_obstacle_msg.obstacles.at(i).polygon.points.front().y,
535  _custom_obstacle_msg.obstacles.at(i).polygon.points.front().z);
536  _obstacles.push_back(
537  ObstaclePtr(new CircularObstacle((obstacle_to_map_eig * pos).head(2), _custom_obstacle_msg.obstacles.at(i).radius)));
538  }
539  else if (_custom_obstacle_msg.obstacles.at(i).polygon.points.size() == 1) // point
540  {
541  Eigen::Vector3d pos(_custom_obstacle_msg.obstacles.at(i).polygon.points.front().x,
542  _custom_obstacle_msg.obstacles.at(i).polygon.points.front().y,
543  _custom_obstacle_msg.obstacles.at(i).polygon.points.front().z);
544  _obstacles.push_back(ObstaclePtr(new PointObstacle((obstacle_to_map_eig * pos).head(2))));
545  }
546  else if (_custom_obstacle_msg.obstacles.at(i).polygon.points.size() == 2) // line
547  {
548  Eigen::Vector3d line_start(_custom_obstacle_msg.obstacles.at(i).polygon.points.front().x,
549  _custom_obstacle_msg.obstacles.at(i).polygon.points.front().y,
550  _custom_obstacle_msg.obstacles.at(i).polygon.points.front().z);
551  Eigen::Vector3d line_end(_custom_obstacle_msg.obstacles.at(i).polygon.points.back().x,
552  _custom_obstacle_msg.obstacles.at(i).polygon.points.back().y,
553  _custom_obstacle_msg.obstacles.at(i).polygon.points.back().z);
554  _obstacles.push_back(
555  ObstaclePtr(new LineObstacle((obstacle_to_map_eig * line_start).head(2), (obstacle_to_map_eig * line_end).head(2))));
556  }
557  else if (_custom_obstacle_msg.obstacles.at(i).polygon.points.empty())
558  {
559  ROS_WARN("Invalid custom obstacle received. List of polygon vertices is empty. Skipping...");
560  continue;
561  }
562  else // polygon
563  {
564  PolygonObstacle* polyobst = new PolygonObstacle;
565  for (size_t j = 0; j < _custom_obstacle_msg.obstacles.at(i).polygon.points.size(); ++j)
566  {
567  Eigen::Vector3d pos(_custom_obstacle_msg.obstacles.at(i).polygon.points[j].x,
568  _custom_obstacle_msg.obstacles.at(i).polygon.points[j].y,
569  _custom_obstacle_msg.obstacles.at(i).polygon.points[j].z);
570  polyobst->pushBackVertex((obstacle_to_map_eig * pos).head(2));
571  }
572  polyobst->finalizePolygon();
573  _obstacles.push_back(ObstaclePtr(polyobst));
574  }
575 
576  // Set velocity, if obstacle is moving
577  if (!_obstacles.empty())
578  _obstacles.back()->setCentroidVelocity(_custom_obstacle_msg.obstacles[i].velocities, _custom_obstacle_msg.obstacles[i].orientation);
579  }
580  }
581 }
582 
583 void MpcLocalPlannerROS::updateViaPointsContainer(const std::vector<geometry_msgs::PoseStamped>& transformed_plan, double min_separation)
584 {
585  _via_points.clear();
586 
587  if (min_separation <= 0) return;
588 
589  std::size_t prev_idx = 0;
590  for (std::size_t i = 1; i < transformed_plan.size(); ++i) // skip first one, since we do not need any point before the first min_separation [m]
591  {
592  // check separation to the previous via-point inserted
593  if (distance_points2d(transformed_plan[prev_idx].pose.position, transformed_plan[i].pose.position) < min_separation) continue;
594 
595  // add via-point
596  _via_points.emplace_back(transformed_plan[i].pose);
597  prev_idx = i;
598  }
599 }
600 
602 {
603  Eigen::Vector2d vel;
604  vel.coeffRef(0) = std::sqrt(tf_vel.getOrigin().getX() * tf_vel.getOrigin().getX() + tf_vel.getOrigin().getY() * tf_vel.getOrigin().getY());
605  vel.coeffRef(1) = tf::getYaw(tf_vel.getRotation());
606  return vel;
607 }
608 
609 bool MpcLocalPlannerROS::pruneGlobalPlan(const tf2_ros::Buffer& tf, const geometry_msgs::PoseStamped& global_pose,
610  std::vector<geometry_msgs::PoseStamped>& global_plan, double dist_behind_robot)
611 {
612  if (global_plan.empty()) return true;
613 
614  try
615  {
616  // transform robot pose into the plan frame (we do not wait here, since pruning not crucial, if missed a few times)
617  geometry_msgs::TransformStamped global_to_plan_transform =
618  tf.lookupTransform(global_plan.front().header.frame_id, global_pose.header.frame_id, ros::Time(0));
619  geometry_msgs::PoseStamped robot;
620  tf2::doTransform(global_pose, robot, global_to_plan_transform);
621 
622  double dist_thresh_sq = dist_behind_robot * dist_behind_robot;
623 
624  // iterate plan until a pose close the robot is found
625  std::vector<geometry_msgs::PoseStamped>::iterator it = global_plan.begin();
626  std::vector<geometry_msgs::PoseStamped>::iterator erase_end = it;
627  while (it != global_plan.end())
628  {
629  double dx = robot.pose.position.x - it->pose.position.x;
630  double dy = robot.pose.position.y - it->pose.position.y;
631  double dist_sq = dx * dx + dy * dy;
632  if (dist_sq < dist_thresh_sq)
633  {
634  erase_end = it;
635  break;
636  }
637  ++it;
638  }
639  if (erase_end == global_plan.end()) return false;
640 
641  if (erase_end != global_plan.begin()) global_plan.erase(global_plan.begin(), erase_end);
642  }
643  catch (const tf::TransformException& ex)
644  {
645  ROS_DEBUG("Cannot prune path since no transform is available: %s\n", ex.what());
646  return false;
647  }
648  return true;
649 }
650 
651 bool MpcLocalPlannerROS::transformGlobalPlan(const tf2_ros::Buffer& tf, const std::vector<geometry_msgs::PoseStamped>& global_plan,
652  const geometry_msgs::PoseStamped& global_pose, const costmap_2d::Costmap2D& costmap,
653  const std::string& global_frame, double max_plan_length,
654  std::vector<geometry_msgs::PoseStamped>& transformed_plan, int* current_goal_idx,
655  geometry_msgs::TransformStamped* tf_plan_to_global) const
656 {
657  // this method is a slightly modified version of base_local_planner/goal_functions.h
658 
659  const geometry_msgs::PoseStamped& plan_pose = global_plan[0];
660 
661  transformed_plan.clear();
662 
663  try
664  {
665  if (global_plan.empty())
666  {
667  ROS_ERROR("Received plan with zero length");
668  *current_goal_idx = 0;
669  return false;
670  }
671 
672  // get plan_to_global_transform from plan frame to global_frame
673  geometry_msgs::TransformStamped plan_to_global_transform = tf.lookupTransform(
674  global_frame, ros::Time(), plan_pose.header.frame_id, plan_pose.header.stamp, plan_pose.header.frame_id, ros::Duration(0.5));
675 
676  // let's get the pose of the robot in the frame of the plan
677  geometry_msgs::PoseStamped robot_pose;
678  tf.transform(global_pose, robot_pose, plan_pose.header.frame_id);
679 
680  // we'll discard points on the plan that are outside the local costmap
681  double dist_threshold =
682  std::max(costmap.getSizeInCellsX() * costmap.getResolution() / 2.0, costmap.getSizeInCellsY() * costmap.getResolution() / 2.0);
683  dist_threshold *= 0.85; // just consider 85% of the costmap size to better incorporate point obstacle that are
684  // located on the border of the local costmap
685 
686  int i = 0;
687  double sq_dist_threshold = dist_threshold * dist_threshold;
688  double sq_dist = 1e10;
689 
690  // we need to loop to a point on the plan that is within a certain distance of the robot
691  for (int j = 0; j < (int)global_plan.size(); ++j)
692  {
693  double x_diff = robot_pose.pose.position.x - global_plan[j].pose.position.x;
694  double y_diff = robot_pose.pose.position.y - global_plan[j].pose.position.y;
695  double new_sq_dist = x_diff * x_diff + y_diff * y_diff;
696  if (new_sq_dist > sq_dist_threshold) break; // force stop if we have reached the costmap border
697 
698  if (new_sq_dist < sq_dist) // find closest distance
699  {
700  sq_dist = new_sq_dist;
701  i = j;
702  }
703  }
704 
705  geometry_msgs::PoseStamped newer_pose;
706 
707  double plan_length = 0; // check cumulative Euclidean distance along the plan
708 
709  // now we'll transform until points are outside of our distance threshold
710  while (i < (int)global_plan.size() && sq_dist <= sq_dist_threshold && (max_plan_length <= 0 || plan_length <= max_plan_length))
711  {
712  const geometry_msgs::PoseStamped& pose = global_plan[i];
713  tf2::doTransform(pose, newer_pose, plan_to_global_transform);
714 
715  transformed_plan.push_back(newer_pose);
716 
717  double x_diff = robot_pose.pose.position.x - global_plan[i].pose.position.x;
718  double y_diff = robot_pose.pose.position.y - global_plan[i].pose.position.y;
719  sq_dist = x_diff * x_diff + y_diff * y_diff;
720 
721  // caclulate distance to previous pose
722  if (i > 0 && max_plan_length > 0)
723  plan_length += teb_local_planner::distance_points2d(global_plan[i - 1].pose.position, global_plan[i].pose.position);
724 
725  ++i;
726  }
727 
728  // if we are really close to the goal (<sq_dist_threshold) and the goal is not yet reached (e.g. orientation error >>0)
729  // the resulting transformed plan can be empty. In that case we explicitly inject the global goal.
730  if (transformed_plan.empty())
731  {
732  tf2::doTransform(global_plan.back(), newer_pose, plan_to_global_transform);
733 
734  transformed_plan.push_back(newer_pose);
735 
736  // Return the index of the current goal point (inside the distance threshold)
737  if (current_goal_idx) *current_goal_idx = int(global_plan.size()) - 1;
738  }
739  else
740  {
741  // Return the index of the current goal point (inside the distance threshold)
742  if (current_goal_idx) *current_goal_idx = i - 1; // subtract 1, since i was increased once before leaving the loop
743  }
744 
745  // Return the transformation from the global plan to the global planning frame if desired
746  if (tf_plan_to_global) *tf_plan_to_global = plan_to_global_transform;
747  }
748  catch (tf::LookupException& ex)
749  {
750  ROS_ERROR("No Transform available Error: %s\n", ex.what());
751  return false;
752  }
753  catch (tf::ConnectivityException& ex)
754  {
755  ROS_ERROR("Connectivity Error: %s\n", ex.what());
756  return false;
757  }
758  catch (tf::ExtrapolationException& ex)
759  {
760  ROS_ERROR("Extrapolation Error: %s\n", ex.what());
761  if (global_plan.size() > 0)
762  ROS_ERROR("Global Frame: %s Plan Frame size %d: %s\n", global_frame.c_str(), (unsigned int)global_plan.size(),
763  global_plan[0].header.frame_id.c_str());
764 
765  return false;
766  }
767 
768  return true;
769 }
770 
771 double MpcLocalPlannerROS::estimateLocalGoalOrientation(const std::vector<geometry_msgs::PoseStamped>& global_plan,
772  const geometry_msgs::PoseStamped& local_goal, int current_goal_idx,
773  const geometry_msgs::TransformStamped& tf_plan_to_global, int moving_average_length) const
774 {
775  int n = (int)global_plan.size();
776 
777  // check if we are near the global goal already
778  if (current_goal_idx > n - moving_average_length - 2)
779  {
780  if (current_goal_idx >= n - 1) // we've exactly reached the goal
781  {
782  return tf2::getYaw(local_goal.pose.orientation);
783  }
784  else
785  {
786  tf2::Quaternion global_orientation;
787  tf2::convert(global_plan.back().pose.orientation, global_orientation);
788  tf2::Quaternion rotation;
789  tf2::convert(tf_plan_to_global.transform.rotation, rotation);
790  // TODO(roesmann): avoid conversion to tf2::Quaternion
791  return tf2::getYaw(rotation * global_orientation);
792  }
793  }
794 
795  // reduce number of poses taken into account if the desired number of poses is not available
796  moving_average_length =
797  std::min(moving_average_length, n - current_goal_idx - 1); // maybe redundant, since we have checked the vicinity of the goal before
798 
799  std::vector<double> candidates;
800  geometry_msgs::PoseStamped tf_pose_k = local_goal;
801  geometry_msgs::PoseStamped tf_pose_kp1;
802 
803  int range_end = current_goal_idx + moving_average_length;
804  for (int i = current_goal_idx; i < range_end; ++i)
805  {
806  // Transform pose of the global plan to the planning frame
807  tf2::doTransform(global_plan.at(i + 1), tf_pose_kp1, tf_plan_to_global);
808 
809  // calculate yaw angle
810  candidates.push_back(
811  std::atan2(tf_pose_kp1.pose.position.y - tf_pose_k.pose.position.y, tf_pose_kp1.pose.position.x - tf_pose_k.pose.position.x));
812 
813  if (i < range_end - 1) tf_pose_k = tf_pose_kp1;
814  }
815  return teb_local_planner::average_angles(candidates);
816 }
817 
818 void MpcLocalPlannerROS::validateFootprints(double opt_inscribed_radius, double costmap_inscribed_radius, double min_obst_dist)
819 {
820  ROS_WARN_COND(opt_inscribed_radius + min_obst_dist < costmap_inscribed_radius,
821  "The inscribed radius of the footprint specified for TEB optimization (%f) + min_obstacle_dist (%f) are smaller "
822  "than the inscribed radius of the robot's footprint in the costmap parameters (%f, including 'footprint_padding'). "
823  "Infeasible optimziation results might occur frequently!",
824  opt_inscribed_radius, min_obst_dist, costmap_inscribed_radius);
825 }
826 
827 void MpcLocalPlannerROS::customObstacleCB(const costmap_converter::ObstacleArrayMsg::ConstPtr& obst_msg)
828 {
829  std::lock_guard<std::mutex> l(_custom_obst_mutex);
830  _custom_obstacle_msg = *obst_msg;
831 }
832 
833 void MpcLocalPlannerROS::customViaPointsCB(const nav_msgs::Path::ConstPtr& via_points_msg)
834 {
835  ROS_INFO_ONCE("Via-points received. This message is printed once.");
837  {
838  ROS_WARN(
839  "Via-points are already obtained from the global plan (global_plan_viapoint_sep>0)."
840  "Ignoring custom via-points.");
842  return;
843  }
844 
845  std::lock_guard<std::mutex> lock(_via_point_mutex);
846  _via_points.clear();
847  for (const geometry_msgs::PoseStamped& pose : via_points_msg->poses)
848  {
849  _via_points.emplace_back(pose.pose);
850  }
852 }
853 
855  costmap_2d::Costmap2DROS* costmap_ros)
856 {
857  std::string model_name;
858  if (!nh.getParam("footprint_model/type", model_name))
859  {
860  ROS_INFO("No robot footprint model specified for trajectory optimization. Using point-shaped model.");
861  return boost::make_shared<teb_local_planner::PointRobotFootprint>();
862  }
863 
864  // from costmap_2d
865  if (model_name.compare("costmap_2d") == 0)
866  {
867  if (!costmap_ros)
868  {
869  ROS_WARN_STREAM("Costmap 2d pointer is null. Using point model instead.");
870  return boost::make_shared<teb_local_planner::PointRobotFootprint>();
871  }
872  ROS_INFO("Footprint model loaded from costmap_2d for trajectory optimization.");
873  return getRobotFootprintFromCostmap2d(*costmap_ros);
874  }
875 
876  // point
877  if (model_name.compare("point") == 0)
878  {
879  ROS_INFO("Footprint model 'point' loaded for trajectory optimization.");
880  return boost::make_shared<teb_local_planner::PointRobotFootprint>();
881  }
882 
883  // circular
884  if (model_name.compare("circular") == 0)
885  {
886  // get radius
887  double radius;
888  if (!nh.getParam("footprint_model/radius", radius))
889  {
890  ROS_ERROR_STREAM("Footprint model 'circular' cannot be loaded for trajectory optimization, since param '"
891  << nh.getNamespace() << "/footprint_model/radius' does not exist. Using point-model instead.");
892  return boost::make_shared<teb_local_planner::PointRobotFootprint>();
893  }
894  ROS_INFO_STREAM("Footprint model 'circular' (radius: " << radius << "m) loaded for trajectory optimization.");
895  return boost::make_shared<teb_local_planner::CircularRobotFootprint>(radius);
896  }
897 
898  // line
899  if (model_name.compare("line") == 0)
900  {
901  // check parameters
902  if (!nh.hasParam("footprint_model/line_start") || !nh.hasParam("footprint_model/line_end"))
903  {
904  ROS_ERROR_STREAM("Footprint model 'line' cannot be loaded for trajectory optimization, since param '"
905  << nh.getNamespace() << "/footprint_model/line_start' and/or '.../line_end' do not exist. Using point-model instead.");
906  return boost::make_shared<teb_local_planner::PointRobotFootprint>();
907  }
908  // get line coordinates
909  std::vector<double> line_start, line_end;
910  nh.getParam("footprint_model/line_start", line_start);
911  nh.getParam("footprint_model/line_end", line_end);
912  if (line_start.size() != 2 || line_end.size() != 2)
913  {
915  "Footprint model 'line' cannot be loaded for trajectory optimization, since param '"
916  << nh.getNamespace()
917  << "/footprint_model/line_start' and/or '.../line_end' do not contain x and y coordinates (2D). Using point-model instead.");
918  return boost::make_shared<teb_local_planner::PointRobotFootprint>();
919  }
920 
921  ROS_INFO_STREAM("Footprint model 'line' (line_start: [" << line_start[0] << "," << line_start[1] << "]m, line_end: [" << line_end[0] << ","
922  << line_end[1] << "]m) loaded for trajectory optimization.");
923  return boost::make_shared<teb_local_planner::LineRobotFootprint>(Eigen::Map<const Eigen::Vector2d>(line_start.data()),
924  Eigen::Map<const Eigen::Vector2d>(line_end.data()));
925  }
926 
927  // two circles
928  if (model_name.compare("two_circles") == 0)
929  {
930  // check parameters
931  if (!nh.hasParam("footprint_model/front_offset") || !nh.hasParam("footprint_model/front_radius") ||
932  !nh.hasParam("footprint_model/rear_offset") || !nh.hasParam("footprint_model/rear_radius"))
933  {
934  ROS_ERROR_STREAM("Footprint model 'two_circles' cannot be loaded for trajectory optimization, since params '"
935  << nh.getNamespace()
936  << "/footprint_model/front_offset', '.../front_radius', '.../rear_offset' and '.../rear_radius' do not exist. Using "
937  "point-model instead.");
938  return boost::make_shared<teb_local_planner::PointRobotFootprint>();
939  }
940  double front_offset, front_radius, rear_offset, rear_radius;
941  nh.getParam("footprint_model/front_offset", front_offset);
942  nh.getParam("footprint_model/front_radius", front_radius);
943  nh.getParam("footprint_model/rear_offset", rear_offset);
944  nh.getParam("footprint_model/rear_radius", rear_radius);
945  ROS_INFO_STREAM("Footprint model 'two_circles' (front_offset: " << front_offset << "m, front_radius: " << front_radius
946  << "m, rear_offset: " << rear_offset << "m, rear_radius: " << rear_radius
947  << "m) loaded for trajectory optimization.");
948  return boost::make_shared<teb_local_planner::TwoCirclesRobotFootprint>(front_offset, front_radius, rear_offset, rear_radius);
949  }
950 
951  // polygon
952  if (model_name.compare("polygon") == 0)
953  {
954 
955  // check parameters
956  XmlRpc::XmlRpcValue footprint_xmlrpc;
957  if (!nh.getParam("footprint_model/vertices", footprint_xmlrpc))
958  {
959  ROS_ERROR_STREAM("Footprint model 'polygon' cannot be loaded for trajectory optimization, since param '"
960  << nh.getNamespace() << "/footprint_model/vertices' does not exist. Using point-model instead.");
961  return boost::make_shared<teb_local_planner::PointRobotFootprint>();
962  }
963  // get vertices
964  if (footprint_xmlrpc.getType() == XmlRpc::XmlRpcValue::TypeArray)
965  {
966  try
967  {
968  Point2dContainer polygon = makeFootprintFromXMLRPC(footprint_xmlrpc, "/footprint_model/vertices");
969  ROS_INFO_STREAM("Footprint model 'polygon' loaded for trajectory optimization.");
970  return boost::make_shared<teb_local_planner::PolygonRobotFootprint>(polygon);
971  }
972  catch (const std::exception& ex)
973  {
974  ROS_ERROR_STREAM("Footprint model 'polygon' cannot be loaded for trajectory optimization: " << ex.what()
975  << ". Using point-model instead.");
976  return boost::make_shared<teb_local_planner::PointRobotFootprint>();
977  }
978  }
979  else
980  {
981  ROS_ERROR_STREAM("Footprint model 'polygon' cannot be loaded for trajectory optimization, since param '"
982  << nh.getNamespace()
983  << "/footprint_model/vertices' does not define an array of coordinates. Using point-model instead.");
984  return boost::make_shared<teb_local_planner::PointRobotFootprint>();
985  }
986  }
987 
988  // otherwise
989  ROS_WARN_STREAM("Unknown robot footprint model specified with parameter '" << nh.getNamespace()
990  << "/footprint_model/type'. Using point model instead.");
991  return boost::make_shared<teb_local_planner::PointRobotFootprint>();
992 }
993 
995 {
996  Point2dContainer footprint;
997  Eigen::Vector2d pt;
998  geometry_msgs::Polygon polygon = costmap_ros.getRobotFootprintPolygon();
999 
1000  for (int i = 0; i < polygon.points.size(); ++i)
1001  {
1002  pt.x() = polygon.points[i].x;
1003  pt.y() = polygon.points[i].y;
1004 
1005  footprint.push_back(pt);
1006  }
1007  return boost::make_shared<teb_local_planner::PolygonRobotFootprint>(footprint);
1008 }
1009 
1011  const std::string& full_param_name)
1012 {
1013  // Make sure we have an array of at least 3 elements.
1014  if (footprint_xmlrpc.getType() != XmlRpc::XmlRpcValue::TypeArray || footprint_xmlrpc.size() < 3)
1015  {
1016  ROS_FATAL("The footprint must be specified as list of lists on the parameter server, %s was specified as %s", full_param_name.c_str(),
1017  std::string(footprint_xmlrpc).c_str());
1018  throw std::runtime_error(
1019  "The footprint must be specified as list of lists on the parameter server with at least "
1020  "3 points eg: [[x1, y1], [x2, y2], ..., [xn, yn]]");
1021  }
1022 
1023  Point2dContainer footprint;
1024  Eigen::Vector2d pt;
1025 
1026  for (int i = 0; i < footprint_xmlrpc.size(); ++i)
1027  {
1028  // Make sure each element of the list is an array of size 2. (x and y coordinates)
1029  XmlRpc::XmlRpcValue point = footprint_xmlrpc[i];
1030  if (point.getType() != XmlRpc::XmlRpcValue::TypeArray || point.size() != 2)
1031  {
1032  ROS_FATAL(
1033  "The footprint (parameter %s) must be specified as list of lists on the parameter server eg: "
1034  "[[x1, y1], [x2, y2], ..., [xn, yn]], but this spec is not of that form.",
1035  full_param_name.c_str());
1036  throw std::runtime_error(
1037  "The footprint must be specified as list of lists on the parameter server eg: "
1038  "[[x1, y1], [x2, y2], ..., [xn, yn]], but this spec is not of that form");
1039  }
1040 
1041  pt.x() = getNumberFromXMLRPC(point[0], full_param_name);
1042  pt.y() = getNumberFromXMLRPC(point[1], full_param_name);
1043 
1044  footprint.push_back(pt);
1045  }
1046  return footprint;
1047 }
1048 
1049 double MpcLocalPlannerROS::getNumberFromXMLRPC(XmlRpc::XmlRpcValue& value, const std::string& full_param_name)
1050 {
1051  // Make sure that the value we're looking at is either a double or an int.
1053  {
1054  std::string& value_string = value;
1055  ROS_FATAL("Values in the footprint specification (param %s) must be numbers. Found value %s.", full_param_name.c_str(), value_string.c_str());
1056  throw std::runtime_error("Values in the footprint specification must be numbers");
1057  }
1058  return value.getType() == XmlRpc::XmlRpcValue::TypeInt ? (int)(value) : (double)(value);
1059 }
1060 
1061 } // end namespace mpc_local_planner
bool _initialized
Keeps track about the correct initialization of this class.
struct mpc_local_planner::MpcLocalPlannerROS::Parameters _params
std::string _global_frame
The frame in which the controller will run.
double estimateLocalGoalOrientation(const std::vector< geometry_msgs::PoseStamped > &global_plan, const geometry_msgs::PoseStamped &local_goal, int current_goal_idx, const geometry_msgs::TransformStamped &tf_plan_to_global, int moving_average_length=3) const
Estimate the orientation of a pose from the global_plan that is treated as a local goal for the local...
RobotDynamicsInterface::Ptr getRobotDynamics()
Definition: controller.h:75
unsigned int getSizeInCellsX() const
#define ROS_FATAL(...)
std::vector< geometry_msgs::Point > _footprint_spec
Store the footprint of the robot.
T & transform(const T &in, T &out, const std::string &target_frame, ros::Duration timeout=ros::Duration(0.0)) const
void publishObstacles(const teb_local_planner::ObstContainer &obstacles) const
Publish obstacle positions to the ros topic ../../mpc_markers.
Definition: publisher.cpp:107
list point
teb_local_planner::CircularObstacle CircularObstacle
void publishViaPoints(const std::vector< teb_local_planner::PoseSE2 > &via_points, const std::string &ns="ViaPoints") const
Publish via-points to the ros topic ../../teb_markers.
Definition: publisher.cpp:234
void publishLocalPlan(const std::vector< geometry_msgs::PoseStamped > &local_plan) const
Publish a given local plan to the ros topic ../../local_plan.
Definition: publisher.cpp:58
return int(ret)+1
MpcLocalPlannerROS()
Default constructor of the plugin.
Eigen::Vector2d orientationUnitVec() const
bool step(const PoseSE2 &start, const PoseSE2 &goal, const geometry_msgs::Twist &vel, double dt, ros::Time t, corbo::TimeSeries::Ptr u_seq, corbo::TimeSeries::Ptr x_seq)
Definition: controller.cpp:102
costmap_converter::ObstacleArrayMsg _custom_obstacle_msg
Copy of the most recent obstacle message.
Quaternion getRotation() const
void publishRobotFootprintModel(const teb_local_planner::PoseSE2 &current_pose, const teb_local_planner::BaseRobotFootprintModel &robot_model, const std::string &ns="RobotFootprintModel", const std_msgs::ColorRGBA &color=toColorMsg(0.5, 0.0, 0.8, 0.0))
Publish the visualization of the robot model.
Definition: publisher.cpp:84
unsigned int getSizeInCellsY() const
#define ROS_INFO_ONCE(...)
Eigen::Vector2d & position()
Subscriber subscribe(const std::string &topic, uint32_t queue_size, void(T::*fp)(M), T *obj, const TransportHints &transport_hints=TransportHints())
bool isGoalReached()
Check if the goal pose has been achieved.
bool transformGlobalPlan(const tf2_ros::Buffer &tf, const std::vector< geometry_msgs::PoseStamped > &global_plan, const geometry_msgs::PoseStamped &global_pose, const costmap_2d::Costmap2D &costmap, const std::string &global_frame, double max_plan_length, std::vector< geometry_msgs::PoseStamped > &transformed_plan, int *current_goal_idx=NULL, geometry_msgs::TransformStamped *tf_plan_to_global=NULL) const
Transforms the global plan of the robot from the planner frame to the local frame (modified)...
boost::shared_ptr< T > createInstance(const std::string &lookup_name)
static double getYaw(const Quaternion &bt_q)
costmap_2d::Costmap2D * _costmap
Pointer to the 2d costmap (obtained from the costmap ros wrapper)
void updateViaPointsContainer(const std::vector< geometry_msgs::PoseStamped > &transformed_plan, double min_separation)
Update internal via-point container based on the current reference plan.
void publishGlobalPlan(const std::vector< geometry_msgs::PoseStamped > &global_plan) const
Publish a given global plan to the ros topic ../../global_plan.
Definition: publisher.cpp:78
std::string getGlobalFrameID()
geometry_msgs::Twist _robot_vel
Store current robot translational and angular velocity (vx, vy, omega)
geometry_msgs::Twist _last_cmd
Store the last control command generated in computeVelocityCommands()
std::vector< geometry_msgs::PoseStamped > _global_plan
Store the current global plan.
static double getNumberFromXMLRPC(XmlRpc::XmlRpcValue &value, const std::string &full_param_name)
Get a number from the given XmlRpcValue.
static Eigen::Vector2d tfPoseToEigenVector2dTransRot(const tf::Pose &tf_vel)
Transform a tf::Pose type into a Eigen::Vector2d containing the translational and angular velocities...
void validateFootprints(double opt_inscribed_radius, double costmap_inscribed_radius, double min_obst_dist)
Validate current parameter values of the footprint for optimization, obstacle distance and the costma...
bool _goal_reached
store whether the goal is reached or not
pluginlib::ClassLoader< costmap_converter::BaseCostmapToPolygons > _costmap_converter_loader
Load costmap converter plugins at runtime.
std::vector< Eigen::Vector2d, Eigen::aligned_allocator< Eigen::Vector2d > > Point2dContainer
double _robot_circumscribed_radius
The radius of the circumscribed circle of the robot.
ObstContainer _obstacles
Obstacle vector that should be considered during local trajectory optimization.
void doTransform(const T &data_in, T &data_out, const geometry_msgs::TransformStamped &transform)
std::mutex _via_point_mutex
Mutex that locks the via_points container (multi-threaded)
double _robot_inscribed_radius
The radius of the inscribed circle of the robot (collision possible)
list line_start
void customViaPointsCB(const nav_msgs::Path::ConstPtr &via_points_msg)
Callback for custom via-points.
#define ROS_WARN(...)
costmap_2d::Costmap2DROS * _costmap_ros
Pointer to the costmap ros wrapper, received from the navigation stack.
geometry_msgs::TransformStamped t
bool pruneGlobalPlan(const tf2_ros::Buffer &tf, const geometry_msgs::PoseStamped &global_pose, std::vector< geometry_msgs::PoseStamped > &global_plan, double dist_behind_robot=1)
Prune global plan such that already passed poses are cut off.
teb_local_planner::ObstaclePtr ObstaclePtr
void initialize(ros::NodeHandle &nh, RobotDynamicsInterface::Ptr system, const std::string &map_frame)
Initializes the class and registers topics.
Definition: publisher.cpp:43
bool setPlan(const std::vector< geometry_msgs::PoseStamped > &orig_global_plan)
Set the plan that the teb local planner is following.
bool param(const std::string &param_name, T &param_val, const T &default_val) const
Type const & getType() const
virtual geometry_msgs::TransformStamped lookupTransform(const std::string &target_frame, const std::string &source_frame, const ros::Time &time, const ros::Duration timeout) const
ros::Subscriber _via_points_sub
Subscriber for custom via-points received via a Path msg.
static RobotFootprintModelPtr getRobotFootprintFromParamServer(const ros::NodeHandle &nh, costmap_2d::Costmap2DROS *costmap_ros=nullptr)
Get the current robot footprint/contour model.
int _no_infeasible_plans
Store how many times in a row the planner failed to find a feasible plan.
base_local_planner::OdometryHelperRos _odom_helper
Provides an interface to receive the current velocity from the robot.
PoseSE2 _robot_pose
Store current robot pose.
teb_local_planner::PointObstacle PointObstacle
#define ROS_INFO(...)
PoseSE2 _robot_goal
Store current robot goal.
bool getParam(const std::string &key, std::string &s) const
EIGEN_DEVICE_FUNC SegmentReturnType head(Index n) const
bool computeVelocityCommands(geometry_msgs::Twist &cmd_vel)
Given the current position, orientation, and velocity of the robot, compute velocity commands to send...
EIGEN_DEVICE_FUNC void setIdentity()
OptimalControlProblemInterface::Ptr getOptimalControlProblem()
std::string getBaseFrameID()
EIGEN_DEVICE_FUNC const Scalar & q
boost::shared_ptr< costmap_converter::BaseCostmapToPolygons > _costmap_converter
Store the current costmap_converter.
bool getRobotPose(geometry_msgs::PoseStamped &global_pose) const
ros::Subscriber _custom_obst_sub
Subscriber for custom obstacles received via a ObstacleMsg.
teb_local_planner::Point2dContainer Point2dContainer
void pushBackVertex(const Eigen::Ref< const Eigen::Vector2d > &vertex)
void updateObstacleContainerWithCostmapConverter()
Update internal obstacle vector based on polygons provided by a costmap_converter plugin...
#define ROS_WARN_STREAM(args)
virtual std::string getName(const std::string &lookup_name)
TFSIMD_FORCE_INLINE Vector3 & getOrigin()
bool hasParam(const std::string &key) const
double getYaw(const A &a)
double distance_points2d(const P1 &point1, const P2 &point2)
Calculate Euclidean distance between two 2D point datatypes.
Definition: math_utils.h:56
teb_local_planner::LineObstacle LineObstacle
std::mutex _custom_obst_mutex
Mutex that locks the obstacle array (multi-threaded)
static Point2dContainer makeFootprintFromXMLRPC(XmlRpc::XmlRpcValue &footprint_xmlrpc, const std::string &full_param_name)
Set the footprint from the given XmlRpcValue.
#define ROS_INFO_STREAM(args)
static const unsigned char LETHAL_OBSTACLE
const std::string & getNamespace() const
tf2_ros::Buffer * _tf
pointer to tf buffer
static RobotFootprintModelPtr getRobotFootprintFromCostmap2d(costmap_2d::Costmap2DROS &costmap_ros)
Get the current robot footprint/contour model.
double average_angles(const std::vector< double > &angles)
geometry_msgs::Polygon getRobotFootprintPolygon()
double normalize_theta(double theta)
normalize angle to interval [-pi, pi)
Definition: math_utils.h:81
void updateObstacleContainerWithCustomObstacles()
Update internal obstacle vector based on custom messages received via subscriber. ...
teb_local_planner::PolygonObstacle PolygonObstacle
#define ROS_WARN_COND(cond,...)
static Time now()
void convert(const A &a, B &b)
double getResolution() const
void setOdomTopic(std::string odom_topic)
bool _custom_via_points_active
Keep track whether valid via-points have been received from via_points_sub_.
~MpcLocalPlannerROS()
Destructor of the plugin.
void customObstacleCB(const costmap_converter::ObstacleArrayMsg::ConstPtr &obst_msg)
Callback for the dynamic_reconfigure node.
struct mpc_local_planner::MpcLocalPlannerROS::CostmapConverterPlugin _costmap_conv_params
void updateObstacleContainerWithCostmap()
Update internal obstacle vector based on occupied costmap cells.
ros::Time _time_last_infeasible_plan
Store at which time stamp the last infeasible plan was detected.
void getRobotVel(geometry_msgs::PoseStamped &robot_vel)
Costmap2D * getCostmap()
#define ROS_ERROR_STREAM(args)
double distance_points2d(const P1 &point1, const P2 &point2)
Implements both nav_core::BaseLocalPlanner and mbf_costmap_core::CostmapController abstract interface...
void setInitialPlanEstimateOrientation(bool estimate)
Definition: controller.h:82
list line_end
std::vector< geometry_msgs::Point > getRobotFootprint()
#define PLUGINLIB_EXPORT_CLASS(class_type, base_class_type)
PlainMatrixType mat * n
#define ROS_ERROR(...)
void mapToWorld(unsigned int mx, unsigned int my, double &wx, double &wy) const
bool configure(ros::NodeHandle &nh, const teb_local_planner::ObstContainer &obstacles, teb_local_planner::RobotFootprintModelPtr robot_model, const std::vector< teb_local_planner::PoseSE2 > &via_points)
Definition: controller.cpp:58
unsigned char getCost(unsigned int mx, unsigned int my) const
StageInequalitySE2::Ptr getInequalityConstraint()
Definition: controller.h:76
std::shared_ptr< base_local_planner::CostmapModel > _costmap_model
std::string _robot_base_frame
Used as the base frame id of the robot.
Eigen::Isometry3d transformToEigen(const geometry_msgs::Transform &t)
virtual bool isPoseTrajectoryFeasible(base_local_planner::CostmapModel *costmap_model, const std::vector< geometry_msgs::Point > &footprint_spec, double inscribed_radius=0.0, double circumscribed_radius=0.0, double min_resolution_collision_check_angular=M_PI, int look_ahead_idx=-1)
Check whether the planned trajectory is feasible or not.
Definition: controller.cpp:859
void initialize(std::string name, tf2_ros::Buffer *tf, costmap_2d::Costmap2DROS *costmap_ros)
Initializes the teb plugin.
void calculateMinAndMaxDistances(const std::vector< geometry_msgs::Point > &footprint, double &min_dist, double &max_dist)
#define ROS_DEBUG(...)


mpc_local_planner
Author(s): Christoph Rösmann
autogenerated on Mon Feb 28 2022 22:53:18