rsband_local_planner_ros.cpp
Go to the documentation of this file.
1 /*********************************************************************
2 *
3 * Software License Agreement (BSD License)
4 *
5 * Copyright (c) 2016, George Kouros.
6 * All rights reserved.
7 *
8 * Redistribution and use in source and binary forms, with or without
9 * modification, are permitted provided that the following conditions
10 * are met:
11 *
12 * * Redistributions of source code must retain the above copyright
13 * notice, this list of conditions and the following disclaimer.
14 * * Redistributions in binary form must reproduce the above
15 * copyright notice, this list of conditions and the following
16 * disclaimer in the documentation and/or other materials provided
17 * with the distribution.
18 * * Neither the name of the the copyright holder nor the names of its
19 * contributors may be used to endorse or promote products derived
20 * from this software without specific prior written permission.
21 *
22 * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
23 * "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT
24 * LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS
25 * FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE
26 * COPYRIGHT OWNER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT,
27 * INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING,
28 * BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES;
29 * LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER
30 * CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
31 * LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN
32 * ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE
33 * POSSIBILITY OF SUCH DAMAGE.
34 *
35 * Author: George Kouros
36 *********************************************************************/
37 
39 
40 #include <base_local_planner/goal_functions.h>
41 #include <pluginlib/class_list_macros.h>
42 #include <angles/angles.h>
43 
44 PLUGINLIB_DECLARE_CLASS(rsband_local_planner, RSBandPlannerROS,
45  rsband_local_planner::RSBandPlannerROS, nav_core::BaseLocalPlanner);
46 
47 namespace rsband_local_planner
48 {
49 
50  RSBandPlannerROS::RSBandPlannerROS() : initialized_(false)
51  {
52  }
53 
54 
56  {
57  }
58 
59 
60  void RSBandPlannerROS::initialize(std::string name,
61  tf::TransformListener* tfListener, costmap_2d::Costmap2DROS* costmapROS)
62  {
63  if (initialized_)
64  {
65  ROS_WARN("Planner already initialized. Should not be called more than "
66  "once");
67  return;
68  }
69 
70  // store tflistener and costmapROS
71  tfListener_ = tfListener;
72  costmapROS_ = costmapROS;
73 
74  ros::NodeHandle pnh("~/" + name);
75 
76  // initialize plan publishers
77  globalPlanPub_ = pnh.advertise<nav_msgs::Path>("global_plan", 1);
78  localPlanPub_ = pnh.advertise<nav_msgs::Path>("local_plan", 1);
79  ebandPlanPub_ = pnh.advertise<nav_msgs::Path>("eband_plan", 1);
80  rsPlanPub_ = pnh.advertise<nav_msgs::Path>("reeds_shepp_plan", 1);
81 
82  emergencyPoses_.resize(3);
83 
84  // create new eband planner
85  ebandPlanner_ = boost::shared_ptr<eband_local_planner::EBandPlanner>(
86  new eband_local_planner::EBandPlanner(name, costmapROS_));
87 
88  // create new reeds shepp planner
89  rsPlanner_ = boost::shared_ptr<ReedsSheppPlanner>(
91  ebandToRSStrategy_ = static_cast<EbandToRSStrategy>(0);
92 
93  // create new path tracking controller
94  ptc_ = boost::shared_ptr<FuzzyPTC>(new FuzzyPTC(name));
95 
96  // create and initialize dynamic reconfigure
97  drs_.reset(new drs(pnh));
98  drs::CallbackType cb =
99  boost::bind(&RSBandPlannerROS::reconfigureCallback, this, _1, _2);
100  drs_->setCallback(cb);
101 
102  // set initilized
103  initialized_ = true;
104 
105  ROS_DEBUG("Local Planner Plugin Initialized!");
106  }
107 
108  void RSBandPlannerROS::reconfigureCallback(RSBandPlannerConfig& config,
109  uint32_t level)
110  {
111  xyGoalTolerance_ = config.xy_goal_tolerance;
112  yawGoalTolerance_ = config.yaw_goal_tolerance;
113  updateSubGoalDistThreshold_ = config.update_sub_goal_dist_threshold;
115  static_cast<EbandToRSStrategy>(config.eband_to_rs_strategy);
116  emergencyPlanning_ = config.emergency_planning;
117 
118  if (rsPlanner_)
119  rsPlanner_->reconfigure(config);
120  else
121  ROS_ERROR("Reconfigure CB called before reeds shepp planner "
122  "initialization");
123 
124  if (ptc_)
125  ptc_->reconfigure(config);
126  else
127  ROS_ERROR("Reconfigure CB called before path tracking controller "
128  "initialization!");
129  }
130 
131 
133  const std::vector<geometry_msgs::PoseStamped>& globalPlan)
134  {
135  if (!initialized_)
136  {
137  ROS_ERROR("Planner must be initialized before setPlan is called!");
138  return false;
139  }
140 
141  globalPlan_ = globalPlan;
142 
143  std::vector<int> planStartEndCounters(2, globalPlan_.size());
144 
145  if (!eband_local_planner::transformGlobalPlan(*tfListener_, globalPlan_,
146  *costmapROS_, costmapROS_->getGlobalFrameID(), transformedPlan_,
147  planStartEndCounters))
148  {
149  ROS_WARN("Could not transform global plan to the local frame");
150  return false;
151  }
152 
153  if (transformedPlan_.empty())
154  {
155  ROS_WARN("Transformed Plan is empty.");
156  return false;
157  }
158 
159 
160  if(!ebandPlanner_->setPlan(transformedPlan_))
161  {
162  costmapROS_->resetLayers();
163  if(!ebandPlanner_->setPlan(transformedPlan_))
164  {
165  ROS_ERROR("Setting plan to Elastic Band failed!");
166  return false;
167  }
168  }
169 
170  planStartEndCounters_ = planStartEndCounters;
171 
172  if (!ebandPlanner_->optimizeBand())
173  ROS_WARN("Optimization of eband failed!");
174 
175 
176  return true;
177  }
178 
179 
180  bool RSBandPlannerROS::computeVelocityCommands(geometry_msgs::Twist& cmd)
181  {
182  if (!initialized_)
183  {
184  ROS_ERROR("Planner must be initialized before computeVelocityCommands "
185  "is called!");
186  return false;
187  }
188 
189  std::vector<geometry_msgs::PoseStamped> ebandPlan, rsPlan, localPlan;
190 
191  if (isGoalReached())
192  {
193  cmd.linear.x = 0.0;
194  cmd.linear.y = 0.0;
195  cmd.angular.z = 0.0;
196  }
197  else
198  {
199  if (!updateEBand())
200  {
201  ROS_ERROR("Failed to update eband!");
202  return false;
203  }
204 
205  if (!ebandPlanner_->getPlan(ebandPlan)
206  || ebandPlan.empty())
207  {
208  ROS_ERROR("Failed to get eband planner plan!");
209  return false;
210  }
211 
212  // interpolate orientations of eband plan
213  interpolateOrientations(ebandPlan);
214 
215  // use reeds shepp planner to connect eband waypoints using RS paths
216  // select between the available eband to reeds shepp conversion strategies
217  int failIdx;
218  switch (ebandToRSStrategy_)
219  {
220  case startToEnd:
221  failIdx = ebandPlan.size() * rsPlanner_->planPath(
222  ebandPlan.front(), ebandPlan.back(), rsPlan);
223  break;
224  case startToNext:
225  {
226  // TODO: move below segment to reeds_shepp_planner new function
227  int next = 0;
228  double dist = 0.0;
229  while (dist < updateSubGoalDistThreshold_
230  && next < ebandPlan.size()-1)
231  {
232  next++;
233  dist += hypot(
234  ebandPlan[next-1].pose.position.x
235  - ebandPlan[next].pose.position.x,
236  ebandPlan[next-1].pose.position.y
237  - ebandPlan[next].pose.position.y);
238  }
239  failIdx = rsPlanner_->planPath(ebandPlan.front(), ebandPlan[next],
240  rsPlan);
241  break;
242  }
243  case pointToPoint:
244  failIdx = rsPlanner_->planPathUntilFailure(ebandPlan, rsPlan);
245  break;
246  case skipFailures:
247  failIdx = rsPlanner_->planPathSkipFailures(ebandPlan, rsPlan);
248  break;
249  case startToRecedingEnd:
250  failIdx = rsPlanner_->planRecedingPath(ebandPlan, rsPlan);
251  break;
252  default: // invalid strategy
253  ROS_ERROR("Invalid eband_to_rs_strategy!");
254  exit(EXIT_FAILURE);
255  }
256 
257  double dyaw = fabs(angles::shortest_angular_distance(
258  tf::getYaw(ebandPlan[0].pose.orientation),
259  tf::getYaw(ebandPlan[1].pose.orientation)));
260 
261  // if reeds shepp planning failed or there is orientation error > π/4
262  // attempt emergency planning to reach target orientation (if enabled)
263  if (emergencyPlanning_ && (failIdx == 0 || dyaw > M_PI/2))
264  {
265  ROS_DEBUG("Failed to get reeds shepp plan. Attempting "
266  "emergency planning...");
267 
268  // enable emergency mode if not already enable
269  if (!emergencyMode_)
270  {
271  ROS_DEBUG("Commencing Emergency Mode.");
272  emergencyMode_ = true;
273  // add initial robot pose as emergency goal pose but with desired
274  // orientation
275  emergencyPoses_[1] = ebandPlan[0];
276  emergencyPoses_[1].pose.orientation =
277  ebandPlan[std::min<int>(1,ebandPlan.size()-1)].pose.orientation;
278  emergencyPoses_[2] = ebandPlan[0];
279  }
280 
281  emergencyPoses_[0] = ebandPlan[0];
282 
283 
284  if (emergencyPlan(emergencyPoses_, rsPlan))
285  {
286  ROS_DEBUG("Emergency Planning succeeded!");
287  }
288  else
289  {
290  ROS_DEBUG("Emergency Planning failed!");
291  emergencyMode_ = false;
292  return false;
293  }
294  }
295  else if (!failIdx)
296  {
297  ROS_DEBUG("Failed to convert eband to rsband plan!");
298  return false;
299  }
300  else
301  emergencyMode_ = false;
302 
303  // set reeds shepp plan as local plan
304  localPlan = rsPlan;
305 
306  // publish plans
307  base_local_planner::publishPlan(globalPlan_, globalPlanPub_);
308  base_local_planner::publishPlan(localPlan, localPlanPub_);
309  base_local_planner::publishPlan(ebandPlan, ebandPlanPub_);
310  base_local_planner::publishPlan(rsPlan, rsPlanPub_);
311 
312  // compute velocity command
313  if (!ptc_->computeVelocityCommands(localPlan, cmd))
314  {
315  ROS_ERROR("Path tracking controller failed to produce command");
316  return false;
317  }
318  }
319 
320  return true;
321  }
322 
323 
325  {
326  if (!initialized_)
327  {
328  ROS_ERROR("Planner must be initialized before isGoalReached is called!");
329  return false;
330  }
331 
332  tf::Stamped<tf::Pose> robotPose;
333  if (!costmapROS_->getRobotPose(robotPose))
334  {
335  ROS_ERROR("Could not get robot pose!");
336  return false;
337  }
338 
339  geometry_msgs::PoseStamped goal = globalPlan_.back();
340 
341  double dist = base_local_planner::getGoalPositionDistance(
342  robotPose, goal.pose.position.x, goal.pose.position.y);
343  double yawDiff = base_local_planner::getGoalOrientationAngleDifference(
344  robotPose, tf::getYaw(goal.pose.orientation));
345 
346  if (dist < xyGoalTolerance_ && fabs(yawDiff) < yawGoalTolerance_)
347  {
348  ROS_INFO("Goal Reached!");
349  return true;
350  }
351 
352  return false;
353  }
354 
355 
357  {
358  if (!initialized_)
359  {
360  ROS_WARN("Planner must be initialized before updateEBand is called!");
361  return false;
362  }
363 
364  // get robot pose
365  tf::Stamped<tf::Pose> robotPose;
366  if (!costmapROS_->getRobotPose(robotPose))
367  {
368  ROS_ERROR("Could not get robot pose!");
369  return false;
370  }
371  // transform robot pose tf to msg
372  geometry_msgs::PoseStamped robotPoseMsg;
373  tf::poseStampedTFToMsg(robotPose, robotPoseMsg);
374 
375  std::vector<geometry_msgs::PoseStamped> tmpPlan(1, robotPoseMsg);
376 
377  // add robot pose to front of eband
378  if (!ebandPlanner_->addFrames(tmpPlan, eband_local_planner::add_front))
379  {
380  ROS_WARN("Could not connect current robot pose to existing eband!");
381  return false;
382  }
383 
384  // add new frames that have entered the local costmap window and remove the
385  // ones that have left it
386 
387  std::vector<int> planStartEndCounters = planStartEndCounters_;
388  if (!eband_local_planner::transformGlobalPlan(*tfListener_, globalPlan_,
389  *costmapROS_, costmapROS_->getGlobalFrameID(), transformedPlan_,
390  planStartEndCounters))
391  {
392  ROS_WARN("Failed to transform the global plan to the local frame!");
393  return false;
394  }
395 
396  if (transformedPlan_.empty())
397  {
398  ROS_WARN("Transformed plan is empty!");
399  return false;
400  }
401 
402  std::vector<geometry_msgs::PoseStamped> planToAppend;
403 
404  if (planStartEndCounters_[1] > planStartEndCounters[1])
405  {
406  if (planStartEndCounters_[1] > planStartEndCounters[0])
407  {
408  planToAppend = transformedPlan_;
409  }
410  else
411  {
412  int numOfDiscardedFrames =
413  planStartEndCounters[0] - planStartEndCounters_[1];
414  planToAppend.assign(transformedPlan_.begin() + numOfDiscardedFrames + 1,
415  transformedPlan_.end());
416  }
417 
418  if (ebandPlanner_->addFrames(planToAppend, eband_local_planner::add_back))
419  planStartEndCounters_ = planStartEndCounters;
420  else
421  {
422  ROS_WARN("Failed to add frames to existing band");
423  return false;
424  }
425  }
426 
427  if (!ebandPlanner_->optimizeBand())
428  {
429  ROS_WARN("Failed to optimize eband!");
430  return false;
431  }
432 
433  return true;
434  }
435 
436 
438  std::vector<geometry_msgs::PoseStamped>& ebandPlan,
439  std::vector<geometry_msgs::PoseStamped>& emergencyPlan)
440  {
441  std::vector<geometry_msgs::PoseStamped> tmpPlan = ebandPlan;
442 
443  double dyawOrig = angles::shortest_angular_distance(
444  tf::getYaw(tmpPlan[2].pose.orientation),
445  tf::getYaw(tmpPlan[1].pose.orientation));
446  double dyaw = angles::shortest_angular_distance(
447  tf::getYaw(tmpPlan[0].pose.orientation),
448  tf::getYaw(tmpPlan[1].pose.orientation));
449 
450  int factor = floor(fabs(dyawOrig - dyaw) * 180.0 / M_PI / 45.0);
451 
452  double step = (factor+1) * 45.0 * M_PI / 180.0;
453 
454  tmpPlan[1].pose.orientation = tf::createQuaternionMsgFromYaw(
455  tf::getYaw(tmpPlan[2].pose.orientation) + (step + 0.5) * (dyaw > 0 ? 1 : -1));
456 
457  if (rsPlanner_->planPath(tmpPlan[0], tmpPlan[1], emergencyPlan))
458  return true;
459 
460  return false;
461  }
462 
463 
465  std::vector<geometry_msgs::PoseStamped>& plan)
466  {
467  for (unsigned int i = 1; i < plan.size() - 1; i++)
468  {
469  double dx, dy, yaw;
470  dx = plan[i+1].pose.position.x - plan[i].pose.position.x;
471  dy = plan[i+1].pose.position.y - plan[i].pose.position.y;
472  yaw = atan2(dy, dx);
473  plan[i].pose.orientation = tf::createQuaternionMsgFromYaw(yaw);
474  plan[i].header.stamp = plan.front().header.stamp;
475  }
476  plan.back().header.stamp = plan.front().header.stamp;
477 
478  if ((!plan.back().pose.orientation.z && !plan.back().pose.orientation.w)
479  || tf::getYaw(plan.back().pose.orientation) == 0.0)
480  plan.back().pose.orientation = plan[plan.size()-2].pose.orientation;
481  }
482 
483 } // namespace rsband_local_planner
bool isGoalReached()
Checks whether the goal is reached.
ros::Publisher globalPlanPub_
global plan publisher
Path tracking controller for car like robots, based on fuzzy logic.
Definition: fuzzy_ptc.h:62
boost::shared_ptr< eband_local_planner::EBandPlanner > ebandPlanner_
eband planner ptr
double yawGoalTolerance_
angular deviation from goal pose tolerance
void initialize(std::string name, tf::TransformListener *tfListener, costmap_2d::Costmap2DROS *costmapROS)
Initializes planner.
double updateSubGoalDistThreshold_
dist threshold used when updating sub goal
std::vector< geometry_msgs::PoseStamped > transformedPlan_
transformed plan
boost::shared_ptr< drs > drs_
dynamic reconfigure server ptr
void reconfigureCallback(RSBandPlannerConfig &config, uint32_t level)
Reconfigures node parameters.
costmap_2d::Costmap2DROS * costmapROS_
costmap ROS wrapper ptr
boost::shared_ptr< ReedsSheppPlanner > rsPlanner_
reeds shepp planner ptr
bool computeVelocityCommands(geometry_msgs::Twist &cmd)
Computes the velocity command for the robot base.
dynamic_reconfigure::Server< rsband_local_planner::RSBandPlannerConfig > drs
double xyGoalTolerance_
distance to goal tolerance
boost::shared_ptr< FuzzyPTC > ptc_
path tracking controller ptr
std::vector< int > planStartEndCounters_
eband plan start and end indexes regarding global plan
std::vector< geometry_msgs::PoseStamped > globalPlan_
global plan
ros::Publisher ebandPlanPub_
eband plan publisher
A local planner plugin for move_base of ROS, for car like robots.
void interpolateOrientations(std::vector< geometry_msgs::PoseStamped > &plan)
Interpolates pose orientations of the given plan.
ros::Publisher localPlanPub_
local plan publisher
ros::Publisher rsPlanPub_
rs plan publisher
tf::TransformListener * tfListener_
tf transform listener ptr
EbandToRSStrategy ebandToRSStrategy_
eband to reeds shepp band conversion strategy
std::vector< geometry_msgs::PoseStamped > emergencyPoses_
bool emergencyPlan(std::vector< geometry_msgs::PoseStamped > &ebandPlan, std::vector< geometry_msgs::PoseStamped > &emergencyPlan)
Attempts an emergency plan in case actual plan failed.
EbandToRSStrategy
eband to rs planning strategy enum
Planner - ROS wrapper for the Reeds-Shepp state space of OMPL.
bool setPlan(const std::vector< geometry_msgs::PoseStamped > &globalPlan)
Sets the global plan to be followed by this planner.
PLUGINLIB_DECLARE_CLASS(rsband_local_planner, RSBandPlannerROS, rsband_local_planner::RSBandPlannerROS, nav_core::BaseLocalPlanner)


rsband_local_planner
Author(s): George Kouros
autogenerated on Wed Nov 9 2016 19:13:53