| AbstractController() | mbf_abstract_core::AbstractController | protected |
| BaseLocalPlanner() | nav_core::BaseLocalPlanner | protected |
| cancel() | teb_local_planner::TebLocalPlannerROS | inlinevirtual |
| cfg_ | teb_local_planner::TebLocalPlannerROS | private |
| computeVelocityCommands(geometry_msgs::Twist &cmd_vel) | teb_local_planner::TebLocalPlannerROS | virtual |
| computeVelocityCommands(const geometry_msgs::PoseStamped &pose, const geometry_msgs::TwistStamped &velocity, geometry_msgs::TwistStamped &cmd_vel, std::string &message) | teb_local_planner::TebLocalPlannerROS | virtual |
| configureBackupModes(std::vector< geometry_msgs::PoseStamped > &transformed_plan, int &goal_idx) | teb_local_planner::TebLocalPlannerROS | protected |
| convertTransRotVelToSteeringAngle(double v, double omega, double wheelbase, double min_turning_radius=0) const | teb_local_planner::TebLocalPlannerROS | protected |
| costmap_ | teb_local_planner::TebLocalPlannerROS | private |
| costmap_converter_ | teb_local_planner::TebLocalPlannerROS | private |
| costmap_converter_loader_ | teb_local_planner::TebLocalPlannerROS | private |
| costmap_model_ | teb_local_planner::TebLocalPlannerROS | private |
| costmap_ros_ | teb_local_planner::TebLocalPlannerROS | private |
| CostmapController() | mbf_costmap_core::CostmapController | protected |
| custom_obst_mutex_ | teb_local_planner::TebLocalPlannerROS | private |
| custom_obst_sub_ | teb_local_planner::TebLocalPlannerROS | private |
| custom_obstacle_msg_ | teb_local_planner::TebLocalPlannerROS | private |
| custom_via_points_active_ | teb_local_planner::TebLocalPlannerROS | private |
| customObstacleCB(const costmap_converter::ObstacleArrayMsg::ConstPtr &obst_msg) | teb_local_planner::TebLocalPlannerROS | protected |
| customViaPointsCB(const nav_msgs::Path::ConstPtr &via_points_msg) | teb_local_planner::TebLocalPlannerROS | protected |
| dynamic_recfg_ | teb_local_planner::TebLocalPlannerROS | private |
| estimateLocalGoalOrientation(const std::vector< geometry_msgs::PoseStamped > &global_plan, const geometry_msgs::PoseStamped &local_goal, int current_goal_idx, const geometry_msgs::TransformStamped &tf_plan_to_global, int moving_average_length=3) const | teb_local_planner::TebLocalPlannerROS | protected |
| failure_detector_ | teb_local_planner::TebLocalPlannerROS | private |
| footprint_spec_ | teb_local_planner::TebLocalPlannerROS | private |
| getNumberFromXMLRPC(XmlRpc::XmlRpcValue &value, const std::string &full_param_name) | teb_local_planner::TebLocalPlannerROS | static |
| getRobotFootprintFromParamServer(const ros::NodeHandle &nh, const TebConfig &config) | teb_local_planner::TebLocalPlannerROS | static |
| global_frame_ | teb_local_planner::TebLocalPlannerROS | private |
| global_plan_ | teb_local_planner::TebLocalPlannerROS | private |
| goal_reached_ | teb_local_planner::TebLocalPlannerROS | private |
| initialize(std::string name, tf2_ros::Buffer *tf, costmap_2d::Costmap2DROS *costmap_ros) | teb_local_planner::TebLocalPlannerROS | virtual |
| mbf_costmap_core::CostmapController::initialize(std::string name, ::TF *tf, costmap_2d::Costmap2DROS *costmap_ros)=0 | mbf_costmap_core::CostmapController | pure virtual |
| initialized_ | teb_local_planner::TebLocalPlannerROS | private |
| isGoalReached() | teb_local_planner::TebLocalPlannerROS | virtual |
| isGoalReached(double xy_tolerance, double yaw_tolerance) | teb_local_planner::TebLocalPlannerROS | inlinevirtual |
| last_cmd_ | teb_local_planner::TebLocalPlannerROS | private |
| last_preferred_rotdir_ | teb_local_planner::TebLocalPlannerROS | private |
| makeFootprintFromXMLRPC(XmlRpc::XmlRpcValue &footprint_xmlrpc, const std::string &full_param_name) | teb_local_planner::TebLocalPlannerROS | static |
| name_ | teb_local_planner::TebLocalPlannerROS | private |
| no_infeasible_plans_ | teb_local_planner::TebLocalPlannerROS | private |
| obstacles_ | teb_local_planner::TebLocalPlannerROS | private |
| odom_helper_ | teb_local_planner::TebLocalPlannerROS | private |
| planner_ | teb_local_planner::TebLocalPlannerROS | private |
| pruneGlobalPlan(const tf2_ros::Buffer &tf, const geometry_msgs::PoseStamped &global_pose, std::vector< geometry_msgs::PoseStamped > &global_plan, double dist_behind_robot=1) | teb_local_planner::TebLocalPlannerROS | protected |
| Ptr typedef | mbf_costmap_core::CostmapController | |
| reconfigureCB(TebLocalPlannerReconfigureConfig &config, uint32_t level) | teb_local_planner::TebLocalPlannerROS | protected |
| robot_base_frame_ | teb_local_planner::TebLocalPlannerROS | private |
| robot_circumscribed_radius | teb_local_planner::TebLocalPlannerROS | private |
| robot_goal_ | teb_local_planner::TebLocalPlannerROS | private |
| robot_inscribed_radius_ | teb_local_planner::TebLocalPlannerROS | private |
| robot_pose_ | teb_local_planner::TebLocalPlannerROS | private |
| robot_vel_ | teb_local_planner::TebLocalPlannerROS | private |
| saturateVelocity(double &vx, double &vy, double &omega, double max_vel_x, double max_vel_y, double max_vel_trans, double max_vel_theta, double max_vel_x_backwards) const | teb_local_planner::TebLocalPlannerROS | protected |
| setPlan(const std::vector< geometry_msgs::PoseStamped > &orig_global_plan) | teb_local_planner::TebLocalPlannerROS | virtual |
| TebLocalPlannerROS() | teb_local_planner::TebLocalPlannerROS | |
| tf_ | teb_local_planner::TebLocalPlannerROS | private |
| tfPoseToEigenVector2dTransRot(const tf::Pose &tf_vel) | teb_local_planner::TebLocalPlannerROS | static |
| time_last_infeasible_plan_ | teb_local_planner::TebLocalPlannerROS | private |
| time_last_oscillation_ | teb_local_planner::TebLocalPlannerROS | private |
| transformGlobalPlan(const tf2_ros::Buffer &tf, const std::vector< geometry_msgs::PoseStamped > &global_plan, const geometry_msgs::PoseStamped &global_pose, const costmap_2d::Costmap2D &costmap, const std::string &global_frame, double max_plan_length, std::vector< geometry_msgs::PoseStamped > &transformed_plan, int *current_goal_idx=NULL, geometry_msgs::TransformStamped *tf_plan_to_global=NULL) const | teb_local_planner::TebLocalPlannerROS | protected |
| updateObstacleContainerWithCostmap() | teb_local_planner::TebLocalPlannerROS | protected |
| updateObstacleContainerWithCostmapConverter() | teb_local_planner::TebLocalPlannerROS | protected |
| updateObstacleContainerWithCustomObstacles() | teb_local_planner::TebLocalPlannerROS | protected |
| updateViaPointsContainer(const std::vector< geometry_msgs::PoseStamped > &transformed_plan, double min_separation) | teb_local_planner::TebLocalPlannerROS | protected |
| validateFootprints(double opt_inscribed_radius, double costmap_inscribed_radius, double min_obst_dist) | teb_local_planner::TebLocalPlannerROS | protected |
| via_point_mutex_ | teb_local_planner::TebLocalPlannerROS | private |
| via_points_ | teb_local_planner::TebLocalPlannerROS | private |
| via_points_sub_ | teb_local_planner::TebLocalPlannerROS | private |
| visualization_ | teb_local_planner::TebLocalPlannerROS | private |
| ~AbstractController() | mbf_abstract_core::AbstractController | virtual |
| ~BaseLocalPlanner() | nav_core::BaseLocalPlanner | virtual |
| ~CostmapController() | mbf_costmap_core::CostmapController | virtual |
| ~TebLocalPlannerROS() | teb_local_planner::TebLocalPlannerROS | |