▼Nteb_local_planner | |
CBaseRobotFootprintModel | Abstract class that defines the interface for robot footprint/contour models |
CBaseTebBinaryEdge | Base edge connecting two vertices in the TEB optimization problem |
CBaseTebMultiEdge | Base edge connecting two vertices in the TEB optimization problem |
CBaseTebUnaryEdge | Base edge connecting a single vertex in the TEB optimization problem |
CCircularObstacle | Implements a 2D circular obstacle (point obstacle plus radius) |
CCircularRobotFootprint | Class that defines the a robot of circular shape |
CEdgeAcceleration | Edge defining the cost function for limiting the translational and rotational acceleration |
CEdgeAccelerationGoal | Edge defining the cost function for limiting the translational and rotational acceleration at the end of the trajectory |
CEdgeAccelerationHolonomic | Edge defining the cost function for limiting the translational and rotational acceleration |
CEdgeAccelerationHolonomicGoal | Edge defining the cost function for limiting the translational and rotational acceleration at the end of the trajectory |
CEdgeAccelerationHolonomicStart | Edge defining the cost function for limiting the translational and rotational acceleration at the beginning of the trajectory |
CEdgeAccelerationStart | Edge defining the cost function for limiting the translational and rotational acceleration at the beginning of the trajectory |
CEdgeDynamicObstacle | Edge defining the cost function for keeping a distance from dynamic (moving) obstacles |
CEdgeInflatedObstacle | Edge defining the cost function for keeping a minimum distance from inflated obstacles |
CEdgeKinematicsCarlike | Edge defining the cost function for satisfying the non-holonomic kinematics of a carlike mobile robot |
CEdgeKinematicsDiffDrive | Edge defining the cost function for satisfying the non-holonomic kinematics of a differential drive mobile robot |
CEdgeObstacle | Edge defining the cost function for keeping a minimum distance from obstacles |
CEdgePreferRotDir | Edge defining the cost function for penalzing a specified turning direction, in particular left resp. right turns |
CEdgeTimeOptimal | Edge defining the cost function for minimizing transition time of the trajectory |
CEdgeVelocity | Edge defining the cost function for limiting the translational and rotational velocity |
CEdgeVelocityHolonomic | Edge defining the cost function for limiting the translational and rotational velocity according to x,y and theta |
CEdgeViaPoint | Edge defining the cost function for pushing a configuration towards a via point |
CEquivalenceClass | Abstract class that defines an interface for computing and comparing equivalence classes |
▼CFailureDetector | This class implements methods in order to detect if the robot got stucked or is oscillating |
CVelMeasurement | |
CGraphSearchInterface | Base class for graph based path planning / homotopy class sampling |
CHcGraphVertex | Vertex in the graph that is used to find homotopy classes (only stores 2D positions) |
CHomotopyClassPlanner | 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) |
CHSignature | The H-signature defines an equivalence relation based on homology in terms of complex calculus |
CHSignature3d | The H-signature in three dimensions (here: x-y-t) defines an equivalence relation based on homology using theorems from electro magnetism |
CLineObstacle | Implements a 2D line obstacle |
CLineRobotFootprint | Class that approximates the robot with line segment (zero-width) |
ClrKeyPointGraph | |
CObstacle | Abstract class that defines the interface for modelling obstacles |
CPlannerInterface | This abstract class defines an interface for local planners |
CPointObstacle | Implements a 2D point obstacle |
CPointRobotFootprint | |
CPolygonObstacle | Implements a polygon obstacle with an arbitrary number of vertices |
CPolygonRobotFootprint | Class that approximates the robot with a closed polygon |
CPoseSE2 | 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] |
CProbRoadmapGraph | |
▼CTebConfig | Config class for the teb_local_planner and its components |
CGoalTolerance | Goal tolerance related parameters |
CHomotopyClasses | |
CObstacles | Obstacle related parameters |
COptimization | Optimization related parameters |
CRecovery | Recovery/backup related parameters |
CRobot | Robot related parameters |
CTrajectory | Trajectory related parameters |
CTebLocalPlannerROS | Implements the actual abstract navigation stack routines of the teb_local_planner plugin |
CTebOptimalPlanner | This class optimizes an internal Timed Elastic Band trajectory using the g2o-framework |
CTebVisualization | Forward Declaration |
CTimedElasticBand | Class that defines a trajectory modeled as an elastic band with augmented tempoarl information |
CTwoCirclesRobotFootprint | Class that approximates the robot with two shifted circles |
CVertexPose | This class stores and wraps a SE2 pose (position and orientation) into a vertex that can be optimized via g2o |
CVertexTimeDiff | This class stores and wraps a time difference into a vertex that can be optimized via g2o |
CPointRobotShape | Class that defines a point-robot |