2 #include <boost/units/physical_dimensions/acceleration.hpp> 3 #include <boost/units/physical_dimensions/velocity.hpp> 4 #include <boost/units/quantity.hpp> 5 #include <boost/units/systems/si/base.hpp> 200 using Ids = std::vector<Id>;
204 using MPS = boost::units::unit<boost::units::velocity_dimension, boost::units::si::system>;
205 using MPS2 = boost::units::unit<boost::units::acceleration_dimension, boost::units::si::system>;
Polygon with access to primitive points.
std::vector< CompoundLineString2d > CompoundLineStrings2d
std::vector< ConstHybridLineString3d > ConstHybridLineStrings3d
std::vector< LineString2d > LineStrings2d
An object that can either refer to a lanelet or an area.
std::vector< ConstHybridPolygon3d > ConstHybridPolygons3d
std::vector< LaneletSequenceDataConstPtr > LaneletSequenceDataConstPtrs
std::vector< PointDataConstPtr > PointDataConstPtrs
std::shared_ptr< RegulatoryElement > RegulatoryElementPtr
boost::units::quantity< MPS > MPSQuantity
std::vector< ConstLineString3d > ConstLineStrings3d
std::shared_ptr< LaneletSequenceData > LaneletSequenceDataPtr
boost::units::unit< boost::units::velocity_dimension, boost::units::si::system > MPS
std::shared_ptr< const CompoundLineStringData > CompoundLineStringDataConstPtr
std::vector< ConstLaneletOrArea > ConstLaneletOrAreas
A Linestring that returns BasicPoint2d instead of Point2d.
units::MPS2Quantity Acceleration
std::shared_ptr< const LaneletSequenceData > LaneletSequenceDataConstPtr
std::vector< RegulatoryElementPtr > RegulatoryElementPtrs
A Compound linestring in 3d (returns Point3d)
A (basic) 2d polygon with holes insideThis class is thought for geometry calculations, it has no properties of a normal lanelet primitive.
std::shared_ptr< LaneletMap > LaneletMapPtr
An mutable clockwise oriented, open (ie start point != end point) polygon in 2d.
std::vector< AreaDataPtr > AreaDataPtrs
An immutable clockwise oriented, open (ie start point != end point) polygon in 2d.
std::vector< LaneletSubmapConstPtr > LaneletSubmapConstPtrs
std::vector< LaneletMapPtr > LaneletMapPtrs
std::shared_ptr< CompoundLineStringData > CompoundLineStringDataPtr
Combines multiple linestrings to one polygon in 3d that returns BasicPoint3d.
std::vector< BasicPolygonWithHoles3d > BasicPolygonsWithHoles3d
std::vector< ConstPolygon3d > ConstPolygons3d
std::shared_ptr< LaneletSubmap > LaneletSubmapPtr
The famous (mutable) lanelet class.
std::vector< CompoundPolygon2d > CompoundPolygons2d
std::vector< Lanelet > Lanelets
std::shared_ptr< const RegulatoryElementData > RegulatoryElementDataConstPtr
Common data management class for all Lanelet-Typed objects.
std::shared_ptr< RegulatoryElementData > RegulatoryElementDataPtr
A hybrid compound linestring in 2d (returns BasicPoint2d)
std::vector< LaneletMapConstPtr > LaneletMapConstPtrs
std::shared_ptr< LineStringData > LineStringDataPtr
A GenericRegulatoryElement can hold any parameters.
std::vector< ConstHybridPolygon2d > ConstHybridPolygons2d
std::vector< CompoundLineString3d > CompoundLineStrings3d
std::shared_ptr< const LaneletMap > LaneletMapConstPtr
std::weak_ptr< LaneletData > LaneletDataptr
Primitive 2d polygon with basic points.
boost::units::quantity< MPS2 > MPS2Quantity
A normal 3d linestring with immutable data.
std::vector< LaneletDataPtr > LaneletDataPtrs
std::vector< PointDataPtr > PointDataPtrs
std::shared_ptr< const PointData > PointDataConstPtr
used internally by RegulatoryElements to avoid cyclic dependencies.
Creates regulatory elements based on their type.
std::vector< Point3d > Points3d
std::vector< Polygon3d > Polygons3d
std::unique_ptr< LaneletMap > LaneletMapUPtr
Combines multiple linestrings to one polygon in 3d.
std::unique_ptr< const LaneletSubmap > LaneletSubmapConstUPtr
std::vector< ConstPolygon2d > ConstPolygons2d
std::shared_ptr< const AreaData > AreaDataConstPtr
A normal 3d linestring with mutable data.
std::weak_ptr< AreaData > AreaDataptr
std::shared_ptr< const PrimitiveData > PrimitiveDataConstPtr
std::vector< GPSPoint > GPSPoints
std::vector< CompoundHybridPolygon2d > CompoundHybridPolygons2d
std::vector< AreaDataConstPtr > AreaDataConstPtrs
std::weak_ptr< const LaneletData > LaneletDataConstWptr
std::vector< PrimitiveDataPtr > PrimitiveDataPtrs
std::shared_ptr< const LineStringData > LineStringDataConstPtr
std::vector< LaneletDataConstPtr > LaneletDataConstPtrs
Polygon with access to primitive points.
Common data object for all CompoundLineStrings.
A Compound linestring in 2d (returns Point2d)
A (basic) 2d polygon with holes insideThis class is thought for geometry calculations, it has no properties of a normal lanelet primitive.
A collection of Lanelets.
A LaneletSubmap only contains the elemets that have be expleicitly added to it.
std::shared_ptr< const LaneletData > LaneletDataConstPtr
std::vector< PrimitiveDataConstPtr > PrimitiveDataConstPtrs
Data container for all RegulatoryElement types.
std::shared_ptr< PointData > PointDataPtr
std::shared_ptr< const RegulatoryElement > RegulatoryElementConstPtr
std::vector< RegulatoryElementDataConstPtr > RegulatoryElementDataConstPtrs
A Linestring that returns BasicPoint3d instead of Point3d.
std::vector< CompoundLineStringDataConstPtr > CompoundLineStringDataConstPtrs
std::vector< LaneletSubmapPtr > LaneletSubmapPtrs
A mutable clockwise oriented, open (ie start point != end point) polygon in 3d.
std::vector< ConstLineString2d > ConstLineStrings2d
An immutable clockwise oriented, open (ie start point != end point) polygon in 3d.
std::vector< BasicPolygonWithHoles2d > BasicPolygonsWithHoles2d
std::vector< LaneletSequenceDataPtr > LaneletSequenceDataPtrs
std::vector< BasicPolygon3d > BasicPolygons3d
Common data management class for LaneletSequences.
Famous Area class that represents a basic area as element of the map.
std::shared_ptr< LaneletData > LaneletDataPtr
A hybrid compound linestring in 3d (returns BasicPoint3d)
Combines multiple linestrings to one polygon in 2d that returns BasicPoint2d.
std::vector< ConstPoint2d > ConstPoints2d
std::vector< RegulatoryElementConstPtr > RegulatoryElementConstPtrs
std::vector< LaneletSequence > LaneletSequences
boost::units::unit< boost::units::acceleration_dimension, boost::units::si::system > MPS2
Common data management class for all Area-Typed objects.
std::shared_ptr< const LaneletSubmap > LaneletSubmapConstPtr
std::vector< Area > Areas
A general rule or limitation for a lanelet (abstract base class)
std::shared_ptr< AreaData > AreaDataPtr
std::vector< LineStringDataPtr > LineStringDataPtrs
std::unique_ptr< const LaneletMap > LaneletMapConstUPtr
A const (i.e. immutable) Area.
Basic element for accessing and managing the elements of a map.
std::vector< Point2d > Points2d
Primitive 3d polygon with basic points.
Combines multiple linestrings to one polygon in 2d.
std::vector< LaneletDataConstWptr > LaneletDataConstWptrs
std::vector< Polygon2d > Polygons2d
std::shared_ptr< PrimitiveData > PrimitiveDataPtr
std::unique_ptr< LaneletSubmap > LaneletSubmapUPtr
std::vector< ConstHybridLineString2d > ConstHybridLineStrings2d
A normal 2d linestring with immutable data.
std::vector< CompoundPolygon3d > CompoundPolygons3d
A normal 2d linestring with mutable data.
std::vector< ConstPoint3d > ConstPoints3d
std::vector< LineStringDataConstPtr > LineStringDataConstPtrs
std::vector< RegulatoryElementDataPtr > RegulatoryElementDataPtrs
std::vector< LineString3d > LineStrings3d
std::vector< CompoundHybridLineString3d > CompoundHybridLineStrings3d
constexpr Id InvalId
indicates a primitive that is not part of a map
std::vector< CompoundHybridPolygon3d > CompoundHybridPolygons3d
units::MPSQuantity Velocity
std::vector< ConstArea > ConstAreas
std::vector< CompoundLineStringDataPtr > CompoundLineStringDataPtrs
std::vector< BasicPolygon2d > BasicPolygons2d
used internally by RegulatoryElements to avoid cyclic dependencies.
std::vector< ConstLanelet > ConstLanelets
std::vector< CompoundHybridLineString2d > CompoundHybridLineStrings2d