reeds_shepp_planner.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 #include <tf/tf.h>
40 #include <boost/foreach.hpp>
41 
42 namespace rsband_local_planner
43 {
45  std::string name,
46  costmap_2d::Costmap2DROS* costmapROS,
47  tf::TransformListener* tfListener)
48  :
49  reedsSheppStateSpace_(new ompl::base::ReedsSheppStateSpace),
50  simpleSetup_(new ompl::geometric::SimpleSetup(reedsSheppStateSpace_)),
51  costmapROS_(), tfListener_(), bx_(10), by_(10), bounds_(2),
52  initialized_(false)
53  {
54  initialize(name, costmapROS, tfListener);
55  }
56 
57 
59  {
60  delete costmapModel_;
61  }
62 
63 
65  std::string name,
66  costmap_2d::Costmap2DROS* costmapROS,
67  tf::TransformListener* tfListener)
68  {
69  costmapROS_ = costmapROS;
70  tfListener_ = tfListener;
71 
72  ros::NodeHandle pnh("~/" + name);
73  pnh.param("min_turning_radius", minTurningRadius_, 1.0);
74  pnh.param("max_planning_duration", maxPlanningDuration_, 0.2);
75  pnh.param<int>("valid_state_max_cost", validStateMaxCost_, 252);
76  pnh.param<int>("interpolation_num_poses", interpolationNumPoses_, 20);
77  pnh.param<bool>("allow_unknown", allowUnknown_, false);
78  pnh.param<bool>("robot_state_valid", robotStateValid_, false);
79  pnh.param<bool>("display_planner_output", displayPlannerOutput_, false);
80 
81  if (costmapROS_)
82  {
83  costmap_ = costmapROS_->getCostmap();
84  costmapModel_ = new base_local_planner::CostmapModel(*costmap_);
85  footprint_ = costmapROS_->getRobotFootprint();
86 
87  if (!tfListener_)
88  {
89  ROS_FATAL("No tf listener provided.");
90  exit(EXIT_FAILURE);
91  }
92 
93  robotFrame_ = costmapROS_->getBaseFrameID();
94  globalFrame_ = costmapROS_->getGlobalFrameID();
95 
96  // initialize the state space boundary
97  setBoundaries(costmap_->getSizeInMetersX() + 0.02,
98  costmap_->getSizeInMetersY() + 0.02);
99  }
100  else
101  {
102  ROS_WARN("No costmap provided. Collision checking unavailable. "
103  "Same robot_frame and global_frame assumed.");
104  robotFrame_ = globalFrame_ = "base_footprint";
105 
106  setBoundaries(10.0, 10.0);
107  }
108 
109  initialized_ = true;
110  }
111 
113  rsband_local_planner::RSBandPlannerConfig& config)
114  {
115  maxPlanningDuration_ = config.max_planning_duration;
116  interpolationNumPoses_ = config.interpolation_num_poses;
117  robotStateValid_ = config.robot_state_valid;
119  static_cast<StateCheckingMode>(config.state_checking_mode);
120  validStateMaxCost_ = config.valid_state_max_cost;
121  allowUnknown_ = config.allow_unknown;
122  displayPlannerOutput_ = config.display_planner_output;
123 
124  RearSteeringMode rearSteeringMode = static_cast<RearSteeringMode>(
125  config.rear_steering_mode);
126  switch (rearSteeringMode)
127  {
128  case none:
129  case crab:
130  minTurningRadius_ = config.wheelbase / tan(config.max_steering_angle);
131  break;
132  case counter:
133  case hybrid:
135  config.wheelbase / 2 / tan(config.max_steering_angle);
136  break;
137  default:
138  ROS_ERROR("Invalid rear steering mode:[%d]. Exiting...",
139  rearSteeringMode);
140  exit(EXIT_FAILURE);
141  }
142  }
143 
144  void ReedsSheppPlanner::setBoundaries(const double bx, const double by)
145  {
146  bx_ = bx;
147  by_ = by;
148  bounds_.low[0] = -by_ / 2;
149  bounds_.low[1] = -bx_ / 2;
150  bounds_.high[0] = by_ / 2;
151  bounds_.high[1] = bx_ / 2;
152  reedsSheppStateSpace_->as<ompl::base::SE2StateSpace>()->setBounds(bounds_);
153  }
154 
155  void ReedsSheppPlanner::transform(const geometry_msgs::PoseStamped& poseIn,
156  geometry_msgs::PoseStamped& poseOut, std::string targetFrameID)
157  {
158  tf::Stamped<tf::Pose> tfIn, tfOut;
159  tf::poseStampedMsgToTF(poseIn, tfIn);
160  transform(tfIn, tfOut, targetFrameID);
161  tf::poseStampedTFToMsg(tfOut, poseOut);
162  }
163 
164  void ReedsSheppPlanner::transform(const tf::Stamped<tf::Pose>& tfIn,
165  tf::Stamped<tf::Pose>& tfOut, std::string targetFrameID)
166  {
167  if (tfListener_)
168  tfListener_->transformPose(targetFrameID, stamp_, tfIn,
169  tfIn.frame_id_, tfOut);
170  }
171 
172 
174  const ompl::base::State* state, geometry_msgs::PoseStamped& pose)
175  {
176  const ompl::base::SE2StateSpace::StateType *s =
177  state->as<ompl::base::SE2StateSpace::StateType>();
178  pose.pose.position.x = s->getX();
179  pose.pose.position.y = s->getY();
180  pose.pose.orientation = tf::createQuaternionMsgFromYaw(s->getYaw());
181  pose.header.frame_id = robotFrame_;
182  pose.header.stamp = stamp_;
183  }
184 
185 
187  const geometry_msgs::PoseStamped& pose, ompl::base::State* state)
188  {
189  ompl::base::SE2StateSpace::StateType *s =
190  state->as<ompl::base::SE2StateSpace::StateType>();
191  s->setX(pose.pose.position.x);
192  s->setY(pose.pose.position.y);
193  s->setYaw(tf::getYaw(pose.pose.orientation));
194  }
195 
196 
198  const ompl::base::SpaceInformation* si, const ompl::base::State *state)
199  {
200  // check if state is inside boundary
201  if (!si->satisfiesBounds(state))
202  return false;
203 
204  if (!costmapROS_ || !tfListener_)
205  return true;
206 
207  const ompl::base::SE2StateSpace::StateType *s =
208  state->as<ompl::base::SE2StateSpace::StateType>();
209 
210  if (robotStateValid_)
211  {
212  // robot pose is always valid
213  if (fabs(s->getX()) < 1e-3 && fabs(s->getY()) < 1e-3
214  && fabs(s->getYaw()) < 0.1)
215  return true;
216  }
217 
218  geometry_msgs::PoseStamped statePose;
219  state2pose(s, statePose);
220 
221  transform(statePose, statePose, globalFrame_);
222 
223  // calculate cost of robot center or footprint
224  int cost;
225  switch (stateCheckingMode_)
226  {
227  case center: // state checking of center of robot footprint
228  int mx, my;
229  costmap_->worldToMapEnforceBounds(statePose.pose.position.x,
230  statePose.pose.position.y, mx, my);
231  cost = costmap_->getCost(mx, my);
232  break;
233  case footprint: // state checking of footprint
234  cost = costmapModel_->footprintCost(
235  statePose.pose.position.x, statePose.pose.position.y,
236  tf::getYaw(statePose.pose.orientation), footprint_);
237  }
238 
239  // check if state is valid
240  if (cost > validStateMaxCost_)
241  return false;
242 
243  if (cost == -1)
244  return allowUnknown_;
245 
246  return true;
247  }
248 
249 
251  const geometry_msgs::PoseStamped& startPose,
252  const geometry_msgs::PoseStamped& goalPose,
253  std::vector<geometry_msgs::PoseStamped>& path)
254  {
255  if (!initialized_)
256  {
257  ROS_ERROR("Planner not initialized!");
258  return false;
259  }
260 
261  // disable planner console output
263  {
264  std::cout.setstate(std::ios_base::failbit);
265  std::cerr.setstate(std::ios_base::failbit);
266  }
267 
268  // create start and goal states
269  ompl::base::ScopedState<> start(reedsSheppStateSpace_);
270  ompl::base::ScopedState<> goal(reedsSheppStateSpace_);
271 
272  // initialize state valididy checker
273  ompl::base::SpaceInformationPtr si(simpleSetup_->getSpaceInformation());
274  simpleSetup_->setStateValidityChecker(
275  boost::bind(&ReedsSheppPlanner::isStateValid, this, si.get(), _1));
276  si->setStateValidityCheckingResolution(costmap_->getResolution());
277 
278  stamp_ = startPose.header.stamp;
279 
280  // transform the start and goal poses to the robot/local reference frame
281  geometry_msgs::PoseStamped localStartPose, localGoalPose;
282  if (tfListener_)
283  {
284  transform(startPose, localStartPose, robotFrame_);
285  transform(goalPose, localGoalPose, robotFrame_);
286  }
287  else
288  {
289  localStartPose = startPose;
290  localGoalPose = goalPose;
291  }
292 
293  // convert start and goal poses to ompl base states
294  pose2state(localStartPose, start());
295  pose2state(localGoalPose, goal());
296 
297  // clear all planning data
298  simpleSetup_->clear();
299  // set new start and goal states
300  simpleSetup_->setStartAndGoalStates(start, goal);
301 
303 
304  if (!simpleSetup_->haveExactSolutionPath())
305  return false;
306  else
307  ROS_DEBUG("[reeds_shepp_planner] Valid plan found");
308 
309  // simplify solution
310  simpleSetup_->simplifySolution();
311 
312  // get solution path
313  ompl::geometric::PathGeometric omplPath = simpleSetup_->getSolutionPath();
314  // interpolate between poses
315  omplPath.interpolate(interpolationNumPoses_);
316 
317  if (omplPath.getStateCount() > interpolationNumPoses_)
318  return false;
319 
320 
321  // resize path
322  path.resize(omplPath.getStateCount());
323 
324  // convert each state to a pose and store it in path vector
325  for (unsigned int i = 0; i < omplPath.getStateCount(); i++)
326  {
327  const ompl::base::State* state = omplPath.getState(i);
328  state2pose(state, path[i]);
329  path[i].header.frame_id = robotFrame_;
330  path[i].header.stamp = ros::Time::now();
331  }
332 
333  // enable console output
334  std::cout.clear();
335  std::cerr.clear();
336 
337  return true;
338  }
339 
340 
342  const std::vector<geometry_msgs::PoseStamped>& path,
343  std::vector<geometry_msgs::PoseStamped>& newPath)
344  {
345  newPath.clear();
346 
347  for (unsigned int i = 0; i < path.size() - 1; i++)
348  {
349  std::vector<geometry_msgs::PoseStamped> tmpPath;
350 
351  if (!planPath(path[i], path[i+1], tmpPath))
352  return i;
353 
354  newPath.insert(newPath.end(), tmpPath.begin(), tmpPath.end());
355  }
356 
357  return path.size()-1;
358  }
359 
361  const std::vector<geometry_msgs::PoseStamped>& path,
362  std::vector<geometry_msgs::PoseStamped>& newPath)
363  {
364  newPath.clear();
365 
366  for (unsigned int i = 0; i < path.size() - 1; i++)
367  {
368  std::vector<geometry_msgs::PoseStamped> tmpPath;
369 
370  unsigned int end = i + 1;
371 
372  while (!planPath(path[i], path[end++], tmpPath))
373  if (end > path.size() - 1)
374  return i;
375 
376  i = end;
377 
378  newPath.insert(newPath.end(), tmpPath.begin(), tmpPath.end());
379  }
380 
381  return path.size()-1;
382  }
383 
385  const std::vector<geometry_msgs::PoseStamped>& path,
386  std::vector<geometry_msgs::PoseStamped>& newPath)
387  {
388  newPath.clear();
389 
390  for (unsigned int i = path.size() - 1; i > 0; i--)
391  {
392  if (planPath(path[0], path[i], newPath))
393  return i;
394  }
395 
396  return 0;
397  }
398 
399 
400 
401 } // namespace rsband_local_planner
double minTurningRadius_
minimum turning radius of the robot (dependent on rear steering mode)
bool isStateValid(const ompl::base::SpaceInformation *si, const ompl::base::State *state)
Checks whether a state/pose is valid.
int interpolationNumPoses_
number of poses to interpolate in the reeds shepp path
int planRecedingPath(const std::vector< geometry_msgs::PoseStamped > &path, std::vector< geometry_msgs::PoseStamped > &newPath)
Plans a Reeds-Shepp path between the start pose and a receding end pose.
void pose2state(const geometry_msgs::PoseStamped &pose, ompl::base::State *state)
Converts a pose msg to an ompl state.
bool displayPlannerOutput_
display planning information
bool allowUnknown_
if true considers unknown costmap cells as free
void initialize(std::string name, costmap_2d::Costmap2DROS *costmapROS, tf::TransformListener *tfListener)
Initializes the planner.
void reconfigure(RSBandPlannerConfig &config)
Reconfigures the parameters of the planner.
base_local_planner::CostmapModel * costmapModel_
ptr to costmap model
ompl::base::RealVectorBounds bounds_
planner space boundaries (should match local costmap boundaries)
std::string globalFrame_
the reference frame of the costmap
ReedsSheppPlanner(std::string name, costmap_2d::Costmap2DROS *costmapROS, tf::TransformListener *tfListener)
Constructor.
double maxPlanningDuration_
maximum Reeds-Shepp planning duration
tf::TransformListener * tfListener_
tf transform listener
costmap_2d::Costmap2DROS * costmapROS_
ptr to costmap ros wrapper
void state2pose(const ompl::base::State *state, geometry_msgs::PoseStamped &pose)
Converts an ompl state to a pose msg.
bool robotStateValid_
regard robot pose as free
bool planPath(const geometry_msgs::PoseStamped &startPose, const geometry_msgs::PoseStamped &goalPose, std::vector< geometry_msgs::PoseStamped > &path)
Plans a Reeds-Shepp path between the start and end poses.
void transform(const geometry_msgs::PoseStamped &poseIn, geometry_msgs::PoseStamped &poseOut, std::string newFrameID)
Transforms the given pose to the target reference frame.
costmap_2d::Costmap2D * costmap_
ptr to costmap
int validStateMaxCost_
below this cost, a state is considered valid
ros::Time stamp_
the stamp to use in path poses
int planPathUntilFailure(const std::vector< geometry_msgs::PoseStamped > &path, std::vector< geometry_msgs::PoseStamped > &newPath)
Plans a series of Reeds-Shepp paths that connect the path poses.
StateCheckingMode stateCheckingMode_
state checking mode: center(0) or footprint(1)
ompl::base::StateSpacePtr reedsSheppStateSpace_
The ompl Reeds-Sheep state space.
int planPathSkipFailures(const std::vector< geometry_msgs::PoseStamped > &path, std::vector< geometry_msgs::PoseStamped > &newPath)
Plans a series of Reeds-Shepp paths that connect the path poses.
ompl::geometric::SimpleSetupPtr simpleSetup_
OMPL geometric simple setup object.
std::string robotFrame_
the reference frame of the robot base
bool initialized_
is set if planner is initialized
std::vector< geometry_msgs::Point > footprint_
robot footprint, used in validity checking


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