This is the complete list of members for teb_local_planner::PlannerInterface, including all inherited members.
clearPlanner()=0 | teb_local_planner::PlannerInterface | pure virtual |
computeCurrentCost(std::vector< double > &cost, double obst_cost_scale=1.0, bool alternative_time_cost=false) | teb_local_planner::PlannerInterface | inlinevirtual |
getVelocityCommand(double &vx, double &vy, double &omega, int look_ahead_poses) const =0 | teb_local_planner::PlannerInterface | pure virtual |
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)=0 | teb_local_planner::PlannerInterface | pure virtual |
plan(const std::vector< geometry_msgs::PoseStamped > &initial_plan, const geometry_msgs::Twist *start_vel=NULL, bool free_goal_vel=false)=0 | teb_local_planner::PlannerInterface | pure virtual |
plan(const tf::Pose &start, const tf::Pose &goal, const geometry_msgs::Twist *start_vel=NULL, bool free_goal_vel=false)=0 | teb_local_planner::PlannerInterface | pure virtual |
plan(const PoseSE2 &start, const PoseSE2 &goal, const geometry_msgs::Twist *start_vel=NULL, bool free_goal_vel=false)=0 | teb_local_planner::PlannerInterface | pure virtual |
PlannerInterface() | teb_local_planner::PlannerInterface | inline |
setPreferredTurningDir(RotType dir) | teb_local_planner::PlannerInterface | inlinevirtual |
visualize() | teb_local_planner::PlannerInterface | inlinevirtual |
~PlannerInterface() | teb_local_planner::PlannerInterface | inlinevirtual |