►Napproaching_emergency_vehicle_plugin | |
CApproachingEmergencyVehiclePlugin | Class that implements the Approaching Emergency Vehicle Plugin (ERV) strategic plugin. This class is primarily responsible for handling ROS topic subscriptions, publications, and service callbacks for processing incoming BSMs from ERV's, generating manuever plans that account for a nearby ERV, and publishing warning message(s) to an approaching ERV when the ego vehicle is in its path |
CApproachingEmergencyVehicleTransitionTable | Class defining the state transition table behavior for the ApproachingEmergencyVehiclePlugin |
CConfig | Stuct containing the algorithm configuration values for approaching_emergency_vehicle_plugin |
CErvInformation | Convenience struct for storing relevant data for an Emergency Response Vehicle (ERV) |
CUpcomingLaneChangeParameters | Convenience struct for storing the parameters of an upcoming lane change to ensure that the same parameters are used in separately generated maneuver plans |
►Napproximate_intersection | |
CConfig | Stuct containing the algorithm configuration values for approximate_intersection |
CLookupGrid | LookupGrid class implements a fast occupancy grid creation and intersection data structure. The user provides 2d min/max bounds on the grid as well as cell side length (cells are always square). The user can then add points into the grid. Cells which contain points are marked as occupied. Once the grid is populated, intersections can be checked against. If the queried point lands in an occupied cell the intersection is reported as true |
►Narbitrator | |
CArbitrator | |
CArbitratorNode | |
CArbitratorStateMachine | |
CArbitratorStateTransition | |
CBeamSearchStrategy | Implementation of SearchStrategy by usage of Beam Search |
CCapabilitiesInterface | Generic interface for interacting with Plugins via their capabilities instead of directly by their topics |
CConfig | Config struct |
CCostFunction | Generic interface representing a means of computing cost for plans in the search graph |
CCostSystemCostFunction | Implementation of the CostFunction interface |
CFixedPriorityCostFunction | Implementation of the CostFunction interface |
CNeighborGenerator | |
CPlanningStrategy | Generic interface representing a strategy for arriving at a maneuver plan |
CPluginNeighborGenerator | Implementation of the NeighborGenerator interface using plugins |
CSearchStrategy | Generic interface representing a computation to prioritize nodes for expansion in a search graph |
CTreePlanner | Implementation of PlanningStrategy using a generic tree search algorithm |
CVehicleState | Struct defining the vehicle state required for maneuver planning |
►Nbasic_autonomy | |
►Nsmoothing | |
CBSpline | Realization of SplineI that uses the Eigen::Splines library for interpolation |
CSplineI | Interface to a spline interpolator that can be used to smoothly interpolate between points |
►Nwaypoint_generation | |
CDetailedTrajConfig | |
CGeneralTrajConfig | |
CPointSpeedPair | |
►Nbounding_box_to_detected_object | |
CNode | |
►Nbsm_generator | |
CBSMGenerator | The class responsible for publishing BSM messages |
CBSMGeneratorWorker | The class containing the primary business logic for the BSM Generator Package |
CConfig | Stuct containing the algorithm configuration values for bsm_generator |
►Ncarma_cloud_client | |
CCarmaCloudClient | TODO for USER: Add class description |
CConfig | Stuct containing the algorithm configuration values for carma_cloud_client |
►Ncarma_cooperative_perception | |
CAccelerationSet4Way | |
CDDateTime | |
CDetectionListVizNode | |
CExternalObjectListToDetectionListNode | |
CExternalObjectListToSdsmNode | |
CHeading | |
CHostVehicleFilterNode | |
CMapCoordinate | |
CMeasurementTimeOffset | |
CMetricSe2 | Calculates distance between a point and detection in SE(2) (special Euclidean) space |
CMonth | |
CMotionModelMapping | |
CMultipleObjectTrackerNode | |
CPosition3D | |
CPositionOffsetXYZ | |
CSdsmToDetectionListNode | |
CSemanticDistance2dScore | Calculate 2D Euclidean distance between track and detection |
CSpeed | |
CTrackListToExternalObjectListNode | |
CUtmCoordinate | Represents a position using UTM coordinates |
CUtmDisplacement | Represent a displacement from a UTM coordinate |
CUtmZone | |
CWgs84Coordinate | Represents a position using WGS-84 coordinates |
►Ncarma_guidance_plugins | |
CControlPlugin | ControlPlugin base class which can be extended by user provided plugins which wish to implement the Control Plugin ROS API |
CPluginBaseNode | PluginBaseNode provides default functionality for all carma guidance plugins. This includes basic state machine management (largely delegated to ROS2 lifecycle behavior), required interfaces, and plugin discovery |
CStrategicPlugin | StrategicPlugin base class which can be extended by user provided plugins which wish to implement the Strategic Plugin ROS API. A strategic plugin is responsible for planning sequences of maneuvers to achieve high-level objects for the vehicle (follow the route, efficiently get through an intersection, etc.) |
CTacticalPlugin | TacticalPlugin base class which can be extended by user provided plugins which wish to implement the Tactical Plugin ROS API |
►Ncarma_wm | |
►Ncollision_detection | |
CMovingObject | |
►Ntest | |
CMapOptions | |
CCARMAWorldModel | Class which implements the WorldModel interface. In addition this class provides write access to the world model. Write access is achieved through setters for the Map and Route and getMutableMap(). NOTE: This class should NOT be used in runtime code by users and is exposed solely for use in unit tests where the WMListener class cannot be instantiated |
CIndexedDistanceMap | O(1) distance lookup structure for quickly accessing route distance information. NOTE: This structure is used internally in the world model and is not intended for use by WorldModel users |
CLANE_DIRECTION | |
CLaneletDowntrackPair | |
CSignalizedIntersectionManager | This class manages and keeps track of all signalized intersections in the map. All of the SPAT and MAP standard's lane ids to lanelet id mapping is recorded here. NOTE: This class functions do not update the map given |
CTrackPos | Position in a track based coordinate system where the axis are downtrack and crosstrack. Positive crosstrack is to the left of the reference line |
CTrafficControl | |
CWMListener | Class which provies automated subscription and threading support for the world model |
CWMListenerWorker | Backend logic class for WMListener |
CWorldModel | An interface which provides read access to the semantic map and route. This class is not thread safe. All units of distance are in meters |
►Ncarma_wm_ctrl | |
CConfig | Config struct |
CGeofence | An object representing a geofence use for communications with CARMA Cloud |
CGeofenceSchedule | |
CGeofenceScheduler | A GeofenceScheduler is responsable for notifying the user when a geofence is active or inactive according to its schedule |
CWMBroadcaster | Class which provies exposes map publication and carma_wm update logic |
CWMBroadcasterNode | Node which provies exposes map publication and carma_wm update logic |
CWorkZoneSection | |
►Ncooperative_lanechange | |
CConfig | Stuct containing the algorithm configuration values for cooperative_lanechange |
CCooperativeLaneChangePlugin | The class responsible for generating cooperative lanechange trajectories from received lane change maneuvers |
CLaneChangeManeuverOriginalValues | Convenience struct for storing the original start_dist and starting_lane_id associated with a received lane change maneuver |
►Nextract_rpy_from_quat | |
CConverter | |
►Nframe_transformer | |
CConfig | Stuct containing the algorithm configuration values for frame_transformer |
CNode | Node which subcribes to and input topic, transforms the data into a new frame and republishes it onto an output topic |
CTransformer | Class template for data transformers which use the tf2_ros::Buffer.transform() method to perform transforms on ros messages. The class sets up publishers and subscribers using the provided node for the specified message type. The specified message type must have a tf2_ros::Buffer.doTransform specialization for its type in order for it to compile |
CTransformerBase | Transformer base class provides default member variables for tf2 lookup and ros network access. The constructor is also private meaning it must be called by extending classes in an attempt to enforce a construction interface |
►Ngnss_to_map_convertor | |
CConfig | Stuct containing the algorithm configuration values for gnss_to_map_convertor |
CGNSSToMapConvertor | |
CNode | |
►Nguidance | |
CConfig | Stuct containing the algorithm configuration values for GuidanceWorker |
CGuidanceStateMachine | |
CGuidanceWorker | Worker class for the Guidance node |
►Ninlanecruising_plugin | |
►Nsmoothing | |
CBSpline | Realization of SplineI that uses the Eigen::Splines library for interpolation |
CSplineI | Interface to a spline interpolator that can be used to smoothly interpolate between points |
CInLaneCruisingPlugin | Class containing primary business logic for the In-Lane Cruising Plugin |
CInLaneCruisingPluginNode | ROS node for the InLaneCruisingPlugin |
►Nintersection_transit_maneuvering | |
CIntersectionTransitManeuveringNode | ROS node for the inlanecruising_plugin |
CServicer | |
►Nlci_strategic_plugin | |
CBoundaryDistances | |
►CLCIStrategicPlugin | |
CVehicleState | Struct representing a vehicle state for the purposes of planning |
CLCIStrategicPluginConfig | Struct to store the configuration settings for the LCIStrategicPlugin class |
CLCIStrategicStateTransitionTable | Class defining the state transition table behavior for the LCIStrategic Strategic Plugin |
CTrajectoryParams | |
►Nlight_controlled_intersection_tactical_plugin | |
CConfig | Stuct containing the algorithm configuration values for light_controlled_intersection_tactical_plugin |
CLightControlledIntersectionTacticalPlugin | Class containing primary business logic for the Light Controlled Intersection Tactical Plugin |
CLightControlledIntersectionTransitPluginNode | ROS node for the LightControlledIntersectionTransitPluginNode |
CTrajectoryParams | |
►Nlightbar_manager | |
CConfig | Config struct |
CINDICATOR_NOT_MAPPED | |
CINVALID_LIGHTBAR_MANAGER_PRIORITY | |
CLIGHTBAR_MANAGER_ERROR | |
CLightBarManager | |
CLightBarManagerStateMachine | |
CLightBarManagerWorker | |
►Nlocalization_manager | |
CLocalizationManager | Primary logic class for the localization manager node |
CLocalizationManagerConfig | Struct to store the configuration settings for the LocalizationManager class |
CLocalizationTransitionTable | Class defining the state transition table behavior for the LocalizationManager |
CNode | Core execution node for this package |
►Nmobilitypath_publisher | |
CConfig | Stuct containing the algorithm configuration values for mobilitypath_publisher |
CMobilityPathPublication | The class responsible for publishing MobilityPath messages based on the latest trajectory plan |
►Nmobilitypath_visualizer | |
CConfig | Stuct containing the algorithm configuration values for <package_name> |
CMarkerColor | |
CMobilityPathVisualizer | |
►Nmock_controller_driver | |
CMockControllerDriver | Responsible for replicating behavior of control driver |
►Nmotion_computation | |
CConfig | Stuct containing the algorithm configuration values for motion_computation |
CMotionComputationNode | The class responsible for publishing external object predictions |
CMotionComputationWorker | The class containing the primary business logic for the Motion Computation Package |
►Nmotion_prediction_visualizer | |
CNode | |
►Nobject | |
CObjectDetectionTrackingNode | |
CObjectDetectionTrackingWorker | |
►Nobject_visualizer | |
CConfig | Stuct containing the algorithm configuration values for object_visualizer |
CNode | This node provides RViz visualization messages for recieved ExternalObject and RoadwayObstacle messages in carma-platform |
►Nplan_delegator | |
CConfig | Config struct |
CLaneChangeInformation | Convenience struct for storing information regarding a lane change maneuver |
CPlanDelegator | |
►Nplatooning_control | |
CPIDController | This class includes logic for PID controller. PID controller is used in this plugin to maintain the inter-vehicle gap by adjusting the speed |
CPlatooningControlPlugin | This class includes node-level logic for Platooning Control such as its publishers, subscribers, and their callback functions. Platooning Control is used for generating control commands to maintain the gap in platoon as well as generating longitudinal and lateral control commands to follow the trajectory |
CPlatooningControlPluginConfig | Stuct containing the algorithm configuration values for the PlatooningControlPlugin |
CPlatooningControlWorker | This is the worker class for platoon controller. It is responsible for generating and smoothing the speed and steering control commands from trajectory points |
CPlatoonLeaderInfo | Platoon Leader Struct |
►Nplatooning_strategic_ihp | |
CActionPlan | Struct for an action plan, which describes a transient joining activity |
CNode | ROS Node to for Platooning Strategic Plugin IHP2 variant. It includes all the service clients, publishers and subscribers |
CPlatooningManager | Class containing the logic for platoon manager. It is responsible for keeping track of the platoon members and role of the host vehicle in the platoon |
CPlatooningPluginConfig | Stuct containing the algorithm configuration values for the yield_pluginConfig |
CPlatooningStrategicIHPPlugin | Class containing the logic for Strategic IHP Plugin. This class is responsible for all the negotiations as well as generating a maneuver msg |
CPlatoonMember | Platoon member info |
►Nplatooning_tactical_plugin | |
CNode | ROS node for the PlatooningTacticalPlugin to initialize and configure parameters and publishers/subscribers |
CPlatooningTacticalPlugin | Class containing primary business logic for the Platooning Tactical Plugin for trajectory generation |
CPointSpeedPair | Convenience class for pairing 2d points with speeds |
►Npoints_map_filter | |
CConfig | Stuct containing the algorithm configuration values for points_map_filter |
CNode | TODO for USER: Add class description |
►Nport_drayage_plugin | |
CConfig | Struct containing the algorithm configuration values for port_drayage_plugin |
CLatLonCoordinate | Convenience struct for storing the vehicle's current latitude/longitude coordinates |
COperationID | Helper class containing an enum for valid port drayage MobilityOperation message operation IDs and a function that converts each operation enum value to a human-readable string |
CPortDrayageMobilityOperationMsg | Convenience struct for storing all data contained in a received MobilityOperation message's strategy_params field with strategy "carma/port_drayage" |
CPortDrayagePlugin | |
CPortDrayageStateMachine | |
CPortDrayageWorker | |
►Nprocess_traj_logs | |
CDataSource | |
►Npure_pursuit_wrapper | |
CPurePursuitWrapperConfig | Struct containing the algorithm configuration values for the PurePursuitWrapperConfig |
CPurePursuitWrapperNode | |
►Nroadway_objects | |
CRoadwayObjectsNode | The class responsible for converting detected objects into objects that are mapped onto specific lanelets |
►Nroute | |
CConfig | Struct containing the algorithm configuration values for the route node |
CRoute | The route package provides the following functionality: |
CRouteGeneratorWorker | |
CRouteStateWorker | |
►Nroute_following_plugin | |
CConfig | Struct containing config values values for route_following_plugin |
CRouteFollowingPlugin | |
►Nsci_strategic_plugin | |
►CSCIStrategicPlugin | |
CVehicleState | Struct representing a vehicle state for the purposes of planning |
CSCIStrategicPluginConfig | Struct to store the configuration settings for the WzStrategicPlugin class |
►Nstop_and_dwell_strategic_plugin | |
CStopAndDwellStrategicPlugin | |
CStopAndDwellStrategicPluginConfig | Struct to store the configuration settings for the WzStrategicPlugin class |
CVehicleState | Struct representing a vehicle state for the purposes of planning |
►Nstop_and_wait_plugin | |
CPointSpeedPair | Convenience class for pairing 2d points with speeds |
CStopandWait | |
CStopandWaitNode | |
►Nstop_controlled_intersection_tactical_plugin | |
CStopControlledIntersectionTacticalPlugin | Class containing primary business logic for the Stop Controlled Intersection Tactical Plugin |
CStopControlledIntersectionTacticalPluginConfig | Stuct containing the algorithm configuration values for the StopControlledIntersectionTacticalPlugin |
►NSUB | |
CConfig | Stuct containing the algorithm configuration values for <package_name> |
CNode | TODO for USER: Add class description |
►Nsubsystem_controllers | |
CBaseSubsystemController | A base class for all subsystem_controllers which provides default lifecycle behavior for subsystems |
CBaseSubSystemControllerConfig | Stuct containing the algorithm configuration values for the BaseSubsystemController |
CDriversControllerConfig | Stuct containing the algorithm configuration values for the GuidanceController |
CDriversControllerNode | |
CEntry | An entry represents a driver details for the purposes of tracking |
CEntryManager | An entry manager keeps track of the set of entries and makes it easy to add or remove entries |
CEnvironmentPerceptionControllerNode | |
CGuidanceControllerConfig | Stuct containing the algorithm configuration values for the GuidanceController |
CGuidanceControllerNode | |
CLocalizationControllerConfig | Stuct containing the algorithm configuration values for the BaseSubsystemController |
CLocalizationControllerNode | |
CPluginManager | The PluginManager serves as a component to manage CARMA Guidance Plugins via their ros2 lifecycle interfaces |
CSSCDriverManager | The SSCDriverManager serves as a component to manage ROS1 SSC Driver in CARMA which is primarily in ROS2 |
CV2XControllerNode | |
CVectorHash | |
►Nsystem_controller | |
CSystemControllerNode | |
►Ntraffic_incident_parser | |
CTrafficIncidentParserNode | The class responsible for processing incoming MobilityOperation messages with strategy "carma3/Incident_Use_Case" |
CTrafficIncidentParserWorker | |
►Ntrajectory_executor | |
CConfig | Struct containing the algorithm configuration values for trajectory_executor |
CTrajectoryExecutor | |
►Ntrajectory_follower_wrapper | |
CTrajectoryFollowerWrapperConfig | Stuct containing the algorithm configuration values for trajectory_follower_wrapper |
CTrajectoryFollowerWrapperNode | |
►Ntrajectory_visualizer | |
CConfig | Max_speed values for trajectory_visualizer |
CTrajectoryVisualizer | |
►Nyield_plugin | |
CGetCollisionResult | Convenience class for saving collision results |
CPointSpeedPair | Convenience class for pairing 2d points with speeds |
CYieldPlugin | Class containing primary business logic for the In-Lane Cruising Plugin |
CYieldPluginNode | ROS node for the YieldPlugin |
CCallInterface | |
CGNSSToMapConvertor | Logic class for the GNSSToMapNode which handles the conversion of gnss data to the map frame |
CInLaneCruisingPluginConfig | Stuct containing the algorithm configuration values for the InLaneCruisingPlugin |
CLightBarManager | The class responsible for managing light bar status based on the guidance status |
CMapUpdateLogger | |
CPlatooningTacticalPluginConfig | Stuct containing the algorithm configuration values for the PlatooningTacticalPlugin |
CRoutingGraphAccessor | This class serves as a method of exposing the internal protected members of the lanelet2 RoutingGraph. This allows for a conversion method to be written which converts the routing graph to a ROS message representation |
CStopandWaitConfig | Stuct containing the algorithm configuration values for the stop_and_wait_plugin |
CSystemControllerConfig | Stuct containing the algorithm configuration values for the SystemController |
CYieldPluginConfig | Stuct containing the algorithm configuration values for the YieldPluginConfig |