AddEdgesAcceleration() | teb_local_planner::TebOptimalPlanner | protected |
AddEdgesDynamicObstacles(double weight_multiplier=1.0) | teb_local_planner::TebOptimalPlanner | protected |
AddEdgesKinematicsCarlike() | teb_local_planner::TebOptimalPlanner | protected |
AddEdgesKinematicsDiffDrive() | teb_local_planner::TebOptimalPlanner | protected |
AddEdgesObstacles(double weight_multiplier=1.0) | teb_local_planner::TebOptimalPlanner | protected |
AddEdgesObstaclesLegacy(double weight_multiplier=1.0) | teb_local_planner::TebOptimalPlanner | protected |
AddEdgesPreferRotDir() | teb_local_planner::TebOptimalPlanner | protected |
AddEdgesShortestPath() | teb_local_planner::TebOptimalPlanner | protected |
AddEdgesTimeOptimal() | teb_local_planner::TebOptimalPlanner | protected |
AddEdgesVelocity() | teb_local_planner::TebOptimalPlanner | protected |
AddEdgesViaPoints() | teb_local_planner::TebOptimalPlanner | protected |
AddTEBVertices() | teb_local_planner::TebOptimalPlanner | protected |
buildGraph(double weight_multiplier=1.0) | teb_local_planner::TebOptimalPlanner | protected |
cfg_ | teb_local_planner::TebOptimalPlanner | protected |
clearGraph() | teb_local_planner::TebOptimalPlanner | protected |
clearPlanner() | teb_local_planner::TebOptimalPlanner | inlinevirtual |
computeCurrentCost(double obst_cost_scale=1.0, double viapoint_cost_scale=1.0, bool alternative_time_cost=false) | teb_local_planner::TebOptimalPlanner | |
computeCurrentCost(std::vector< double > &cost, double obst_cost_scale=1.0, double viapoint_cost_scale=1.0, bool alternative_time_cost=false) | teb_local_planner::TebOptimalPlanner | inlinevirtual |
teb_local_planner::PlannerInterface::computeCurrentCost(std::vector< double > &cost, double obst_cost_scale=1.0, bool alternative_time_cost=false) | teb_local_planner::PlannerInterface | inlinevirtual |
cost_ | teb_local_planner::TebOptimalPlanner | protected |
extractVelocity(const PoseSE2 &pose1, const PoseSE2 &pose2, double dt, double &vx, double &vy, double &omega) const | teb_local_planner::TebOptimalPlanner | inline |
getCurrentCost() const | teb_local_planner::TebOptimalPlanner | inline |
getFullTrajectory(std::vector< TrajectoryPointMsg > &trajectory) const | teb_local_planner::TebOptimalPlanner | |
getObstVector() const | teb_local_planner::TebOptimalPlanner | inline |
getVelocityCommand(double &vx, double &vy, double &omega, int look_ahead_poses) const | teb_local_planner::TebOptimalPlanner | virtual |
getVelocityProfile(std::vector< geometry_msgs::Twist > &velocity_profile) const | teb_local_planner::TebOptimalPlanner | |
getViaPoints() const | teb_local_planner::TebOptimalPlanner | inline |
initialize(const TebConfig &cfg, ObstContainer *obstacles=NULL, RobotFootprintModelPtr robot_model=boost::make_shared< PointRobotFootprint >(), TebVisualizationPtr visual=TebVisualizationPtr(), const ViaPointContainer *via_points=NULL) | teb_local_planner::TebOptimalPlanner | |
initialized_ | teb_local_planner::TebOptimalPlanner | protected |
initOptimizer() | teb_local_planner::TebOptimalPlanner | protected |
isOptimized() const | teb_local_planner::TebOptimalPlanner | inline |
isTrajectoryFeasible(base_local_planner::CostmapModel *costmap_model, const std::vector< geometry_msgs::Point > &footprint_spec, double inscribed_radius=0.0, double circumscribed_radius=0.0, int look_ahead_idx=-1) | teb_local_planner::TebOptimalPlanner | virtual |
obstacles_ | teb_local_planner::TebOptimalPlanner | protected |
optimized_ | teb_local_planner::TebOptimalPlanner | protected |
optimizeGraph(int no_iterations, bool clear_after=true) | teb_local_planner::TebOptimalPlanner | protected |
optimizer() | teb_local_planner::TebOptimalPlanner | inline |
optimizer() const | teb_local_planner::TebOptimalPlanner | inline |
optimizer_ | teb_local_planner::TebOptimalPlanner | protected |
optimizeTEB(int iterations_innerloop, int iterations_outerloop, bool compute_cost_afterwards=false, double obst_cost_scale=1.0, double viapoint_cost_scale=1.0, bool alternative_time_cost=false) | teb_local_planner::TebOptimalPlanner | |
plan(const std::vector< geometry_msgs::PoseStamped > &initial_plan, const geometry_msgs::Twist *start_vel=NULL, bool free_goal_vel=false) | teb_local_planner::TebOptimalPlanner | virtual |
plan(const tf::Pose &start, const tf::Pose &goal, const geometry_msgs::Twist *start_vel=NULL, bool free_goal_vel=false) | teb_local_planner::TebOptimalPlanner | virtual |
plan(const PoseSE2 &start, const PoseSE2 &goal, const geometry_msgs::Twist *start_vel=NULL, bool free_goal_vel=false) | teb_local_planner::TebOptimalPlanner | virtual |
PlannerInterface() | teb_local_planner::PlannerInterface | inline |
prefer_rotdir_ | teb_local_planner::TebOptimalPlanner | protected |
registerG2OTypes() | teb_local_planner::TebOptimalPlanner | static |
robot_model_ | teb_local_planner::TebOptimalPlanner | protected |
setObstVector(ObstContainer *obst_vector) | teb_local_planner::TebOptimalPlanner | inline |
setPreferredTurningDir(RotType dir) | teb_local_planner::TebOptimalPlanner | inlinevirtual |
setVelocityGoal(const geometry_msgs::Twist &vel_goal) | teb_local_planner::TebOptimalPlanner | |
setVelocityGoalFree() | teb_local_planner::TebOptimalPlanner | inline |
setVelocityStart(const geometry_msgs::Twist &vel_start) | teb_local_planner::TebOptimalPlanner | |
setViaPoints(const ViaPointContainer *via_points) | teb_local_planner::TebOptimalPlanner | inline |
setVisualization(TebVisualizationPtr visualization) | teb_local_planner::TebOptimalPlanner | |
teb() | teb_local_planner::TebOptimalPlanner | inline |
teb() const | teb_local_planner::TebOptimalPlanner | inline |
teb_ | teb_local_planner::TebOptimalPlanner | protected |
TebOptimalPlanner() | teb_local_planner::TebOptimalPlanner | |
TebOptimalPlanner(const TebConfig &cfg, ObstContainer *obstacles=NULL, RobotFootprintModelPtr robot_model=boost::make_shared< PointRobotFootprint >(), TebVisualizationPtr visual=TebVisualizationPtr(), const ViaPointContainer *via_points=NULL) | teb_local_planner::TebOptimalPlanner | |
vel_goal_ | teb_local_planner::TebOptimalPlanner | protected |
vel_start_ | teb_local_planner::TebOptimalPlanner | protected |
via_points_ | teb_local_planner::TebOptimalPlanner | protected |
visualization_ | teb_local_planner::TebOptimalPlanner | protected |
visualize() | teb_local_planner::TebOptimalPlanner | virtual |
~PlannerInterface() | teb_local_planner::PlannerInterface | inlinevirtual |
~TebOptimalPlanner() | teb_local_planner::TebOptimalPlanner | virtual |