40 #include <base_local_planner/goal_functions.h>
41 #include <pluginlib/class_list_macros.h>
42 #include <angles/angles.h>
47 namespace rsband_local_planner
61 tf::TransformListener* tfListener, costmap_2d::Costmap2DROS* costmapROS)
65 ROS_WARN(
"Planner already initialized. Should not be called more than "
74 ros::NodeHandle pnh(
"~/" + name);
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);
85 ebandPlanner_ = boost::shared_ptr<eband_local_planner::EBandPlanner>(
86 new eband_local_planner::EBandPlanner(name,
costmapROS_));
89 rsPlanner_ = boost::shared_ptr<ReedsSheppPlanner>(
98 drs::CallbackType cb =
100 drs_->setCallback(cb);
105 ROS_DEBUG(
"Local Planner Plugin Initialized!");
121 ROS_ERROR(
"Reconfigure CB called before reeds shepp planner "
125 ptc_->reconfigure(config);
127 ROS_ERROR(
"Reconfigure CB called before path tracking controller "
133 const std::vector<geometry_msgs::PoseStamped>& globalPlan)
137 ROS_ERROR(
"Planner must be initialized before setPlan is called!");
143 std::vector<int> planStartEndCounters(2,
globalPlan_.size());
147 planStartEndCounters))
149 ROS_WARN(
"Could not transform global plan to the local frame");
155 ROS_WARN(
"Transformed Plan is empty.");
165 ROS_ERROR(
"Setting plan to Elastic Band failed!");
173 ROS_WARN(
"Optimization of eband failed!");
184 ROS_ERROR(
"Planner must be initialized before computeVelocityCommands "
189 std::vector<geometry_msgs::PoseStamped> ebandPlan, rsPlan, localPlan;
201 ROS_ERROR(
"Failed to update eband!");
206 || ebandPlan.empty())
208 ROS_ERROR(
"Failed to get eband planner plan!");
221 failIdx = ebandPlan.size() *
rsPlanner_->planPath(
222 ebandPlan.front(), ebandPlan.back(), rsPlan);
230 && next < ebandPlan.size()-1)
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);
239 failIdx =
rsPlanner_->planPath(ebandPlan.front(), ebandPlan[next],
244 failIdx =
rsPlanner_->planPathUntilFailure(ebandPlan, rsPlan);
247 failIdx =
rsPlanner_->planPathSkipFailures(ebandPlan, rsPlan);
250 failIdx =
rsPlanner_->planRecedingPath(ebandPlan, rsPlan);
253 ROS_ERROR(
"Invalid eband_to_rs_strategy!");
257 double dyaw = fabs(angles::shortest_angular_distance(
258 tf::getYaw(ebandPlan[0].pose.orientation),
259 tf::getYaw(ebandPlan[1].pose.orientation)));
265 ROS_DEBUG(
"Failed to get reeds shepp plan. Attempting "
266 "emergency planning...");
271 ROS_DEBUG(
"Commencing Emergency Mode.");
277 ebandPlan[std::min<int>(1,ebandPlan.size()-1)].pose.orientation;
286 ROS_DEBUG(
"Emergency Planning succeeded!");
290 ROS_DEBUG(
"Emergency Planning failed!");
297 ROS_DEBUG(
"Failed to convert eband to rsband plan!");
310 base_local_planner::publishPlan(rsPlan,
rsPlanPub_);
313 if (!
ptc_->computeVelocityCommands(localPlan, cmd))
315 ROS_ERROR(
"Path tracking controller failed to produce command");
328 ROS_ERROR(
"Planner must be initialized before isGoalReached is called!");
332 tf::Stamped<tf::Pose> robotPose;
335 ROS_ERROR(
"Could not get robot pose!");
339 geometry_msgs::PoseStamped goal =
globalPlan_.back();
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));
348 ROS_INFO(
"Goal Reached!");
360 ROS_WARN(
"Planner must be initialized before updateEBand is called!");
365 tf::Stamped<tf::Pose> robotPose;
368 ROS_ERROR(
"Could not get robot pose!");
372 geometry_msgs::PoseStamped robotPoseMsg;
373 tf::poseStampedTFToMsg(robotPose, robotPoseMsg);
375 std::vector<geometry_msgs::PoseStamped> tmpPlan(1, robotPoseMsg);
378 if (!
ebandPlanner_->addFrames(tmpPlan, eband_local_planner::add_front))
380 ROS_WARN(
"Could not connect current robot pose to existing eband!");
390 planStartEndCounters))
392 ROS_WARN(
"Failed to transform the global plan to the local frame!");
398 ROS_WARN(
"Transformed plan is empty!");
402 std::vector<geometry_msgs::PoseStamped> planToAppend;
412 int numOfDiscardedFrames =
418 if (
ebandPlanner_->addFrames(planToAppend, eband_local_planner::add_back))
422 ROS_WARN(
"Failed to add frames to existing band");
429 ROS_WARN(
"Failed to optimize eband!");
438 std::vector<geometry_msgs::PoseStamped>& ebandPlan,
439 std::vector<geometry_msgs::PoseStamped>& emergencyPlan)
441 std::vector<geometry_msgs::PoseStamped> tmpPlan = ebandPlan;
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));
450 int factor = floor(fabs(dyawOrig - dyaw) * 180.0 / M_PI / 45.0);
452 double step = (factor+1) * 45.0 * M_PI / 180.0;
454 tmpPlan[1].pose.orientation = tf::createQuaternionMsgFromYaw(
455 tf::getYaw(tmpPlan[2].pose.orientation) + (step + 0.5) * (dyaw > 0 ? 1 : -1));
457 if (
rsPlanner_->planPath(tmpPlan[0], tmpPlan[1], emergencyPlan))
465 std::vector<geometry_msgs::PoseStamped>& plan)
467 for (
unsigned int i = 1; i < plan.size() - 1; i++)
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;
473 plan[i].pose.orientation = tf::createQuaternionMsgFromYaw(yaw);
474 plan[i].header.stamp = plan.front().header.stamp;
476 plan.back().header.stamp = plan.front().header.stamp;
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;
bool isGoalReached()
Checks whether the goal is reached.
ros::Publisher globalPlanPub_
global plan publisher
bool emergencyPlanning_
emergency mode
Path tracking controller for car like robots, based on fuzzy logic.
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
bool updateEBand()
Updates eband.
boost::shared_ptr< ReedsSheppPlanner > rsPlanner_
reeds shepp planner ptr
RSBandPlannerROS()
Constructor.
bool computeVelocityCommands(geometry_msgs::Twist &cmd)
Computes the velocity command for the robot base.
~RSBandPlannerROS()
Destructor.
dynamic_reconfigure::Server< rsband_local_planner::RSBandPlannerConfig > drs
bool emergencyMode_
emergency plan poses
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)