Carma-platform v4.2.0
CARMA Platform is built on robot operating system (ROS) and utilizes open source software (OSS) that enables Cooperative Driving Automation (CDA) features to allow Automated Driving Systems to interact and cooperate with infrastructure and other vehicles through communication.
|
Ccarma_cooperative_perception::AccelerationSet4Way | |
Cplatooning_strategic_ihp::ActionPlan | Struct for an action plan, which describes a transient joining activity |
Capproaching_emergency_vehicle_plugin::ApproachingEmergencyVehicleTransitionTable | Class defining the state transition table behavior for the ApproachingEmergencyVehiclePlugin |
Carbitrator::Arbitrator | |
Carbitrator::ArbitratorStateMachine | |
Carbitrator::ArbitratorStateTransition | |
Csubsystem_controllers::BaseSubSystemControllerConfig | Stuct containing the algorithm configuration values for the BaseSubsystemController |
Clci_strategic_plugin::BoundaryDistances | |
Cbsm_generator::BSMGeneratorWorker | The class containing the primary business logic for the BSM Generator Package |
►CCallInterface | |
Carbitrator::CapabilitiesInterface | Generic interface for interacting with Plugins via their capabilities instead of directly by their topics |
►Ccarma_ros2_utils::CarmaLifecycleNode | |
Capproaching_emergency_vehicle_plugin::Config | Stuct containing the algorithm configuration values for approaching_emergency_vehicle_plugin |
Capproximate_intersection::Config | Stuct containing the algorithm configuration values for approximate_intersection |
Carbitrator::Config | Config struct |
Cbsm_generator::Config | Stuct containing the algorithm configuration values for bsm_generator |
Ccarma_cloud_client::Config | Stuct containing the algorithm configuration values for carma_cloud_client |
Ccarma_wm_ctrl::Config | Config struct |
Ccooperative_lanechange::Config | Stuct containing the algorithm configuration values for cooperative_lanechange |
Cframe_transformer::Config | Stuct containing the algorithm configuration values for frame_transformer |
Cgnss_to_map_convertor::Config | Stuct containing the algorithm configuration values for gnss_to_map_convertor |
Cguidance::Config | Stuct containing the algorithm configuration values for GuidanceWorker |
Clight_controlled_intersection_tactical_plugin::Config | Stuct containing the algorithm configuration values for light_controlled_intersection_tactical_plugin |
Clightbar_manager::Config | Config struct |
Cmobilitypath_publisher::Config | Stuct containing the algorithm configuration values for mobilitypath_publisher |
Cmobilitypath_visualizer::Config | Stuct containing the algorithm configuration values for <package_name> |
Cmotion_computation::Config | Stuct containing the algorithm configuration values for motion_computation |
Cobject_visualizer::Config | Stuct containing the algorithm configuration values for object_visualizer |
Cplan_delegator::Config | Config struct |
Cpoints_map_filter::Config | Stuct containing the algorithm configuration values for points_map_filter |
Cport_drayage_plugin::Config | Struct containing the algorithm configuration values for port_drayage_plugin |
Croute::Config | Struct containing the algorithm configuration values for the route node |
Croute_following_plugin::Config | Struct containing config values values for route_following_plugin |
CSUB::Config | Stuct containing the algorithm configuration values for <package_name> |
Ctrajectory_executor::Config | Struct containing the algorithm configuration values for trajectory_executor |
Ctrajectory_visualizer::Config | Max_speed values for trajectory_visualizer |
Cextract_rpy_from_quat.Converter | |
►Carbitrator::CostFunction | Generic interface representing a means of computing cost for plans in the search graph |
Ccarma_cooperative_perception::DDateTime | |
Cbasic_autonomy::waypoint_generation::DetailedTrajConfig | |
Csubsystem_controllers::DriversControllerConfig | Stuct containing the algorithm configuration values for the GuidanceController |
Csubsystem_controllers::Entry | An entry represents a driver details for the purposes of tracking |
Csubsystem_controllers::EntryManager | An entry manager keeps track of the set of entries and makes it easy to add or remove entries |
Capproaching_emergency_vehicle_plugin::ErvInformation | Convenience struct for storing relevant data for an Emergency Response Vehicle (ERV) |
►Cstd::exception | |
Cbasic_autonomy::waypoint_generation::GeneralTrajConfig | |
Ccarma_wm_ctrl::Geofence | An object representing a geofence use for communications with CARMA Cloud |
Ccarma_wm_ctrl::GeofenceSchedule | |
Ccarma_wm_ctrl::GeofenceScheduler | A GeofenceScheduler is responsable for notifying the user when a geofence is active or inactive according to its schedule |
Cyield_plugin::GetCollisionResult | Convenience class for saving collision results |
Cgnss_to_map_convertor::GNSSToMapConvertor | |
CGNSSToMapConvertor | Logic class for the GNSSToMapNode which handles the conversion of gnss data to the map frame |
Csubsystem_controllers::GuidanceControllerConfig | Stuct containing the algorithm configuration values for the GuidanceController |
Cguidance::GuidanceStateMachine | |
►Cboost::hash | |
Ccarma_cooperative_perception::Heading | |
Ccarma_wm::IndexedDistanceMap | 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 |
Cinlanecruising_plugin::InLaneCruisingPlugin | Class containing primary business logic for the In-Lane Cruising Plugin |
CInLaneCruisingPluginConfig | Stuct containing the algorithm configuration values for the InLaneCruisingPlugin |
Ccarma_wm::LANE_DIRECTION | |
Cplan_delegator::LaneChangeInformation | Convenience struct for storing information regarding a lane change maneuver |
Ccooperative_lanechange::LaneChangeManeuverOriginalValues | Convenience struct for storing the original start_dist and starting_lane_id associated with a received lane change maneuver |
Ccarma_wm::LaneletDowntrackPair | |
Cport_drayage_plugin::LatLonCoordinate | Convenience struct for storing the vehicle's current latitude/longitude coordinates |
Clci_strategic_plugin::LCIStrategicPluginConfig | Struct to store the configuration settings for the LCIStrategicPlugin class |
Clci_strategic_plugin::LCIStrategicStateTransitionTable | Class defining the state transition table behavior for the LCIStrategic Strategic Plugin |
CLightBarManager | The class responsible for managing light bar status based on the guidance status |
Clightbar_manager::LightBarManagerStateMachine | |
Clightbar_manager::LightBarManagerWorker | |
Clight_controlled_intersection_tactical_plugin::LightControlledIntersectionTacticalPlugin | Class containing primary business logic for the Light Controlled Intersection Tactical Plugin |
Csubsystem_controllers::LocalizationControllerConfig | Stuct containing the algorithm configuration values for the BaseSubsystemController |
Clocalization_manager::LocalizationManager | Primary logic class for the localization manager node |
Clocalization_manager::LocalizationManagerConfig | Struct to store the configuration settings for the LocalizationManager class |
Clocalization_manager::LocalizationTransitionTable | Class defining the state transition table behavior for the LocalizationManager |
Capproximate_intersection::LookupGrid< PointT > | 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 |
Ccarma_cooperative_perception::MapCoordinate | |
Ccarma_wm::test::MapOptions | |
Cmobilitypath_visualizer::MarkerColor | |
Ccarma_cooperative_perception::MeasurementTimeOffset | |
Ccarma_cooperative_perception::MetricSe2 | Calculates distance between a point and detection in SE(2) (special Euclidean) space |
Ccarma_cooperative_perception::Month | |
Cmotion_computation::MotionComputationWorker | The class containing the primary business logic for the Motion Computation Package |
Ccarma_cooperative_perception::MotionModelMapping | |
Ccarma_wm::collision_detection::MovingObject | |
►Carbitrator::NeighborGenerator | |
►Crclcpp::Node | |
Cobject::ObjectDetectionTrackingWorker | |
Cport_drayage_plugin::OperationID | 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 |
Cplatooning_control::PIDController | This class includes logic for PID controller. PID controller is used in this plugin to maintain the inter-vehicle gap by adjusting the speed |
►Carbitrator::PlanningStrategy | Generic interface representing a strategy for arriving at a maneuver plan |
Cplatooning_control::PlatooningControlPluginConfig | Stuct containing the algorithm configuration values for the PlatooningControlPlugin |
Cplatooning_control::PlatooningControlWorker | This is the worker class for platoon controller. It is responsible for generating and smoothing the speed and steering control commands from trajectory points |
Cplatooning_strategic_ihp::PlatooningManager | 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 |
Cplatooning_strategic_ihp::PlatooningPluginConfig | Stuct containing the algorithm configuration values for the yield_pluginConfig |
Cplatooning_strategic_ihp::PlatooningStrategicIHPPlugin | Class containing the logic for Strategic IHP Plugin. This class is responsible for all the negotiations as well as generating a maneuver msg |
Cplatooning_tactical_plugin::PlatooningTacticalPlugin | Class containing primary business logic for the Platooning Tactical Plugin for trajectory generation |
CPlatooningTacticalPluginConfig | Stuct containing the algorithm configuration values for the PlatooningTacticalPlugin |
Cplatooning_control::PlatoonLeaderInfo | Platoon Leader Struct |
Cplatooning_strategic_ihp::PlatoonMember | Platoon member info |
Csubsystem_controllers::PluginManager | The PluginManager serves as a component to manage CARMA Guidance Plugins via their ros2 lifecycle interfaces |
Cbasic_autonomy::waypoint_generation::PointSpeedPair | |
Cplatooning_tactical_plugin::PointSpeedPair | Convenience class for pairing 2d points with speeds |
Cstop_and_wait_plugin::PointSpeedPair | Convenience class for pairing 2d points with speeds |
Cyield_plugin::PointSpeedPair | Convenience class for pairing 2d points with speeds |
Cport_drayage_plugin::PortDrayageMobilityOperationMsg | Convenience struct for storing all data contained in a received MobilityOperation message's strategy_params field with strategy "carma/port_drayage" |
Cport_drayage_plugin::PortDrayageStateMachine | |
Cport_drayage_plugin::PortDrayageWorker | |
Ccarma_cooperative_perception::Position3D | |
Ccarma_cooperative_perception::PositionOffsetXYZ | |
Cpure_pursuit_wrapper::PurePursuitWrapperConfig | Struct containing the algorithm configuration values for the PurePursuitWrapperConfig |
Croute::RouteGeneratorWorker | |
Croute::RouteStateWorker | |
►Clanelet::routing::RoutingGraph | |
Csci_strategic_plugin::SCIStrategicPluginConfig | Struct to store the configuration settings for the WzStrategicPlugin class |
►Carbitrator::SearchStrategy | Generic interface representing a computation to prioritize nodes for expansion in a search graph |
Ccarma_cooperative_perception::SemanticDistance2dScore | Calculate 2D Euclidean distance between track and detection |
Ccarma_wm::SignalizedIntersectionManager | 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 |
Ccarma_cooperative_perception::Speed | |
►Cbasic_autonomy::smoothing::SplineI | Interface to a spline interpolator that can be used to smoothly interpolate between points |
►Cinlanecruising_plugin::smoothing::SplineI | Interface to a spline interpolator that can be used to smoothly interpolate between points |
Csubsystem_controllers::SSCDriverManager | The SSCDriverManager serves as a component to manage ROS1 SSC Driver in CARMA which is primarily in ROS2 |
Cstop_and_dwell_strategic_plugin::StopAndDwellStrategicPluginConfig | Struct to store the configuration settings for the WzStrategicPlugin class |
Cstop_and_wait_plugin::StopandWait | |
CStopandWaitConfig | Stuct containing the algorithm configuration values for the stop_and_wait_plugin |
Cstop_controlled_intersection_tactical_plugin::StopControlledIntersectionTacticalPluginConfig | Stuct containing the algorithm configuration values for the StopControlledIntersectionTacticalPlugin |
CSystemControllerConfig | Stuct containing the algorithm configuration values for the SystemController |
Ccarma_wm::TrackPos | Position in a track based coordinate system where the axis are downtrack and crosstrack. Positive crosstrack is to the left of the reference line |
Ccarma_wm::TrafficControl | |
Ctraffic_incident_parser::TrafficIncidentParserWorker | |
Ctrajectory_follower_wrapper::TrajectoryFollowerWrapperConfig | Stuct containing the algorithm configuration values for trajectory_follower_wrapper |
Clci_strategic_plugin::TrajectoryParams | |
Clight_controlled_intersection_tactical_plugin::TrajectoryParams | |
►Cframe_transformer::TransformerBase | 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 |
Capproaching_emergency_vehicle_plugin::UpcomingLaneChangeParameters | Convenience struct for storing the parameters of an upcoming lane change to ensure that the same parameters are used in separately generated maneuver plans |
Ccarma_cooperative_perception::UtmCoordinate | Represents a position using UTM coordinates |
Ccarma_cooperative_perception::UtmDisplacement | Represent a displacement from a UTM coordinate |
Ccarma_cooperative_perception::UtmZone | |
Carbitrator::VehicleState | Struct defining the vehicle state required for maneuver planning |
Clci_strategic_plugin::LCIStrategicPlugin::VehicleState | Struct representing a vehicle state for the purposes of planning |
Csci_strategic_plugin::SCIStrategicPlugin::VehicleState | Struct representing a vehicle state for the purposes of planning |
Cstop_and_dwell_strategic_plugin::VehicleState | Struct representing a vehicle state for the purposes of planning |
Ccarma_cooperative_perception::Wgs84Coordinate | Represents a position using WGS-84 coordinates |
Ccarma_wm_ctrl::WMBroadcaster | Class which provies exposes map publication and carma_wm update logic |
Ccarma_wm::WMListener | Class which provies automated subscription and threading support for the world model |
Ccarma_wm::WMListenerWorker | Backend logic class for WMListener |
Ccarma_wm_ctrl::WorkZoneSection | |
►Ccarma_wm::WorldModel | 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 |
Cyield_plugin::YieldPlugin | Class containing primary business logic for the In-Lane Cruising Plugin |
CYieldPluginConfig | Stuct containing the algorithm configuration values for the YieldPluginConfig |
►CEnum |