teb_local_planner::BaseRobotFootprintModel | Abstract class that defines the interface for robot footprint/contour models |
teb_local_planner::CircularRobotFootprint | Class that defines the a robot of circular shape |
teb_local_planner::EdgeAcceleration | Edge defining the cost function for limiting the translational and rotational acceleration |
teb_local_planner::EdgeAccelerationGoal | Edge defining the cost function for limiting the translational and rotational acceleration at the end of the trajectory |
teb_local_planner::EdgeAccelerationStart | Edge defining the cost function for limiting the translational and rotational acceleration at the beginning of the trajectory |
teb_local_planner::EdgeDynamicObstacle | Edge defining the cost function for keeping a distance from dynamic (moving) obstacles |
teb_local_planner::EdgeInflatedObstacle | Edge defining the cost function for keeping a minimum distance from inflated obstacles |
teb_local_planner::EdgeKinematicsCarlike | Edge defining the cost function for satisfying the non-holonomic kinematics of a carlike mobile robot |
teb_local_planner::EdgeKinematicsDiffDrive | Edge defining the cost function for satisfying the non-holonomic kinematics of a differential drive mobile robot |
teb_local_planner::EdgeObstacle | Edge defining the cost function for keeping a minimum distance from obstacles |
teb_local_planner::EdgeTimeOptimal | Edge defining the cost function for minimizing transition time of the trajectory |
teb_local_planner::EdgeVelocity | Edge defining the cost function for limiting the translational and rotational velocity |
teb_local_planner::EdgeViaPoint | Edge defining the cost function for pushing a configuration towards a via point |
teb_local_planner::TebConfig::GoalTolerance | Goal tolerance related parameters |
teb_local_planner::HcGraphVertex | Vertex in the graph that is used to find homotopy classes (only stores 2D positions) |
teb_local_planner::TebConfig::HomotopyClasses | |
teb_local_planner::HomotopyClassPlanner | Local planner that explores alternative homotopy classes, create a plan for each alternative and finally return the robot controls for the current best path (repeated in each sampling interval) |
teb_local_planner::LineObstacle | Implements a 2D line obstacle |
teb_local_planner::LineRobotFootprint | Class that approximates the robot with line segment (zero-width) |
teb_local_planner::Obstacle | Abstract class that defines the interface for modelling obstacles |
teb_local_planner::TebConfig::Obstacles | Obstacle related parameters |
teb_local_planner::TebConfig::Optimization | Optimization related parameters |
teb_local_planner::PlannerInterface | This abstract class defines an interface for local planners |
teb_local_planner::PointObstacle | Implements a 2D point obstacle |
teb_local_planner::PointRobotFootprint | |
PointRobotShape | Class that defines a point-robot |
teb_local_planner::PolygonObstacle | Implements a polygon obstacle with an arbitrary number of vertices |
teb_local_planner::PolygonRobotFootprint | Class that approximates the robot with a closed polygon |
teb_local_planner::PoseSE2 | This class implements a pose in the domain SE2: The pose consist of the position x and y and an orientation given as angle theta [-pi, pi] |
teb_local_planner::TebConfig::Robot | Robot related parameters |
teb_local_planner::TebConfig | Config class for the teb_local_planner and its components |
teb_local_planner::TebLocalPlannerROS | Implements the actual abstract navigation stack routines of the teb_local_planner plugin |
teb_local_planner::TebOptimalPlanner | This class optimizes an internal Timed Elastic Band trajectory using the g2o-framework |
teb_local_planner::TebVisualization | Forward Declaration |
teb_local_planner::TimedElasticBand | Class that defines a trajectory modeled as an elastic band with augmented tempoarl information |
teb_local_planner::TebConfig::Trajectory | Trajectory related parameters |
teb_local_planner::TwoCirclesRobotFootprint | Class that approximates the robot with two shifted circles |
teb_local_planner::VertexPose | This class stores and wraps a SE2 pose (position and orientation) into a vertex that can be optimized via g2o |
teb_local_planner::VertexTimeDiff | This class stores and wraps a time difference into a vertex that can be optimized via g2o |