teb_local_planner::TebOptimalPlanner Member List

This is the complete list of members for teb_local_planner::TebOptimalPlanner, including all inherited members.

AddEdgesAcceleration()teb_local_planner::TebOptimalPlannerprotected
AddEdgesDynamicObstacles(double weight_multiplier=1.0)teb_local_planner::TebOptimalPlannerprotected
AddEdgesKinematicsCarlike()teb_local_planner::TebOptimalPlannerprotected
AddEdgesKinematicsDiffDrive()teb_local_planner::TebOptimalPlannerprotected
AddEdgesObstacles(double weight_multiplier=1.0)teb_local_planner::TebOptimalPlannerprotected
AddEdgesObstaclesLegacy(double weight_multiplier=1.0)teb_local_planner::TebOptimalPlannerprotected
AddEdgesPreferRotDir()teb_local_planner::TebOptimalPlannerprotected
AddEdgesShortestPath()teb_local_planner::TebOptimalPlannerprotected
AddEdgesTimeOptimal()teb_local_planner::TebOptimalPlannerprotected
AddEdgesVelocity()teb_local_planner::TebOptimalPlannerprotected
AddEdgesViaPoints()teb_local_planner::TebOptimalPlannerprotected
AddTEBVertices()teb_local_planner::TebOptimalPlannerprotected
buildGraph(double weight_multiplier=1.0)teb_local_planner::TebOptimalPlannerprotected
cfg_teb_local_planner::TebOptimalPlannerprotected
clearGraph()teb_local_planner::TebOptimalPlannerprotected
clearPlanner()teb_local_planner::TebOptimalPlannerinlinevirtual
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::TebOptimalPlannerinlinevirtual
teb_local_planner::PlannerInterface::computeCurrentCost(std::vector< double > &cost, double obst_cost_scale=1.0, bool alternative_time_cost=false)teb_local_planner::PlannerInterfaceinlinevirtual
cost_teb_local_planner::TebOptimalPlannerprotected
extractVelocity(const PoseSE2 &pose1, const PoseSE2 &pose2, double dt, double &vx, double &vy, double &omega) const teb_local_planner::TebOptimalPlannerinline
getCurrentCost() const teb_local_planner::TebOptimalPlannerinline
getFullTrajectory(std::vector< TrajectoryPointMsg > &trajectory) const teb_local_planner::TebOptimalPlanner
getObstVector() const teb_local_planner::TebOptimalPlannerinline
getVelocityCommand(double &vx, double &vy, double &omega, int look_ahead_poses) const teb_local_planner::TebOptimalPlannervirtual
getVelocityProfile(std::vector< geometry_msgs::Twist > &velocity_profile) const teb_local_planner::TebOptimalPlanner
getViaPoints() const teb_local_planner::TebOptimalPlannerinline
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::TebOptimalPlannerprotected
initOptimizer()teb_local_planner::TebOptimalPlannerprotected
isOptimized() const teb_local_planner::TebOptimalPlannerinline
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::TebOptimalPlannervirtual
obstacles_teb_local_planner::TebOptimalPlannerprotected
optimized_teb_local_planner::TebOptimalPlannerprotected
optimizeGraph(int no_iterations, bool clear_after=true)teb_local_planner::TebOptimalPlannerprotected
optimizer()teb_local_planner::TebOptimalPlannerinline
optimizer() const teb_local_planner::TebOptimalPlannerinline
optimizer_teb_local_planner::TebOptimalPlannerprotected
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::TebOptimalPlannervirtual
plan(const tf::Pose &start, const tf::Pose &goal, const geometry_msgs::Twist *start_vel=NULL, bool free_goal_vel=false)teb_local_planner::TebOptimalPlannervirtual
plan(const PoseSE2 &start, const PoseSE2 &goal, const geometry_msgs::Twist *start_vel=NULL, bool free_goal_vel=false)teb_local_planner::TebOptimalPlannervirtual
PlannerInterface()teb_local_planner::PlannerInterfaceinline
prefer_rotdir_teb_local_planner::TebOptimalPlannerprotected
registerG2OTypes()teb_local_planner::TebOptimalPlannerstatic
robot_model_teb_local_planner::TebOptimalPlannerprotected
setObstVector(ObstContainer *obst_vector)teb_local_planner::TebOptimalPlannerinline
setPreferredTurningDir(RotType dir)teb_local_planner::TebOptimalPlannerinlinevirtual
setVelocityGoal(const geometry_msgs::Twist &vel_goal)teb_local_planner::TebOptimalPlanner
setVelocityGoalFree()teb_local_planner::TebOptimalPlannerinline
setVelocityStart(const geometry_msgs::Twist &vel_start)teb_local_planner::TebOptimalPlanner
setViaPoints(const ViaPointContainer *via_points)teb_local_planner::TebOptimalPlannerinline
setVisualization(TebVisualizationPtr visualization)teb_local_planner::TebOptimalPlanner
teb()teb_local_planner::TebOptimalPlannerinline
teb() const teb_local_planner::TebOptimalPlannerinline
teb_teb_local_planner::TebOptimalPlannerprotected
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::TebOptimalPlannerprotected
vel_start_teb_local_planner::TebOptimalPlannerprotected
via_points_teb_local_planner::TebOptimalPlannerprotected
visualization_teb_local_planner::TebOptimalPlannerprotected
visualize()teb_local_planner::TebOptimalPlannervirtual
~PlannerInterface()teb_local_planner::PlannerInterfaceinlinevirtual
~TebOptimalPlanner()teb_local_planner::TebOptimalPlannervirtual


teb_local_planner
Author(s): Christoph Rösmann
autogenerated on Wed Jun 3 2020 04:03:08