40 #include <ros/package.h>
43 #include <boost/foreach.hpp>
44 #include <yaml-cpp/yaml.h>
48 double rad2deg(
double rad)
50 return rad * 180.0 / M_PI;
53 double deg2rad(
double deg)
55 return deg * M_PI / 180.0;
59 namespace rsband_local_planner
64 pnh_ =
new ros::NodeHandle(
"~/" + name);
81 ROS_ERROR(
"Controller already initialized!");
86 if (
pnh_->hasParam(
"fuzzy_rules"))
90 ROS_FATAL(
"Failed to load speed fuzzy rules!");
94 if (
pnh_->getParam(
"fuzzy_rules/front_steering_rules",
97 ROS_FATAL(
"Failed to load front steering fuzzy rules!");
101 if (
pnh_->getParam(
"fuzzy_rules/rear_steering_deviation_rules",
103 ROS_WARN(
"Failed to load rear steering deviation fuzzy rules!");
107 std::string pkgPath = ros::package::getPath(
"rsband_local_planner");
108 YAML::Node config = YAML::LoadFile(
109 pkgPath +
"/cfg/path_tracking_controller_fuzzy_rules.yaml");
112 config[
"fuzzy_rules"][
"speed_rules"].as< std::vector<std::string> >();
114 config[
"fuzzy_rules"][
"front_steering_rules"].as<
115 std::vector<std::string> >();
117 config[
"fuzzy_rules"][
"rear_steering_deviation_rules"].as<
118 std::vector<std::string> >();
122 subGoal_.type = visualization_msgs::Marker::SPHERE;
125 subGoalPub_ =
pnh_->advertise<visualization_msgs::Marker>(
"sub_goal", 1);
155 ROS_ERROR(
"Fuzzy Engine Initialization attempted before controller "
161 engine_->setName(
"fuzzy_path_tracking_controller");
170 direction_->addTerm(
new fl::Ramp(
"FW", -0.1, 0.1));
171 direction_->addTerm(
new fl::Ramp(
"BW", 0.1, -0.1));
195 orientationError_->addTerm(
new fl::Trapezoid(
"RBR", -180.0, -180.0, -175.0, -165.0));
196 orientationError_->addTerm(
new fl::Trapezoid(
"RR", -175.0, -165.0, -130.0, -120.0));
197 orientationError_->addTerm(
new fl::Trapezoid(
"SR", -130.0, -120.0, -35.0, -25.0));
203 orientationError_->addTerm(
new fl::Trapezoid(
"RBL", 165.0, 175.0, 180.0, 180.0));
210 positionError_->setRange(0.0, std::numeric_limits<double>::infinity());
220 -std::numeric_limits<double>::infinity(),
221 std::numeric_limits<double>::infinity());
266 speed_ =
new fl::OutputVariable;
269 speed_->setDefaultValue(0.0);
271 speed_->fuzzyOutput()->setAccumulation(fl::null);
272 speed_->setDefuzzifier(
new fl::WeightedAverage(
"TakagiSugeno"));
297 "Minimum",
"Maximum",
"Minimum",
"Maximum",
"WeightedAverage");
300 if (!
engine_->isReady(&status))
301 throw fl::Exception(
"Engine not ready. "
302 "The following errors were encountered:\n" + status, FL_AT);
307 const std::vector<geometry_msgs::PoseStamped>& path,
308 geometry_msgs::Twist& cmd)
312 ROS_ERROR(
"Plan given to path tracking controller is empty!");
322 int drcn = (rad2deg(fabs(ea)) < 120) ? 1 : -1;
325 rad2deg(ea), rad2deg(eo), ep, ey);
329 cmd = *
new geometry_msgs::Twist;
341 double vel = drcn *
speed_->getOutputValue();
361 ROS_FATAL(
"Invalid Steering Mode. Exiting...");
368 double beta = atan((tan(fsa) + tan(rsa)) / 2);
371 cmd.linear.x = vel * sqrt(1 / (1 + pow(tan(beta), 2)));
372 cmd.linear.y = vel * tan(beta) * sqrt(1 / (1 + pow(tan(beta), 2)));
373 cmd.angular.z = vel * cos(beta) * (tan(fsa) - tan(rsa)) /
wheelbase_;
376 "vx: %.3f, vy: %.3f, w: %.3f, fsa: %.3f, rsa: %.3f",
377 cmd.linear.x, cmd.linear.y, cmd.angular.z, rad2deg(fsa), rad2deg(rsa));
379 if (isnan(cmd.linear.x) or isnan(cmd.linear.y))
381 ROS_ERROR(
"Speed=Nan. Something went wrong!");
386 if (isnan(cmd.angular.z))
388 ROS_ERROR(
"RotVel=Nan. Something went wrong!");
405 const std::vector<geometry_msgs::PoseStamped>& path)
407 bool positionReached =
409 bool orientationReached =
411 return positionReached && orientationReached;
416 const std::vector<geometry_msgs::PoseStamped>& path,
417 unsigned int subGoalIdx)
419 return atan2(path[subGoalIdx].pose.position.y,
420 path[subGoalIdx].pose.position.x);
425 const std::vector<geometry_msgs::PoseStamped>& path,
426 unsigned int subGoalIdx)
428 return tf::getYaw(path[subGoalIdx].pose.orientation);
433 const std::vector<geometry_msgs::PoseStamped>& path,
434 unsigned int subGoalIdx)
436 return hypot(path[subGoalIdx].pose.position.x, path[subGoalIdx].pose.position.y);
441 const std::vector<geometry_msgs::PoseStamped>& path,
442 unsigned int subGoalIdx)
450 const std::vector<geometry_msgs::PoseStamped>& path,
451 unsigned int idx1,
unsigned int idx2)
453 double x0, x1, y0, y1;
454 x0 = path[idx1].pose.position.x;
455 y0 = path[idx1].pose.position.y;
456 x1 = path[idx2].pose.position.x;
457 y1 = path[idx2].pose.position.y;
458 return hypot(x1 - x0, y1 - y0);
463 const std::vector<geometry_msgs::PoseStamped>& path)
465 unsigned int subGoalIdx = 0;
470 distance +=
calcDistance(path, subGoalIdx, subGoalIdx+1);
480 subGoal_.header = path.front().header;
481 subGoal_.pose = path[subGoalIdx].pose;
489 const std::vector<geometry_msgs::PoseStamped>& path,
492 if (idx < 1 || idx >= path.size() - 2)
495 geometry_msgs::Point a, b;
496 a.x = path[idx].pose.position.x - path[idx-1].pose.position.x;
497 a.y = path[idx].pose.position.y - path[idx-1].pose.position.y;
498 b.x = path[idx].pose.position.x - path[idx+1].pose.position.x;
499 b.y = path[idx].pose.position.y - path[idx+1].pose.position.y;
501 double angle = acos((a.x * b.x + a.y * b.y) / hypot(a.x, a.y)
504 return !isnan(angle) && (fabs(angle) < 1.0);
fl::OutputVariable * frontSteeringAngle_
steering angle output variable 1
fl::InputVariable * direction_
direction (forwards/backwards) input variable
unsigned int findSubGoal(const std::vector< geometry_msgs::PoseStamped > &path)
Finds the current sub goal to follow.
fl::RuleBlock * ruleBlock_
flc rule block
fl::InputVariable * lateralDeviationError_
lateral deviation error
ros::Publisher subGoalPub_
publisher of the current sub goal marker
double maxSteeringAngle_
the max steering angle of the virtual middle wheel
double calcAngularDeviationError(const std::vector< geometry_msgs::PoseStamped > &path, unsigned int subGoalIdx)
Calculates angular deviation from subgoal.
double calcPositionError(const std::vector< geometry_msgs::PoseStamped > &path, unsigned int subGoalIdx)
Calculates the distance between the robot and the sub goal.
double calcOrientationError(const std::vector< geometry_msgs::PoseStamped > &path, unsigned int subGoalIdx)
Calculates the orientation error between the robot and the sub goal.
visualization_msgs::Marker subGoal_
sub goal visualization marker
void reconfigure(RSBandPlannerConfig &config)
Reconfigures controller params.
fl::OutputVariable * speed_
speed output variable
double yawGoalTolerance_
yaw goal tolerance
fl::InputVariable * positionError_
robot to goal distance error input variable
std::vector< std::string > frontSteeringRules_
front steering rules
std::vector< std::string > rearSteeringDeviationRules_
rear steering deviation rules
bool initialized_
variable indicating whether the controller has been initialized
FuzzyPTC(std::string name)
double calcLateralDeviationError(const std::vector< geometry_msgs::PoseStamped > &path, unsigned int subGoalIdx)
Calculates the lateral deviation from the sub goal.
double calcDistance(const std::vector< geometry_msgs::PoseStamped > &path, unsigned int idx1, unsigned int idx2)
Calculates the distance between two path waypoints.
ros::NodeHandle * pnh_
private ros node handle
fl::InputVariable * angularDeviationError_
robot to goal direction orientation error input variable
void initialize()
Initializes controller.
fl::InputVariable * orientationError_
robot to final goal orientation error input variable
double updateSubGoalDistThreshold_
subGoal step
fl::OutputVariable * rearSteeringDeviationAngle_
rear steering deviation angle output variable
double goalDistThreshold_
distance to goal threshold
RearSteeringMode rearSteeringMode_
rear wheel steering mode (none/counter/crab/hybrid)
double xyGoalTolerance_
xy goal tolerance threshold
RearSteeringMode
rear steering mode enum
void initializeFuzzyEngine()
Initializes fuzzy engine.
bool isCuspPoint(const std::vector< geometry_msgs::PoseStamped > &path, unsigned int idx)
Checks whether a path waypoint is a cusp point.
bool isGoalReached(const std::vector< geometry_msgs::PoseStamped > &path)
Checks if the goal position and orientation have been reached.
double maxSpeed_
max speed
bool stop_
if true controller returns zero velocity commands
bool computeVelocityCommands(const std::vector< geometry_msgs::PoseStamped > &path, geometry_msgs::Twist &cmd)
Computes velocity commands.
std::vector< std::string > speedRules_
speed rules
fl::Engine * engine_
position FLC engine
double wheelbase_
the robot wheelbase
double latDevTolerance_
lateral deviation tolerance
bool displayControllerIO_
display current trajectory information