Class Hierarchy

Go to the graphical class hierarchy

This inheritance list is sorted roughly, but not completely, alphabetically:
[detail level 123]
 CBaseBinaryEdge
 Cteb_local_planner::BaseTebBinaryEdge< 1, double, VertexPose, VertexPose >
 Cteb_local_planner::EdgePreferRotDirEdge defining the cost function for penalzing a specified turning direction, in particular left resp. right turns
 Cteb_local_planner::EdgeShortestPathEdge defining the cost function for minimizing the Euclidean distance between two consectuive poses
 Cteb_local_planner::BaseTebBinaryEdge< 2, double, VertexPose, VertexPose >
 Cteb_local_planner::EdgeKinematicsCarlikeEdge defining the cost function for satisfying the non-holonomic kinematics of a carlike mobile robot
 Cteb_local_planner::EdgeKinematicsDiffDriveEdge defining the cost function for satisfying the non-holonomic kinematics of a differential drive mobile robot
 Cteb_local_planner::BaseTebBinaryEdge< D, E, VertexXi, VertexXj >Base edge connecting two vertices in the TEB optimization problem
 Cnav_core::BaseLocalPlanner [external]
 Cteb_local_planner::TebLocalPlannerROSImplements the actual abstract navigation stack routines of the teb_local_planner plugin
 CBaseMultiEdge
 Cteb_local_planner::BaseTebMultiEdge< 2, const geometry_msgs::Twist * >
 Cteb_local_planner::EdgeAccelerationGoalEdge defining the cost function for limiting the translational and rotational acceleration at the end of the trajectory
 Cteb_local_planner::EdgeAccelerationStartEdge defining the cost function for limiting the translational and rotational acceleration at the beginning of the trajectory
 Cteb_local_planner::BaseTebMultiEdge< 2, double >
 Cteb_local_planner::EdgeAccelerationEdge defining the cost function for limiting the translational and rotational acceleration
 Cteb_local_planner::EdgeVelocityEdge defining the cost function for limiting the translational and rotational velocity
 Cteb_local_planner::BaseTebMultiEdge< 3, const geometry_msgs::Twist * >
 Cteb_local_planner::EdgeAccelerationHolonomicGoalEdge defining the cost function for limiting the translational and rotational acceleration at the end of the trajectory
 Cteb_local_planner::EdgeAccelerationHolonomicStartEdge defining the cost function for limiting the translational and rotational acceleration at the beginning of the trajectory
 Cteb_local_planner::BaseTebMultiEdge< 3, double >
 Cteb_local_planner::EdgeAccelerationHolonomicEdge defining the cost function for limiting the translational and rotational acceleration
 Cteb_local_planner::EdgeVelocityHolonomicEdge defining the cost function for limiting the translational and rotational velocity according to x,y and theta
 Cteb_local_planner::BaseTebMultiEdge< D, E >Base edge connecting two vertices in the TEB optimization problem
 Cteb_local_planner::BaseRobotFootprintModelAbstract class that defines the interface for robot footprint/contour models
 Cteb_local_planner::CircularRobotFootprintClass that defines the a robot of circular shape
 Cteb_local_planner::LineRobotFootprintClass that approximates the robot with line segment (zero-width)
 Cteb_local_planner::PointRobotFootprint
 Cteb_local_planner::PolygonRobotFootprintClass that approximates the robot with a closed polygon
 Cteb_local_planner::TwoCirclesRobotFootprintClass that approximates the robot with two shifted circles
 CBaseUnaryEdge
 Cteb_local_planner::BaseTebUnaryEdge< 1, const Eigen::Vector2d *, VertexPose >
 Cteb_local_planner::EdgeViaPointEdge defining the cost function for pushing a configuration towards a via point
 Cteb_local_planner::BaseTebUnaryEdge< 1, const Obstacle *, VertexPose >
 Cteb_local_planner::EdgeObstacleEdge defining the cost function for keeping a minimum distance from obstacles
 Cteb_local_planner::BaseTebUnaryEdge< 1, double, VertexTimeDiff >
 Cteb_local_planner::EdgeTimeOptimalEdge defining the cost function for minimizing transition time of the trajectory
 Cteb_local_planner::BaseTebUnaryEdge< 2, const Obstacle *, VertexPose >
 Cteb_local_planner::EdgeDynamicObstacleEdge defining the cost function for keeping a distance from dynamic (moving) obstacles
 Cteb_local_planner::EdgeInflatedObstacleEdge defining the cost function for keeping a minimum distance from inflated obstacles
 Cteb_local_planner::BaseTebUnaryEdge< D, E, VertexXi >Base edge connecting a single vertex in the TEB optimization problem
 CBaseVertex
 Cteb_local_planner::VertexPoseThis class stores and wraps a SE2 pose (position and orientation) into a vertex that can be optimized via g2o
 Cteb_local_planner::VertexTimeDiffThis class stores and wraps a time difference $ \Delta T $ into a vertex that can be optimized via g2o
 Cteb_local_planner::EquivalenceClassAbstract class that defines an interface for computing and comparing equivalence classes
 Cteb_local_planner::HSignatureThe H-signature defines an equivalence relation based on homology in terms of complex calculus
 Cteb_local_planner::HSignature3dThe H-signature in three dimensions (here: x-y-t) defines an equivalence relation based on homology using theorems from electro magnetism
 Cteb_local_planner::FailureDetectorThis class implements methods in order to detect if the robot got stucked or is oscillating
 Cteb_local_planner::TebConfig::GoalToleranceGoal tolerance related parameters
 Cteb_local_planner::GraphSearchInterfaceBase class for graph based path planning / homotopy class sampling
 Cteb_local_planner::lrKeyPointGraph
 Cteb_local_planner::ProbRoadmapGraph
 Cteb_local_planner::HcGraphVertexVertex in the graph that is used to find homotopy classes (only stores 2D positions)
 Cteb_local_planner::TebConfig::HomotopyClasses
 Cteb_local_planner::ObstacleAbstract class that defines the interface for modelling obstacles
 Cteb_local_planner::CircularObstacleImplements a 2D circular obstacle (point obstacle plus radius)
 Cteb_local_planner::LineObstacleImplements a 2D line obstacle
 Cteb_local_planner::PointObstacleImplements a 2D point obstacle
 Cteb_local_planner::PolygonObstacleImplements a polygon obstacle with an arbitrary number of vertices
 Cteb_local_planner::TebConfig::ObstaclesObstacle related parameters
 Cteb_local_planner::TebConfig::OptimizationOptimization related parameters
 Cteb_local_planner::PlannerInterfaceThis abstract class defines an interface for local planners
 Cteb_local_planner::HomotopyClassPlannerLocal 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)
 Cteb_local_planner::TebOptimalPlannerThis class optimizes an internal Timed Elastic Band trajectory using the g2o-framework
 CPointRobotShapeClass that defines a point-robot
 Cteb_local_planner::PoseSE2This class implements a pose in the domain SE2: $ \mathbb{R}^2 \times S^1 $ The pose consist of the position x and y and an orientation given as angle theta [-pi, pi]
 Cteb_local_planner::TebConfig::RecoveryRecovery/backup related parameters
 Cteb_local_planner::TebConfig::RobotRobot related parameters
 Cteb_local_planner::TebConfigConfig class for the teb_local_planner and its components
 Cteb_local_planner::TebVisualizationForward Declaration
 Cteb_local_planner::TimedElasticBandClass that defines a trajectory modeled as an elastic band with augmented tempoarl information
 Cteb_local_planner::TebConfig::TrajectoryTrajectory related parameters
 Cteb_local_planner::FailureDetector::VelMeasurement


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