fuzzy_ptc.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 <ros/package.h>
41 #include <math.h>
42 #include <tf/tf.h>
43 #include <boost/foreach.hpp>
44 #include <yaml-cpp/yaml.h>
45 
46 namespace
47 {
48  double rad2deg(double rad)
49  {
50  return rad * 180.0 / M_PI;
51  }
52 
53  double deg2rad(double deg)
54  {
55  return deg * M_PI / 180.0;
56  }
57 }
58 
59 namespace rsband_local_planner
60 {
61 
62  FuzzyPTC::FuzzyPTC(std::string name) : initialized_(false)
63  {
64  pnh_ = new ros::NodeHandle("~/" + name);
65  initialize();
66  }
67 
68 
70  {
71  delete engine_;
72  // no need to delete fuzzy variables and ruleblock, since it is done in
73  // the destructor of the engine
74  }
75 
76 
78  {
79  if (initialized_)
80  {
81  ROS_ERROR("Controller already initialized!");
82  return;
83  }
84 
85  // load fuzzy rules
86  if (pnh_->hasParam("fuzzy_rules")) // load from param server if available
87  {
88  if (pnh_->getParam("fuzzy_rules/speed_rules", speedRules_))
89  {
90  ROS_FATAL("Failed to load speed fuzzy rules!");
91  exit(EXIT_FAILURE);
92  }
93 
94  if (pnh_->getParam("fuzzy_rules/front_steering_rules",
96  {
97  ROS_FATAL("Failed to load front steering fuzzy rules!");
98  exit(EXIT_FAILURE);
99  }
100 
101  if (pnh_->getParam("fuzzy_rules/rear_steering_deviation_rules",
102  speedRules_))
103  ROS_WARN("Failed to load rear steering deviation fuzzy rules!");
104  }
105  else // load from yaml file in pkg
106  {
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");
110 
111  speedRules_ =
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> >();
119  }
120 
121  // initialize sub goal msg and publisher
122  subGoal_.type = visualization_msgs::Marker::SPHERE;
123  subGoal_.scale.x = subGoal_.scale.y = subGoal_.scale.z = 0.1;
124  subGoal_.color.b = 1.0f; subGoal_.color.a = 1;
125  subGoalPub_ = pnh_->advertise<visualization_msgs::Marker>("sub_goal", 1);
126 
127  initialized_ = true;
128  }
129 
130 
131  void FuzzyPTC::reconfigure(RSBandPlannerConfig& config)
132  {
133  wheelbase_ = config.wheelbase;
134  maxSteeringAngle_ = config.max_steering_angle;
135  maxSpeed_ = config.max_speed;
136  xyGoalTolerance_ = config.xy_goal_tolerance;
137  yawGoalTolerance_ = config.yaw_goal_tolerance;
138  latDevTolerance_ = config.lateral_deviation_tolerance;
139  updateSubGoalDistThreshold_ = config.update_sub_goal_dist_threshold;
140  goalDistThreshold_ = config.goal_dist_threshold;
141  displayControllerIO_ = config.display_controller_io;
142  stop_ = config.stop;
144  static_cast<RearSteeringMode>(config.rear_steering_mode);
145 
146  // reinitialize fuzzy engine with the updated parameters
148  }
149 
150 
152  {
153  if (!initialized_)
154  {
155  ROS_ERROR("Fuzzy Engine Initialization attempted before controller "
156  "initialization");
157  return;
158  }
159  // initialize FLC engine
160  engine_ = new fl::Engine();
161  engine_->setName("fuzzy_path_tracking_controller");
162 
163  //========================= INPUT VARIABLES ================================
164 
165  // direction input variable
166  direction_ = new fl::InputVariable;
167  direction_->setEnabled(true);
168  direction_->setName("Direction");
169  direction_->setRange(-1.0, 1.0);
170  direction_->addTerm(new fl::Ramp("FW", -0.1, 0.1));
171  direction_->addTerm(new fl::Ramp("BW", 0.1, -0.1));
172  engine_->addInputVariable(direction_);
173 
174  // angle deviation error fuzzy input variable initialization
175  angularDeviationError_ = new fl::InputVariable;
176  angularDeviationError_->setEnabled(true);
177  angularDeviationError_->setName("Ea");
178  angularDeviationError_->setRange(-180.0, 180.0);
179  angularDeviationError_->addTerm(new fl::Trapezoid("RBR", -180.0, -180.0, -175.0, -165.0));
180  angularDeviationError_->addTerm(new fl::Trapezoid("RR", -175.0, -165.0, -130.0, -120.0));
181  angularDeviationError_->addTerm(new fl::Trapezoid("SR", -130.0, -120.0, -35.0, -25.0));
182  angularDeviationError_->addTerm(new fl::Trapezoid("FR", -35.0, -25.0, -15.0, -5.0));
183  angularDeviationError_->addTerm(new fl::Trapezoid("FA", -15.0, -5.0, 5.0, 15.0));
184  angularDeviationError_->addTerm(new fl::Trapezoid("FL", 5.0, 15.0, 25.0, 35.0));
185  angularDeviationError_->addTerm(new fl::Trapezoid("SL", 25.0, 35.0, 120.0, 130.0));
186  angularDeviationError_->addTerm(new fl::Trapezoid("RL", 120.0, 130.0, 165.0, 175.0));
187  angularDeviationError_->addTerm(new fl::Trapezoid("RBL", 165.0, 175.0, 180.0, 180.0));
188  engine_->addInputVariable(angularDeviationError_);
189 
190  // orientation error input variable initialization
191  orientationError_ = new fl::InputVariable;
192  orientationError_->setEnabled(true);
193  orientationError_->setName("Eo");
194  orientationError_->setRange(-180.0, 180.0);
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));
198  orientationError_->addTerm(new fl::Trapezoid("FR", -40.0, -30.0, -15.0, -10.0));
199  orientationError_->addTerm(new fl::Trapezoid("FA", -15.0, -5.0, 5.0, 15.0));
200  orientationError_->addTerm(new fl::Trapezoid("FL", 5.0, 15.0, 25.0, 35.0));
201  orientationError_->addTerm(new fl::Trapezoid("SL", 25.0, 35.0, 120.0, 130.0));
202  orientationError_->addTerm(new fl::Trapezoid("RL", 120.0, 130.0, 165.0, 175.0));
203  orientationError_->addTerm(new fl::Trapezoid("RBL", 165.0, 175.0, 180.0, 180.0));
204  engine_->addInputVariable(orientationError_);
205 
206  // position error input variable initialization
207  positionError_ = new fl::InputVariable;
208  positionError_->setEnabled(true);
209  positionError_->setName("Ep");
210  positionError_->setRange(0.0, std::numeric_limits<double>::infinity());
211  positionError_->addTerm(new fl::Trapezoid("CLOSE", 0.0, 0.0, goalDistThreshold_, 2 * goalDistThreshold_));
212  positionError_->addTerm(new fl::Ramp("FAR", goalDistThreshold_, 2 * goalDistThreshold_));
213  engine_->addInputVariable(positionError_);
214 
215  // lateral deviation error input variable initialization
216  lateralDeviationError_ = new fl::InputVariable;
217  lateralDeviationError_->setEnabled(true);
218  lateralDeviationError_->setName("Ey");
219  lateralDeviationError_->setRange(
220  -std::numeric_limits<double>::infinity(),
221  std::numeric_limits<double>::infinity());
222  lateralDeviationError_->addTerm(new fl::Ramp("BN", -latDevTolerance_, -3*latDevTolerance_));
223  lateralDeviationError_->addTerm(new fl::Triangle("SN", -2*latDevTolerance_, 0.0));
224  lateralDeviationError_->addTerm(new fl::Triangle("Z", -latDevTolerance_, latDevTolerance_));
225  lateralDeviationError_->addTerm(new fl::Triangle("SP", 0.0, 2*latDevTolerance_));
226  lateralDeviationError_->addTerm(new fl::Ramp("BP", latDevTolerance_, 3*latDevTolerance_));
227  engine_->addInputVariable(lateralDeviationError_);
228 
229  //========================= OUTPUT VARIABLES ===============================
230 
231  // front steering angle output variable initialization
232  frontSteeringAngle_ = new fl::OutputVariable;
233  frontSteeringAngle_->setEnabled(true);
234  frontSteeringAngle_->setName("FSA");
235  frontSteeringAngle_->setRange(-rad2deg(maxSteeringAngle_), rad2deg(maxSteeringAngle_));
236  frontSteeringAngle_->fuzzyOutput()->setAccumulation(fl::null);
237  frontSteeringAngle_->setDefuzzifier(new fl::WeightedAverage("TakagiSugeno"));
238  frontSteeringAngle_->setDefaultValue(0.0);
239  frontSteeringAngle_->setLockPreviousOutputValue(true);
240  frontSteeringAngle_->setLockOutputValueInRange(false);
241  frontSteeringAngle_->addTerm(new fl::Constant("RH", -rad2deg(maxSteeringAngle_)));
242  frontSteeringAngle_->addTerm(new fl::Constant("RL", -rad2deg(maxSteeringAngle_) / 2));
243  frontSteeringAngle_->addTerm(new fl::Constant("Z", 0.0));
244  frontSteeringAngle_->addTerm(new fl::Constant("LL", rad2deg(maxSteeringAngle_) / 2));
245  frontSteeringAngle_->addTerm(new fl::Constant("LH", rad2deg(maxSteeringAngle_)));
246  engine_->addOutputVariable(frontSteeringAngle_);
247 
248  // rear steering angle output variable initialization
249  rearSteeringDeviationAngle_ = new fl::OutputVariable;
250  rearSteeringDeviationAngle_->setEnabled(true);
251  rearSteeringDeviationAngle_->setName("RSDA");
252  rearSteeringDeviationAngle_->setRange(-rad2deg(maxSteeringAngle_), rad2deg(maxSteeringAngle_));
253  rearSteeringDeviationAngle_->fuzzyOutput()->setAccumulation(fl::null);
254  rearSteeringDeviationAngle_->setDefuzzifier(new fl::WeightedAverage("TakagiSugeno"));
255  rearSteeringDeviationAngle_->setDefaultValue(fl::null);
256  rearSteeringDeviationAngle_->setLockPreviousOutputValue(true);
257  rearSteeringDeviationAngle_->setLockOutputValueInRange(false);
258  rearSteeringDeviationAngle_->addTerm(new fl::Constant("RH", -rad2deg(maxSteeringAngle_)));
259  rearSteeringDeviationAngle_->addTerm(new fl::Constant("RL", -rad2deg(maxSteeringAngle_) / 2));
260  rearSteeringDeviationAngle_->addTerm(new fl::Constant("Z", 0.0));
261  rearSteeringDeviationAngle_->addTerm(new fl::Constant("LL", rad2deg(maxSteeringAngle_) / 2));
262  rearSteeringDeviationAngle_->addTerm(new fl::Constant("LH", rad2deg(maxSteeringAngle_)));
263  engine_->addOutputVariable(rearSteeringDeviationAngle_);
264 
265  // speed output variable initialization
266  speed_ = new fl::OutputVariable;
267  speed_->setEnabled(true);
268  speed_->setName("Speed");
269  speed_->setDefaultValue(0.0);
270  speed_->setRange(0.0, maxSpeed_);
271  speed_->fuzzyOutput()->setAccumulation(fl::null);
272  speed_->setDefuzzifier(new fl::WeightedAverage("TakagiSugeno"));
273  speed_->addTerm(new fl::Constant("SLOW", maxSpeed_ / 2));
274  speed_->addTerm(new fl::Constant("FAST", maxSpeed_));
275  engine_->addOutputVariable(speed_);
276 
277 
278  //=============================== RULES ====================================
279 
280  // rule block initialization
281  ruleBlock_ = new fl::RuleBlock;
282 
283  // front steering rules
284  BOOST_FOREACH(std::string rule, frontSteeringRules_)
285  ruleBlock_->addRule(fl::Rule::parse(rule, engine_));
286 
287  // rear steering rules
288  BOOST_FOREACH(std::string rule, rearSteeringDeviationRules_)
289  ruleBlock_->addRule(fl::Rule::parse(rule, engine_));
290 
291  // speed rules
292  BOOST_FOREACH(std::string rule, speedRules_)
293  ruleBlock_->addRule(fl::Rule::parse(rule, engine_));
294 
295  engine_->addRuleBlock(ruleBlock_);
296  engine_->configure(
297  "Minimum", "Maximum", "Minimum", "Maximum", "WeightedAverage");
298 
299  std::string status;
300  if (!engine_->isReady(&status))
301  throw fl::Exception("Engine not ready. "
302  "The following errors were encountered:\n" + status, FL_AT);
303  }
304 
305 
307  const std::vector<geometry_msgs::PoseStamped>& path,
308  geometry_msgs::Twist& cmd)
309  {
310  if (path.empty())
311  {
312  ROS_ERROR("Plan given to path tracking controller is empty!");
313  return false;
314  }
315 
316  unsigned int subGoalIdx = findSubGoal(path);
317 
318  double ea = calcAngularDeviationError(path, subGoalIdx);
319  double eo = calcOrientationError(path, subGoalIdx);
320  double ep = calcPositionError(path, subGoalIdx);
321  double ey = calcLateralDeviationError(path, subGoalIdx);
322  int drcn = (rad2deg(fabs(ea)) < 120) ? 1 : -1;
323 
324  ROS_INFO_COND(displayControllerIO_, "Ea: %f, Eo: %f, Ep: %f, Ey: %f",
325  rad2deg(ea), rad2deg(eo), ep, ey);
326 
327  if (isGoalReached(path))
328  {
329  cmd = *new geometry_msgs::Twist; // return cleared twist
330  return true;
331  }
332 
333  angularDeviationError_->setInputValue(rad2deg(ea));
334  orientationError_->setInputValue(rad2deg(eo));
335  positionError_->setInputValue(ep);
336  lateralDeviationError_->setInputValue(ey);
337  direction_->setInputValue(drcn);
338 
339  engine_->process();
340 
341  double vel = drcn * speed_->getOutputValue(); // linear velocity
342  double fsa = deg2rad(frontSteeringAngle_->getOutputValue()); // front steering angle
343 
344  double rsa; // rear steering angle
345 
346  switch(rearSteeringMode_)
347  {
348  case none:
349  rsa = 0.0;
350  break;
351  case counter:
352  rsa = -fsa;
353  break;
354  case crab:
355  rsa = deg2rad(rearSteeringDeviationAngle_->getOutputValue());
356  break;
357  case hybrid:
358  rsa = -fsa + deg2rad(rearSteeringDeviationAngle_->getOutputValue());
359  break;
360  default:
361  ROS_FATAL("Invalid Steering Mode. Exiting...");
362  exit(EXIT_FAILURE);
363  }
364 
365  // clamp rsa in case -fsa+rsda exceeds limits
366  rsa = std::min(maxSteeringAngle_, std::max(-maxSteeringAngle_, rsa));
367 
368  double beta = atan((tan(fsa) + tan(rsa)) / 2); // angle between vel.x and vel.y
369 
370  // create command
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_;
374 
375  ROS_INFO_COND(displayControllerIO_,
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));
378 
379  if (isnan(cmd.linear.x) or isnan(cmd.linear.y))
380  {
381  ROS_ERROR("Speed=Nan. Something went wrong!");
382  cmd.linear.x = 0.0;
383  cmd.linear.y = 0.0;
384  return false;
385  }
386  if (isnan(cmd.angular.z))
387  {
388  ROS_ERROR("RotVel=Nan. Something went wrong!");
389  cmd.angular.z = 0.0;
390  return false;
391  }
392 
393  if (stop_)
394  {
395  cmd.linear.x = 0.0;
396  cmd.linear.y = 0.0;
397  cmd.angular.z = 0.0;
398  }
399 
400  return true;
401  }
402 
403 
405  const std::vector<geometry_msgs::PoseStamped>& path)
406  {
407  bool positionReached =
408  calcPositionError(path, path.size()-1) < xyGoalTolerance_;
409  bool orientationReached =
410  fabs(calcOrientationError(path, path.size()-1)) < yawGoalTolerance_;
411  return positionReached && orientationReached;
412  }
413 
414 
416  const std::vector<geometry_msgs::PoseStamped>& path,
417  unsigned int subGoalIdx)
418  {
419  return atan2(path[subGoalIdx].pose.position.y,
420  path[subGoalIdx].pose.position.x);
421  }
422 
423 
425  const std::vector<geometry_msgs::PoseStamped>& path,
426  unsigned int subGoalIdx)
427  {
428  return tf::getYaw(path[subGoalIdx].pose.orientation);
429  }
430 
431 
433  const std::vector<geometry_msgs::PoseStamped>& path,
434  unsigned int subGoalIdx)
435  {
436  return hypot(path[subGoalIdx].pose.position.x, path[subGoalIdx].pose.position.y);
437  }
438 
439 
441  const std::vector<geometry_msgs::PoseStamped>& path,
442  unsigned int subGoalIdx)
443  {
444  return calcPositionError(path, subGoalIdx)
445  * sin(calcAngularDeviationError(path, subGoalIdx));
446  }
447 
448 
450  const std::vector<geometry_msgs::PoseStamped>& path,
451  unsigned int idx1, unsigned int idx2)
452  {
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);
459  }
460 
461 
462  unsigned int FuzzyPTC::findSubGoal(
463  const std::vector<geometry_msgs::PoseStamped>& path)
464  {
465  unsigned int subGoalIdx = 0;
466  double distance = 0;
467 
468  while (subGoalIdx < path.size()-1 && distance < updateSubGoalDistThreshold_)
469  {
470  distance += calcDistance(path, subGoalIdx, subGoalIdx+1);
471  subGoalIdx++;
472 
473  if (isCuspPoint(path, subGoalIdx)
474  && calcPositionError(path, subGoalIdx) > xyGoalTolerance_)
475  {
476  break;
477  }
478  }
479 
480  subGoal_.header = path.front().header;
481  subGoal_.pose = path[subGoalIdx].pose;
482  subGoalPub_.publish(subGoal_);
483 
484  return subGoalIdx;
485  }
486 
487 
489  const std::vector<geometry_msgs::PoseStamped>& path,
490  unsigned int idx)
491  {
492  if (idx < 1 || idx >= path.size() - 2)
493  return false;
494 
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;
500 
501  double angle = acos((a.x * b.x + a.y * b.y) / hypot(a.x, a.y)
502  / hypot(b.x, b.y));
503 
504  return !isnan(angle) && (fabs(angle) < 1.0);// && (fabs(angle) > 0.085);
505  }
506 
507 }
fl::OutputVariable * frontSteeringAngle_
steering angle output variable 1
Definition: fuzzy_ptc.h:235
fl::InputVariable * direction_
direction (forwards/backwards) input variable
Definition: fuzzy_ptc.h:225
unsigned int findSubGoal(const std::vector< geometry_msgs::PoseStamped > &path)
Finds the current sub goal to follow.
Definition: fuzzy_ptc.cpp:462
fl::RuleBlock * ruleBlock_
flc rule block
Definition: fuzzy_ptc.h:242
fl::InputVariable * lateralDeviationError_
lateral deviation error
Definition: fuzzy_ptc.h:233
ros::Publisher subGoalPub_
publisher of the current sub goal marker
Definition: fuzzy_ptc.h:191
double maxSteeringAngle_
the max steering angle of the virtual middle wheel
Definition: fuzzy_ptc.h:201
double calcAngularDeviationError(const std::vector< geometry_msgs::PoseStamped > &path, unsigned int subGoalIdx)
Calculates angular deviation from subgoal.
Definition: fuzzy_ptc.cpp:415
double calcPositionError(const std::vector< geometry_msgs::PoseStamped > &path, unsigned int subGoalIdx)
Calculates the distance between the robot and the sub goal.
Definition: fuzzy_ptc.cpp:432
double calcOrientationError(const std::vector< geometry_msgs::PoseStamped > &path, unsigned int subGoalIdx)
Calculates the orientation error between the robot and the sub goal.
Definition: fuzzy_ptc.cpp:424
visualization_msgs::Marker subGoal_
sub goal visualization marker
Definition: fuzzy_ptc.h:193
void reconfigure(RSBandPlannerConfig &config)
Reconfigures controller params.
Definition: fuzzy_ptc.cpp:131
fl::OutputVariable * speed_
speed output variable
Definition: fuzzy_ptc.h:239
double yawGoalTolerance_
yaw goal tolerance
Definition: fuzzy_ptc.h:207
fl::InputVariable * positionError_
robot to goal distance error input variable
Definition: fuzzy_ptc.h:231
std::vector< std::string > frontSteeringRules_
front steering rules
Definition: fuzzy_ptc.h:247
std::vector< std::string > rearSteeringDeviationRules_
rear steering deviation rules
Definition: fuzzy_ptc.h:249
bool initialized_
variable indicating whether the controller has been initialized
Definition: fuzzy_ptc.h:188
FuzzyPTC(std::string name)
Definition: fuzzy_ptc.cpp:62
double calcLateralDeviationError(const std::vector< geometry_msgs::PoseStamped > &path, unsigned int subGoalIdx)
Calculates the lateral deviation from the sub goal.
Definition: fuzzy_ptc.cpp:440
double calcDistance(const std::vector< geometry_msgs::PoseStamped > &path, unsigned int idx1, unsigned int idx2)
Calculates the distance between two path waypoints.
Definition: fuzzy_ptc.cpp:449
ros::NodeHandle * pnh_
private ros node handle
Definition: fuzzy_ptc.h:185
fl::InputVariable * angularDeviationError_
robot to goal direction orientation error input variable
Definition: fuzzy_ptc.h:227
void initialize()
Initializes controller.
Definition: fuzzy_ptc.cpp:77
fl::InputVariable * orientationError_
robot to final goal orientation error input variable
Definition: fuzzy_ptc.h:229
double updateSubGoalDistThreshold_
subGoal step
Definition: fuzzy_ptc.h:213
fl::OutputVariable * rearSteeringDeviationAngle_
rear steering deviation angle output variable
Definition: fuzzy_ptc.h:237
double goalDistThreshold_
distance to goal threshold
Definition: fuzzy_ptc.h:209
RearSteeringMode rearSteeringMode_
rear wheel steering mode (none/counter/crab/hybrid)
Definition: fuzzy_ptc.h:196
double xyGoalTolerance_
xy goal tolerance threshold
Definition: fuzzy_ptc.h:205
RearSteeringMode
rear steering mode enum
Definition: fuzzy_ptc.h:99
void initializeFuzzyEngine()
Initializes fuzzy engine.
Definition: fuzzy_ptc.cpp:151
bool isCuspPoint(const std::vector< geometry_msgs::PoseStamped > &path, unsigned int idx)
Checks whether a path waypoint is a cusp point.
Definition: fuzzy_ptc.cpp:488
bool isGoalReached(const std::vector< geometry_msgs::PoseStamped > &path)
Checks if the goal position and orientation have been reached.
Definition: fuzzy_ptc.cpp:404
double maxSpeed_
max speed
Definition: fuzzy_ptc.h:203
bool stop_
if true controller returns zero velocity commands
Definition: fuzzy_ptc.h:217
bool computeVelocityCommands(const std::vector< geometry_msgs::PoseStamped > &path, geometry_msgs::Twist &cmd)
Computes velocity commands.
Definition: fuzzy_ptc.cpp:306
std::vector< std::string > speedRules_
speed rules
Definition: fuzzy_ptc.h:245
fl::Engine * engine_
position FLC engine
Definition: fuzzy_ptc.h:222
double wheelbase_
the robot wheelbase
Definition: fuzzy_ptc.h:199
double latDevTolerance_
lateral deviation tolerance
Definition: fuzzy_ptc.h:211
bool displayControllerIO_
display current trajectory information
Definition: fuzzy_ptc.h:215


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