▼Nadore | |
►Nadore_if_carla | |
CAckermannCommand2Carla | |
CClock2Simtime | |
CControlCommand2Carla | |
CObjects2Adore | |
CVehicleState2Adore | |
►Napps | Abstraction of functional modules to define functionality decoupled from the middleware |
CAreaOfEffectProvider | |
CCheckpointController | A set of virtual traffic lights are switched according to test driver input. CheckpointController is provided with a list of coorindates. Virtual traffic lights are placed at these coordinates, initially with red-light phase active. If a clearance button is pressed by the test driver, the nearest checkpoint traffic light in the lane-following view is switched to green-light for a given amount of time |
►CCrosstrafficConstraintProvider | |
CConflict | |
CFeedbackController | |
CGapProvider | |
CIndicatorHintsProvider | A node to gather indicator hint data and provide it e.g. for laneview computation or tactical decisions |
CLaneFollowingBehavior | Decision making and maneuver planning, which realizes lane following only. Basically a wrapper for trajectory_planner_lf, with initial state selection and direct SetPointRequest output to controller |
CLaneViewProvider | A node which computes lanefollowing and lanechange geometry and provides the results to subsequent modules |
CLocalizationModel | Model for localization adds errors to true vehicle state |
►CMapProvider | Base class for middleware dependent implementations of the map provider module |
CConfig | |
CMissionController | Simple state machine for mission controlling |
CGoalAttainmentMonitor | A class, which monitors distance between vehicle and goal |
CCollisionMonitor | A class, which monitors for collisions between ego and other objects |
CMonitor0 | |
►CNavigation | |
CConfig | |
CObjectDetectionModel | |
COdometryModel | Model for odometry sensor integrates velocities as measured with errors |
►CPlainXMLExporter | |
CConnection | |
CConnectionStep | |
CEdge | |
CNode | |
CPlatoonViewProvider | |
CPlotConflicts | Plot module for handling prediction plots |
►CPlotEgo | Optimzed plotting application to plot map borders, vehicles and environment information and background image satellite footage |
Cinfo | |
CGapQueuePlotter | |
CPlotGaps | Plots markers for traffic gaps |
►CPlotLanes | Optimzed plotting application to plot map borders, vehicles and environment information and background image satellite footage |
Cinfo | |
CPlotPlanSwath | Plot module for plotting the planning result swaths |
CPlanningDetailsPlotter | Test bench implementation for minimum risk maneuver planner |
CPlotPredictions | Plot module for handling prediction plots |
CPlotPredictionsMinimal | Plot module for handling prediction plots |
CPlotRoadAnnotations | Optimzed plotting application to plot annotations like speed limits |
►CPlotSatImages | Optimzed plotting application to display satellite images in the background |
Cinfo | |
CPlotTraffic | Optimzed plotting application to plot other traffic |
CPlotTrafficLights | Optimzed plotting application to plot map borders, vehicles and environment information and background image satellite footage |
CPlotViews | Plotting application to plot the folling: lanefollowinggeometry, lanechangegeometry |
CPredictionFilter | |
CPredictionProvider | |
CSpeedLimitProvider | A node to gather speed limit data and provide it e.g. for laneview computation |
CTacticalPlanner | Decision making and maneuver planning |
CTestLCTrajectoryPlanner | Test implementation of a lane change trajectory planner |
CTestMRMPlanner | Test bench implementation for minimum risk maneuver planner |
CTestStraightLinePredictor | |
CTestTrajectoryPlanner | Test implementation of a lane following trajectory planner |
CTrajectoryPlannerALC | Decoupled trajectory planner, which uses TrajectoryPlannerBase to compute and provide a PlanningResult in the event of a PlanningRequest Computes a lane change trajectory using advanced lane change planner |
CTrajectoryPlannerBase | Base class for different trajectory planners: Handles communication w/ decision making module. Reads PlanningRequest and writes PlanningResult. Actual trajectory planning has to occur by overriding virtual computeTrajectory method |
CTrajectoryPlannerLC | Decoupled trajectory planner, which uses TrajectoryPlannerBase to compute and provide a PlanningResult in the event of a PlanningRequest Computes a lane change trajectory |
CTrajectoryPlannerLF | Decoupled trajectory planner, which uses TrajectoryPlannerBase to compute and provide a PlanningResult in the event of a PlanningRequest |
CTrajectoryPlannerLM | Decoupled trajectory planner, which uses TrajectoryPlannerBase to compute and provide a PlanningResult in the event of a PlanningRequest Computes a lane change trajectory |
CVehicleModel | Vehicle model which can be used in simulations |
►Nenv | |
►NBorderBased | |
NBorderType | |
NTYPEDEFS | |
CALanePositionedObject | Abstract class for Objects that are positioned by a connection to a certain lane |
CBaseline | A local, non-linear, smooth road coordinate system generated from a sequence of borders |
CBorder | The border struct contains data of the smallest |
CBorderObserver | |
CBorderAccumulationStrategy | This class defines how successors of a border should be chosen |
CBASFollowStraight | This class chooses the straightest successor of a border until an upper limit on distance is reached |
CBASFollowNavigation | This class chooses the successor with the lowest cost until an upper limit on distance is reached |
CBASNeighbor | This class choses the left/right neighbors of a border sequence |
CBorderAccumulator | This class collects a sequence of borders, according to chosen BorderAccumulationStrategy |
CBorderCostMap | |
CNode | |
CNodeHasher | |
CABorderGraphCost | |
CSimpleBorderGraphCost | |
CBorderGraphCostWithLaneChanges | |
►CBorderGraph | |
CExpansion | |
CBorderID | This struct identifies a Border by the coordinates of the starting and the end point |
CBorderIDHasher | Functor, which hashes a BorderID object -> std::unordered_set<BorderID,BorderIDHasher> amap(0); |
CBorderOverlap | |
CBorderOverlapSet | Set of BorderOverlap objects that are connected, e. g. to form a conflict zone |
►CBorderSequence | A class which augments a vector of Border* with some sampling features |
CLineIterator | |
Citpair | Pair of iterators to iterate from first iterator till second iterator is reached |
Cmy_equal | Custom equal test for iterators |
►CBorderSet | Efficiently store borders in boost R-tree |
Clongitudinal_iterator | Iterator, which walks along borders, while there is exactly one successor (forward) or predecessor (backward) |
Clongitudinal_iterator_creator | |
CBorderTrace | |
CConflictZone | |
CConflictArea | |
CConflictSet | |
CCoordinate | This struct represents 3-dimensional coordines |
CCoordinateHasher | Functor, which hashes a Coordinate object -> std::unordered_set<Coordinate,CoordinateHasher> amap(0); |
CIndependentLaneChangeGeometry | A class for computation of the geometric information required to perform lane changes. The class name contains the term "independent", as it computes its own smooth baseline function instead of using the smooth baseline function of the lane following geometry. Downside of the independence is an increase computational effort. Upside is an improved projection in cases where target lane steeply separates after the gate. In contrast to the "normal" lc-geometry, which uses a baseline in the center of the source lane, the independent smooth baseline is situated between source and target lane. There is still a minor dependence to the lane following geometry: To compute the lane change geometry, the borders collected by the lane following geometry have to be provided |
CLaneChangeBorders | Selects Borders from BorderSet required for LaneChangeView construction |
CLaneChangeDataProxy | Simple struct to hole data relevant to lane change geometry |
CLaneChangeGeometry | A class with a geometry description of a lane next to the current lane |
CDependentLane | |
CLaneChangeView | LaneChangeView provides traffic related information for an adjacent lane |
CLaneChangeViewProxy | Proxy class to access ALane interfaces from preprocessed lane geometry received as data object |
CCombinedLaneGeometry | |
CLaneFollowingBorders | Selects Borders from BorderSet required for LaneFollowingView construction |
CLaneFollowingGeometry | A class with a geometry description of the current lane |
CLaneFollowingView | LaneFollowingview provides traffic related information for the current lane |
CLaneFollowingViewProxy | Proxy class to access ALane interfaces from preprocessed lane geometry received as data object |
CLaneGeometryDataProxy | |
CLaneMatchingStrategy | |
CLMSNearest | |
CLMSContinuation | |
CLMSNavigation | |
CBorderPositioning | |
CLanePosition | This is a struct that contains a position defined by a BorderID and a progress on that border |
CLanePositionHasher | |
CLanePositionedObjectSet | This class represents a set of objects that are positioned by LanePosition |
CLocalRoadMap | |
CNavigationBorderObserver | |
CParkingSpot | This class definition is to represent parking spots |
►CParkingSpotSet | |
Citpair | |
Cmy_equal | |
CStopLine | This class provide information about stoplines |
CLocalRoadMapTest | |
NConnectionState | |
NMAP_AUX | |
►Ntest | |
CTestConnectionFeed | |
►Ntraffic | |
CEgoLaneTraffic | |
CMovingBoxWithCovariance | |
CParticipant | Struct for representing a participant in traffic |
CTrafficMap | |
CTrafficMapDummy | |
CTrafficQueueOnALane | |
CAFactory | Abstract factory for adore::env communication |
CEnvFactoryInstance | Utility class to simplify factory access |
CRoadAnnotation | |
CNavigationCost | Struct to organize navigation cost |
CVehicleMotionState9d | This struct holds the motion state of the vehicle in 9d |
CVehicleState10d | This struct holds the state of the vehicle in 10d |
CVehicleStateObservation | Class to observe the vehicle state |
CIndicatorHint | |
►CLocalBoxSet | |
CEqualFunctor | |
Citpair | |
CBorderTypeChangeProfile | |
CMapBorderManagement | Automatically manage local map and necessary updates based on vehicle position and last state of object |
CIndicatorHintManagement | Automatically manage indicator hints based on current vehicle position |
CMapParkingSpotManagement | Automatically manage parking spot based on current vehicle position and last state of object |
CSpeedLimitManagement | Automatically manage speed limit information based on current vehicle position |
CMapStopLineManagement | Manage new and outdated stop lines based on newly visible and no longer visible borders and the last state of the object |
CMapTCDManagement | Manage visible traffic control devices based on vehicle position and last state of the object |
CNavigationManagement | |
CPriorityRoute | PriorityRoute implicitly references a route between two coordinates. The coordinates should be chosen such that the route is unique |
CPrecedenceRule | The PrecedenceRule defines a precedence relationship between two routes. Vehicles on the low_ priority route have to yield, while vehicles on the high_ priority route may proceed |
►CPrecedenceSet | PrecedenceSet contains PrecedenceRules, indexed by the area they affect |
Citpair | |
Cmy_equal | Custom equal test for iterators |
CPrecedenceFilter | PrecedenceFilter filters precedence rules in the path of the vehicle, as determined by ALane |
CSpeedLimit | |
CVectorIdentifier | |
CNavigationGoalObserver | |
CProposition | A logical proposition, with a possible timeout for the information |
CPropositionSet0 | A data structure managing logical propositions of order 0 |
►CConnectionsOnLane | |
CMappedConnection | |
CConnectionStateEvent | |
CControlledConnection | |
►CControlledConnectionSet | |
CBoxGen | |
CComparator | |
CControlledConnectionSet4Ego | Specialization of ControlledConnectionSet: Filters connections in range of ego |
►CTCDSet | |
Citpair | |
Cmy_equal | |
CTCDTrafficLightSet | |
CTrafficControlDevice | |
CTrafficLightStatus | |
CTrafficLight | |
CSimTrafficLight | |
►CThreeLaneViewDecoupled | |
CLaneChangeViewProxy | |
CLaneProxy | |
CCooperativeUserPrediction | |
►CCooperativeUsersProcess | |
CCooperativeUser | Prediction plus CACC(Platoon) |
CDecoupledConflictPointView | |
CDecoupledTrafficPredictionView | |
CEmptyGap | Defines a gap for testing purposes, which never has lead or chase vehicles |
CGapData | |
CAGapRating | |
CGapRating_NearEgo | |
CLaneChangeGaps | |
COccupancyCylinderPrediction | |
COCPredictionStrategy | |
COCStraightLinePrediction | |
►COCRoadBasedPrediction | |
CSearchState | |
CRampPrediction | |
►Nfun | |
►Nlogic | |
CGD2ND | |
CND2PD | |
CND2GD | |
CPD2ND | |
CPD2GD | |
CDistanceStateMachine | |
CNORMAL_DISTANCE | NORMAL_DISTANCE is defined as an entry state of the state machine
|
CGAP_DISTANCE | |
CPLATOONING_DISTANCE | |
CNA2WF | |
CJ2NA | |
CJ2WF | |
CJ2IP | |
CWF2J | |
CWF2NA | |
CWF2IP | |
CIP2J | |
CIP2WF | |
CIP2NA | |
CIP2L | |
CL2WF | |
CL2NA | |
CPlatooningStateMachine | |
CWANT_TO_FORM | WANT_TO_FORM is defined as an entry state of the state machine
|
CNOT_ABLE | |
CJOINING | |
CIN_PLATOON | |
CLEAVING | |
CInitialStateSelector | Helps to select initial state for motion planning. Considers previous plan, current vehicle state, vehicle extended state |
CActivationStateObserver | |
CAFactory | |
CFunFactoryInstance | Utility class to simplify factory access |
CKinematicModel | Kinematic vehicle model |
CLinearTrackingController | |
CPlatoonController | |
CTerminalController | |
CVLB_OpenLoop | |
CGearSelectionCommand | |
CIndicatorDispatcher | Dispatches indicator command for maneuver, which is currently executed |
CIndicatorCommand | |
CplatoonLogic | |
CMissionData | |
CMotionCommand | |
CPlanarVehicleState10d | |
CPlatooningInformation | |
CSetPointRequestSwath | |
CZonotopeTube | |
CSetPoint | |
CSetPointRequest | |
CSetPointRequestDispatcher | Class helps to dispatch SetPointRequest to controller SetPointRequestDispatcher handles selection of initial state, coordinate conversion for odometry based tracking and dispatching of trajectories |
CAdvancedLaneChangePlanner | |
CANominalPlanner | |
CANominalConstraint | |
CANominalReference | |
CANominalPlannerInformation | |
CNominalPlannerInformationSet | |
CATrajectoryEvaluator | |
CCurvatureSpeedLimit | |
CCurvatureSpeedLimitSmooth | |
CCurvatureSpeedLimitPredict | |
CDontDriveBackwards | |
CLaneWidthSpeedLimitLFV | |
CStopAtBottleneckLFV | |
CBreakAtHorizon | |
CLateralAccelerationConstraint | |
CHeadingConstraint | |
CLFVSpeedLimit | |
CDistanceToLaneEndConstraint | |
CLateralAccelerationReference | |
CLateralJerkReference | |
CNominalReferenceSpeed | |
CFollowCenterlineReference | |
CLateralOffsetConstraintLF | |
CLongitudinalAccelerationConstraint | |
CFollowPrecedingVehicle | |
CFollowPrecedingVehicle_BreakingCurve | |
CLowerBoundSGapToPrecedingVehicle | |
CAdhereToNextLimitLine | |
CStopAtNextGoalPoint | |
CStopAtNextConflictPoint | |
CBasicLaneChangePlanner | |
CBasicLaneFollowingPlanner | |
CBasicMergePlanner | |
CBasicMRMPlanner | Plans minimum risk maneuvers on given lane. K number of control points for planning. P interpolation points per planning step |
CSPRInvariantCollisionFreedom | |
CSPRNonCoercive | |
CSPRTTCNominal | |
CSPRAverageProgressLoss | |
CSPRNavigationCostOnLane | |
CSPRNormalizedNavigationCost | |
CSPRLongitudinalAcceleration2Cost | |
CSPRLongitudinalJerk2Cost | |
CSPRLinearlyWeightedCost | |
CRestartEffort | |
CCancelLCMRMPlanner | Plans minimum risk maneuver to cancel lane change |
CContinueLCMRMPlanner | Plans minimum risk maneuver to cancel lane change |
CDecoupledLFLCPlanner | |
CEvaluatorNavCost | |
CEvaluatorWeightedSum | |
CInformationSetPostProcessing | |
CLateralOffsetConstraintLC | |
CLaneChangePhaseEstimator | |
CAdvancedLateralOffsetConstraintLC | |
CFollowPrecedingVehicleOnLaneToBeLeft_BrakingCurve | |
CLateralOffsetConstraintLM | |
CLaneChangeIntoGapReference | |
CCancelMergeReference | |
CContinueLCReference | |
CStdGapConstraintAndReference | |
CLateralPlanner | |
CMergeMRMPlanner | Plans minimum risk maneuver to cancel lane change |
CMRMPlanner | |
CPlanningRequest | |
CPlanningResult | |
CRoadCoordinates | |
►CRoadCoordinateConverter | |
CZeroDynamicsModel | |
CASPRConstraint | |
CASPRCost | |
CTerminalRequest | |
CTurnSignalObserver | |
CUserInputObserver | |
CVehicleBaseMeasurement | |
CVehicleExtendedState | |
CVehicleMotionState9d | |
CVehicleMotionStateBuffer | Buffers and interpolates vehicle positions |
CNavigationGoal | |
►Nif_r2s | |
CR2S2BorderBasedConverter | Input: 2 files, reference lines and borders output: border file |
CReferenceLine | Basic storage struct for ReferenceLine from file |
CLaneBorder | Basic storage struct for lane borders from file |
►CSection | Directed borders, ordered from center line to outer border |
CFunctionMap | Storage class to access different functions by their domain intervals |
CR2SFileReader | |
►Nif_ROS | |
►Nparams | |
CPCheckpoints | |
CPCooperation | |
CPEmergencyOperation | |
CPFunctionManagement | |
CPLaneChangeView | |
CPLaneFollowingView | |
CPLateralPlanner | |
CPLocalRoadMap | |
CPLocalizationModel | |
CPLongitudinalPlanner | |
CPMapProvider | |
CPMissionControl | |
CPNavigation | |
CPOdometryModel | |
CPPrediction | |
CPSensorModel | |
CPTacticalPlanner | |
CPTrafficLightSim | |
CPTrajectoryGeneration | |
CPTrajectoryTracking | |
CPVehicle | |
CAreaOfEffectConverter | |
CBorderConverter | |
CBorderTypeChangeProfileConverter | |
CClockTimeConverter | |
CCooperativeUsersPredictionConverter | |
CVehicleMotionStateConverter | |
CMotionStateReader | |
CMotionStateFeed | |
CVehicleExtendedStateReader | |
CVehicleExtendedStateWriter | |
CMotionStateWriter | |
CGapConverter | |
CGearSelectionCommandConverter | |
CIndicatorCommandWriter | |
CIndicatorCommandReader | |
CIndicatorHintConverter | |
CLaneGeometryConverter | |
CMissionDataReader | |
CMissionDataWriter | |
CMotionCommandWriter | |
CMotionCommandReader | |
CNavigationDataConverter | |
CNavigationGoalConverter | |
COccupancyConverter | |
CPlanningRequestConverter | |
CPlanningResultConverter | |
CPlatooningInformationConverter | |
CPrecedenceRuleConverter | |
CPropositionConverter | |
CQuaternionConverter | |
CSetPointRequestConverter | |
CSimVehicleDimensionsConverter | |
CSimVehicleResetConverter | |
CSpeedLimitConverter | |
CStdConverter | |
CTCDConnectionConverter | |
CTerminalRequestConverter | |
CTrafficLightSimWriter | |
CTrafficLightSimReader | |
CTrafficParticipantConverter | |
CTPSetConverter | |
CTPSetMultiReader | TPSetMultiReader reads two ros topics and combines data from both |
CTPSimulationConverter | |
CTPDetectionConverter | |
CTPMessageConverter | |
CTrafficSimulationFeed | |
CVehicleBaseMeasurementWriter | |
CENV_Factory | |
CFactoryCollection | |
CFUN_Factory | |
CPARAMS_Factory | |
CFeed | |
CFeedWithCallback | |
CReader | |
CWriter | |
CROSParam | |
CSIM_Factory | |
CCheckpointControllerNode | |
CCrosstrafficProvider | |
CFeedbackControllerNode | |
CGapProviderNode | |
CIndicatorHintsProviderNode | |
CLaneFollowingBehaviorNode | |
CLocalizationModelNode | |
CLVProviderNode | |
CMapProviderNode | |
CMissionControllerNode | |
CObjectDetectionModelNode | |
COdometryModelNode | |
CPredictionFilterNode | |
CPredictionProviderNode | |
CPVProviderNode | |
CSpeedLimitProviderNode | |
CTacticalPlannerNode | |
CTrajectoryPlannerALCNode | |
CTrajectoryPlannerLCNode | |
CTrajectoryPlannerLFNode | |
CTrajectoryPlannerLMNode | |
CVehicleModelNode | |
CAreaOfEffectProviderNode | |
CPlotConflictsNode | |
CPlotEgoNode | |
CThisNode | |
CPlotLanesNode | |
CPlotPlanSwathNode | |
CPlotPlanningDetailsNode | |
CPlotPredictionsMinimalNode | |
CPlotPredictionsNode | |
CPlotRoadAnnotationsNode | |
CPlotSatImagesNode | |
CPlotTrafficNode | |
CPlotTrafficLightsNode | |
CPlotViewsNode | |
CTestLCTrajectoryPlannerNode | |
CTestStraightLinePredictionNode | |
CDENMGenerator | |
CPlotDENMNode | |
Cdenm_to_bordertypechangeprofile | |
CDENM2Checkpoint | |
Cmcm_to_platoon | |
Cmcm_to_prediction | |
Csetpointrequest_to_mcm | |
CSREMGenerator | |
CV2XTrafficLights | |
►Nif_xodr | |
CBorderIDTranslation | BorderIDTranslation is a set of translation tables, which keeps track of road ids, junction ids and their geometric representation as borders |
►CXODR2BorderBasedConverter | OpenDRIVE converter from file to object sets |
CXODR_Signal | Internal signal representation for conversion |
►Nmad | |
►NBoundingVolumes | |
COBB3d | |
COBBTree3d | |
CPlaneSequence3d | |
►NCsvReader | |
Ccsv_reader_facet | Helper construct to facilitate reading csv files |
Nfunop | |
CFunctionOutOfBoundsException | |
CFunctionNotImplemented | |
CFunctionNotInitialized | |
CFunctionIndexingError | |
CFunctionUnboundedException | |
CALFunction | |
CAScalarToN | |
CLConstFun | |
CLLinearFunction | |
CFunctionCombination_Addition | |
CFunctionCombination_Multiplication | |
CFunctionCombination_Multiplication_Matrix | |
CFunctionCombination_MultiplicationConst | |
CFunctionCombination_Chain | |
CFunctionCombination_Stack | |
CFunctionCombination_StackScalar | |
CFunctionModification_ReciprocalScalar | |
CAOdeModel | |
CAOdeModelWithOutput | |
CAOdeSolver | |
CArrayMatrixTools | |
CAFeed | |
CAFeedWithCallback | |
CAReader | |
CAWriter | |
CALocalObserver | Observer pattern to manage feed data in a storage class |
CCoordinateConversion | |
►CCubicPiecewiseFunction | |
CLocalCoordination | |
CPieceweisePolynomial | |
CCubicPiecewiseFunctionStatic | |
CPartialCurvatureDerivative2d | |
CCurvature2d | |
CGlobalPosition | |
CLHeading | |
CIntegratorChain | |
Cinterval | |
►CLinearConstraintSet | |
CLine | |
CLLinearPiecewiseFunctionS | |
►CLLinearPiecewiseFunctionM | |
COneDimension | |
►CLLinearPiecewiseFunctionA | |
COneDimension | |
CLPiecewiseFunction | |
CLPolynomialS | |
►CLPolynomialM | |
COneDimension | |
CLQ_OC_single_shooting | |
►CLSpiralFunction | |
Cdiffspiral | |
COccupancyCylinder | |
COccupancyCylinderBoundingFunctor | |
►COccupancyCylinderTree | |
CEarliestOverlapFunctor | |
CTimeEncroachmentFunctor | |
CXYIntrusionFunctor | |
COdeRK4 | |
►CRotationFunction | |
CRotationFunctionPD | |
►CVectorBasedVolumeTree | |
CSearchPosition | |
CSearchState | |
CZonotope | |
►Nparams | This namespace contains functionality related to providing parameters to configure runtime behaviour |
CAFactory | Abstract factory for adore::params classes |
CParamsFactoryInstance | Utility class to simplify factory access |
CAPCheckpoints | Abstract class containing parameters for checkpoint handling |
CAPCooperation | Abstract class containing cooperative behaviour parameters |
CAPEmergencyOperation | Abstract class containing parameters concerning emergency operation behaviour |
CAPEmergencyOperationDummy | Dummy implementation for testing purposes |
CAPFunctionManagement | Abstract class containing parameters for function management configuration |
CAPLaneChangeView | Abstract class containing parameters for a lane change view |
CAPLaneChangeViewDummy | Dummy implementation for testing purposes |
CAPLaneFollowingView | Abstract class containing parameters for a lane following view |
CAPLaneFollowingViewDummy | Dummy implementation for testing purposes |
CAPLateralPlanner | Abstract class containing parameters related to configuring the lateral planner |
CAPLateralPlannerDummy | Dummy implementation for testing purposes |
CAPLocalRoadMap | Abstract class to configure the local view of the road map |
CAPLocalRoadMapDummy | Dummy implementation for testing purposes |
CAPLocalizationModel | Abstract class containing parameters which configure localization state estimation model |
CAPLongitudinalPlanner | Abstract class containing parameters related to configuring the longitudinal planner |
CAPLongitudinalPlannerDummy | Dummy implementation for testing purposes |
CAPMapProvider | Abstract class containing parameters to configure aspects of the map provider |
CAPMapProviderDummy | Dummy implementation for testing purposes |
CAPMissionControl | Abstract class containing parameters for mission controller configuration |
CAPMRMPlanner | Abstract class containing parameters related to configuring the lateral planner |
CAPNavigation | Abstract class containing parameters which configure navigation behaviour |
CAPOdometryModel | Abstract class containing parameters which configure odometry state estimation model |
CAPPrediction | Parameter interface for parameters related to prediction |
CAPSensorModel | Abstract class for vehicle sensor model parameters |
CAPTacticalPlanner | Abstract classs containing parameters to configure aspects and constraints of the tactical planner |
CAPTrafficLightSim | Abstract class containing parameters to configure aspects of the map provider |
CAPTrafficLightSimDummy | Dummy implementation for testing purposes |
CAPTrajectoryGeneration | Abstract class containing parameters to configure the behaviour of trajectory generation |
CAPTrajectoryGenerationDummy | Dummy implementation for testing purposes |
CAPTrajectoryTracking | Abstract class containing parameters to configure the behaviour of the trajactory tracking controller |
CAPTrajectoryTrackingDummy | Dummy implementation for testing purposes |
CAPVehicle | Abstract class for vehicle configuration related paremeters |
CAPVehicleDummy | Dummy implementation of an abstract vehicle parameter object for testing purposes |
CDummyFactory | Dummy implementation of the adore::params::afactory for testing purposes |
►NPLOT | |
CGeoTiles | Class to help with handling of tile servers used for satellite image background tiles |
CGeoTilesConfig | |
CLanePlotConfig | |
►CPredictionConfig | |
►Cprediction_config | |
Ccolor_range | |
CViewPlotterConfig | |
►Nsim | This namespace contains functionality related to running simulations |
CAction | |
CAFactory | Abstract factory for adore::sim communication |
CSimFactoryInstance | Utility class to simplify factory access |
CResetVehicleDimensions | Encapsulation of values needed to reset the vehicle dimensions in a simulation |
CResetVehiclePose | Encapsulation of values needed to reset the vehicle pose in a simulation |
CResetVehicleTwist | Encapsulation of values needed to reset the vehicle twist (vx,vy and omega) in a simulation |
►Nsumo_if_ros | |
CCoordinate | |
►CSumoTLs2Ros | |
Chash_pair | |
CTimer | |
CROSVehicleSet | |
CSUMOTrafficToROS | |
CMAPEMIntersection | |
►CMAPEMLane | |
CConnectingLane | |
►Nview | |
CConflictPoint | |
CAConflictPointSet | |
CAGap | Defines a gap in traffic, into which a merge may be planned |
CALane | |
CALaneChangeView | |
CALimitLineEnRoute | |
CANavigationGoalView | |
CAThreeLaneView | |
CATrafficPredictionView | |
CConflictZone | |
CConflictArea | |
CConflictSet | |
CLimitLine | |
CTrafficObject | |
Nadore_ci_terminator_node | |
Nadore_if_ros | |
▼Nadore_if_ros_scheduling | |
CBaseapp | |
CClockTimeConversion | |
CSchedulerNotificationConversion | |
CSchedulerNotificationManager | |
CScheduler | Scheduler is a class which provides functionality for stepped simulation |
▼Nadore_scheduling | |
CASchedulerNotificationManager | |
CSchedulerNotification | |
Nadore_set_goal | |
Nadore_set_pose | |
▼Nadore_suppress_lanechanges | |
Cusb_config | |
CPublisher | |
Cros_wrapper | |
▼Nadore_v2x_sim | |
CChannel | |
CChannelToStation | |
CStation | |
▼NDLR_TS | |
►NPlotLab | |
NPLCom | |
CAFigureStub | |
CDummyFigure | |
CFigureStubFactory | |
CFigureStubZMQ | |
CPLComView | |
CPLComPaint | |
CPLComOther | |
CTwoFloatsPacked | |
▼Nplotlab2navigationgoal | |
CObserver | |
▼Ntest_usb_keyboard | |
Cusb_config | |
Cros_wrapper | |
▼Ntest_vectorsize | |
Clistener | |