40 #include <boost/foreach.hpp>
42 namespace rsband_local_planner
46 costmap_2d::Costmap2DROS* costmapROS,
47 tf::TransformListener* tfListener)
49 reedsSheppStateSpace_(new ompl::base::ReedsSheppStateSpace),
50 simpleSetup_(new ompl::geometric::SimpleSetup(reedsSheppStateSpace_)),
51 costmapROS_(), tfListener_(), bx_(10), by_(10), bounds_(2),
66 costmap_2d::Costmap2DROS* costmapROS,
67 tf::TransformListener* tfListener)
72 ros::NodeHandle pnh(
"~/" + name);
89 ROS_FATAL(
"No tf listener provided.");
98 costmap_->getSizeInMetersY() + 0.02);
102 ROS_WARN(
"No costmap provided. Collision checking unavailable. "
103 "Same robot_frame and global_frame assumed.");
113 rsband_local_planner::RSBandPlannerConfig& config)
125 config.rear_steering_mode);
126 switch (rearSteeringMode)
135 config.wheelbase / 2 / tan(config.max_steering_angle);
138 ROS_ERROR(
"Invalid rear steering mode:[%d]. Exiting...",
156 geometry_msgs::PoseStamped& poseOut, std::string targetFrameID)
158 tf::Stamped<tf::Pose> tfIn, tfOut;
159 tf::poseStampedMsgToTF(poseIn, tfIn);
161 tf::poseStampedTFToMsg(tfOut, poseOut);
165 tf::Stamped<tf::Pose>& tfOut, std::string targetFrameID)
169 tfIn.frame_id_, tfOut);
174 const ompl::base::State* state, geometry_msgs::PoseStamped& pose)
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());
182 pose.header.stamp =
stamp_;
187 const geometry_msgs::PoseStamped& pose, ompl::base::State* state)
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));
198 const ompl::base::SpaceInformation* si,
const ompl::base::State *state)
201 if (!si->satisfiesBounds(state))
207 const ompl::base::SE2StateSpace::StateType *s =
208 state->as<ompl::base::SE2StateSpace::StateType>();
213 if (fabs(s->getX()) < 1e-3 && fabs(s->getY()) < 1e-3
214 && fabs(s->getYaw()) < 0.1)
218 geometry_msgs::PoseStamped statePose;
229 costmap_->worldToMapEnforceBounds(statePose.pose.position.x,
230 statePose.pose.position.y, mx, my);
235 statePose.pose.position.x, statePose.pose.position.y,
236 tf::getYaw(statePose.pose.orientation),
footprint_);
251 const geometry_msgs::PoseStamped& startPose,
252 const geometry_msgs::PoseStamped& goalPose,
253 std::vector<geometry_msgs::PoseStamped>& path)
257 ROS_ERROR(
"Planner not initialized!");
264 std::cout.setstate(std::ios_base::failbit);
265 std::cerr.setstate(std::ios_base::failbit);
273 ompl::base::SpaceInformationPtr si(
simpleSetup_->getSpaceInformation());
276 si->setStateValidityCheckingResolution(
costmap_->getResolution());
278 stamp_ = startPose.header.stamp;
281 geometry_msgs::PoseStamped localStartPose, localGoalPose;
289 localStartPose = startPose;
290 localGoalPose = goalPose;
307 ROS_DEBUG(
"[reeds_shepp_planner] Valid plan found");
313 ompl::geometric::PathGeometric omplPath =
simpleSetup_->getSolutionPath();
322 path.resize(omplPath.getStateCount());
325 for (
unsigned int i = 0; i < omplPath.getStateCount(); i++)
327 const ompl::base::State* state = omplPath.getState(i);
330 path[i].header.stamp = ros::Time::now();
342 const std::vector<geometry_msgs::PoseStamped>& path,
343 std::vector<geometry_msgs::PoseStamped>& newPath)
347 for (
unsigned int i = 0; i < path.size() - 1; i++)
349 std::vector<geometry_msgs::PoseStamped> tmpPath;
351 if (!
planPath(path[i], path[i+1], tmpPath))
354 newPath.insert(newPath.end(), tmpPath.begin(), tmpPath.end());
357 return path.size()-1;
361 const std::vector<geometry_msgs::PoseStamped>& path,
362 std::vector<geometry_msgs::PoseStamped>& newPath)
366 for (
unsigned int i = 0; i < path.size() - 1; i++)
368 std::vector<geometry_msgs::PoseStamped> tmpPath;
370 unsigned int end = i + 1;
372 while (!
planPath(path[i], path[end++], tmpPath))
373 if (end > path.size() - 1)
378 newPath.insert(newPath.end(), tmpPath.begin(), tmpPath.end());
381 return path.size()-1;
385 const std::vector<geometry_msgs::PoseStamped>& path,
386 std::vector<geometry_msgs::PoseStamped>& newPath)
390 for (
unsigned int i = path.size() - 1; i > 0; i--)
392 if (
planPath(path[0], path[i], newPath))
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.
double bx_
boundary size x
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 by_
boundary size y
StateCheckingMode
state checking mode enum
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
void setBoundaries(double bx, double by)
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.
RearSteeringMode
steering mode enum
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
~ReedsSheppPlanner()
Destructor.