| Clanelet::ArcCoordinates | Describes a position in linestring coordinates |
| Clanelet::traits::AreaTag | Identifies LaneletPrimitives |
| Clanelet::detail::ArrayView< ArrayT, Arr > | |
| Clanelet::Attribute | An attribute represents one value of a tag of a lanelet primitive |
| Clanelet::AttributeNamesString | Lists which attribute strings are mapped to which enum value |
| Clanelet::AttributeValueString | Common values for attributes are defined here |
| ►CBasicLineString2d | |
| Clanelet::BasicPolygon2d | Primitive 2d polygon with basic points |
| ►CBasicLineString3d | |
| Clanelet::BasicPolygon3d | Primitive 3d polygon with basic points |
| Clanelet::BasicPolygonWithHoles2d | A (basic) 2d polygon with holes inside |
| Clanelet::BasicPolygonWithHoles3d | A (basic) 2d polygon with holes inside |
| Clanelet::BoundingBox2d | Axis-Aligned bounding box in 2d |
| Clanelet::traits::BoundingBoxTag | Identifies PointPrimitives |
| Cboost::geometry::traits::closure< lanelet::BasicPolygon2d > | |
| Cboost::geometry::traits::closure< lanelet::BasicPolygon3d > | |
| Cboost::geometry::traits::closure< lanelet::CompoundHybridPolygon2d > | |
| Cboost::geometry::traits::closure< lanelet::CompoundHybridPolygon3d > | |
| Cboost::geometry::traits::closure< lanelet::CompoundPolygon2d > | |
| Cboost::geometry::traits::closure< lanelet::CompoundPolygon3d > | |
| Cboost::geometry::traits::closure< lanelet::ConstHybridPolygon2d > | |
| Cboost::geometry::traits::closure< lanelet::ConstHybridPolygon3d > | |
| Cboost::geometry::traits::closure< lanelet::ConstPolygon2d > | |
| Cboost::geometry::traits::closure< lanelet::ConstPolygon3d > | |
| Cboost::geometry::traits::closure< lanelet::Polygon2d > | |
| Cboost::geometry::traits::closure< lanelet::Polygon3d > | |
| Clanelet::ConstLineStringImpl< PointT >::CompoundLineString< LineStringT > | |
| Clanelet::CompoundLineStringImpl< PointT > | A collection of lineStrings that act as one line string |
| ►Clanelet::CompoundLineStringImpl< BasicPoint2d > | |
| Clanelet::CompoundHybridLineString2d | A hybrid compound linestring in 2d (returns BasicPoint2d) |
| Clanelet::CompoundHybridPolygon2d | Combines multiple linestrings to one polygon in 2d that returns BasicPoint2d |
| ►Clanelet::CompoundLineStringImpl< BasicPoint3d > | |
| Clanelet::CompoundHybridLineString3d | A hybrid compound linestring in 3d (returns BasicPoint3d) |
| Clanelet::CompoundHybridPolygon3d | Combines multiple linestrings to one polygon in 3d that returns BasicPoint3d |
| ►Clanelet::CompoundLineStringImpl< ConstPoint2d > | |
| Clanelet::CompoundLineString2d | A Compound linestring in 2d (returns Point2d) |
| Clanelet::CompoundPolygon2d | Combines multiple linestrings to one polygon in 2d |
| ►Clanelet::CompoundLineStringImpl< ConstPoint3d > | |
| Clanelet::CompoundLineString3d | A Compound linestring in 3d (returns Point3d) |
| Clanelet::CompoundPolygon3d | Combines multiple linestrings to one polygon in 3d |
| Clanelet::ConstLaneletOrArea | An object that can either refer to a lanelet or an area |
| Clanelet::ConstLaneletWithStopLine | |
| ►CConstLineStringT | |
| ►Clanelet::Primitive< ConstLineStringT > | |
| Clanelet::LineStringImpl< ConstLineStringT > | Implementation template class that is common to all non-const types |
| Clanelet::ConstPrimitive< Data > | Basic Primitive class for all primitives of lanelet2 |
| ►Clanelet::ConstPrimitive< AreaData > | |
| ►Clanelet::ConstArea | A const (i.e. immutable) Area |
| ►Clanelet::Primitive< ConstArea > | |
| Clanelet::Area | Famous Area class that represents a basic area as element of the map |
| ►Clanelet::ConstPrimitive< LaneletData > | |
| ►Clanelet::ConstLanelet | An immutable lanelet |
| ►Clanelet::Primitive< ConstLanelet > | |
| Clanelet::Lanelet | The famous (mutable) lanelet class |
| ►Clanelet::ConstPrimitive< LineStringData > | |
| ►Clanelet::ConstLineStringImpl< Point2d > | |
| ►Clanelet::ConstLineString2d | A normal 2d linestring with immutable data |
| Clanelet::ConstHybridLineString2d | A Linestring that returns BasicPoint2d instead of Point2d |
| ►Clanelet::Primitive< ConstLineString2d > | |
| ►Clanelet::LineStringImpl< ConstLineString2d > | |
| Clanelet::LineString2d | A normal 2d linestring with mutable data |
| ►Clanelet::ConstPolygon2d | An immutable clockwise oriented, open (ie start point != end point) polygon in 2d |
| Clanelet::ConstHybridPolygon2d | Polygon with access to primitive points |
| ►Clanelet::Primitive< ConstPolygon2d > | |
| ►Clanelet::LineStringImpl< ConstPolygon2d > | |
| Clanelet::Polygon2d | An mutable clockwise oriented, open (ie start point != end point) polygon in 2d |
| ►Clanelet::ConstLineStringImpl< Point3d > | |
| ►Clanelet::ConstLineString3d | A normal 3d linestring with immutable data |
| Clanelet::ConstHybridLineString3d | A Linestring that returns BasicPoint3d instead of Point3d |
| ►Clanelet::Primitive< ConstLineString3d > | |
| ►Clanelet::LineStringImpl< ConstLineString3d > | |
| Clanelet::LineString3d | A normal 3d linestring with mutable data |
| ►Clanelet::ConstPolygon3d | An immutable clockwise oriented, open (ie start point != end point) polygon in 3d |
| Clanelet::ConstHybridPolygon3d | Polygon with access to primitive points |
| ►Clanelet::Primitive< ConstPolygon3d > | |
| ►Clanelet::LineStringImpl< ConstPolygon3d > | |
| Clanelet::Polygon3d | A mutable clockwise oriented, open (ie start point != end point) polygon in 3d |
| Clanelet::ConstLineStringImpl< PointT > | Implementation template class that is common to all LineStrings |
| ►Clanelet::ConstPrimitive< PointData > | |
| ►Clanelet::ConstPoint2d | An immutable 2d point |
| ►Clanelet::ConstPoint3d | An immutable 3d point |
| ►Clanelet::Primitive< ConstPoint3d > | |
| ►Clanelet::Point2d | A mutable 2d point |
| Clanelet::Point3d | A mutable 3d point |
| ►Clanelet::ConstPrimitive< RegulatoryElementData > | |
| ►Clanelet::RegulatoryElement | A general rule or limitation for a lanelet (abstract base class) |
| Clanelet::AllWayStop | Defines an all way stop. These are a special form of right of way, where all lanelets have to yield, depending on the order of arrival and the route through the intersection |
| Clanelet::RightOfWay | Defines right of way restrictions |
| Clanelet::TrafficLight | Represents a traffic light restriction on the lanelet |
| ►Clanelet::TrafficSign | Expresses a generic traffic sign rule |
| Clanelet::SpeedLimit | Represents a speed limit that affects a lanelet |
| ►Clanelet::Primitive< RegulatoryElement > | |
| Clanelet::GenericRegulatoryElement | A GenericRegulatoryElement can hold any parameters |
| ►Clanelet::ConstWeakArea | Used internally by RegulatoryElements to avoid cyclic dependencies |
| Clanelet::WeakArea | Used internally by RegulatoryElements to avoid cyclic dependencies |
| ►Clanelet::ConstWeakLanelet | |
| Clanelet::WeakLanelet | |
| Clanelet::internal::Converter< RetType > | |
| Clanelet::internal::Converter< const BasicPoint2d > | |
| Clanelet::internal::Converter< const ConstPolygon2d > | |
| Clanelet::internal::Converter< const ConstPolygon3d > | |
| Clanelet::internal::Converter< const std::shared_ptr< const T > > | |
| Clanelet::internal::Converter< std::shared_ptr< const T > > | |
| ►CDerivedConstPrimitive | |
| Clanelet::Primitive< DerivedConstPrimitive > | Base class for all mutable Primitives of lanelet2 |
| Cboost::geometry::traits::exterior_ring< LLPolygon2d > | |
| Cboost::geometry::traits::exterior_ring< LLPolygon3d > | |
| ►Cfalse_type | |
| Clanelet::traits::internal::IsPrimitiveHelper< PrimitiveT > | |
| Cboost::polygon::geometry_concept< AlignedBasicPoint2d > | |
| Cboost::polygon::geometry_concept< lanelet::BasicPoint2d > | |
| Cboost::polygon::geometry_concept< lanelet::ConstPoint2d > | |
| Clanelet::geometry::internal::GetGeometry< T, IfAr< T, void > > | |
| Clanelet::geometry::internal::GetGeometry< T, IfLL< T, void > > | |
| Clanelet::geometry::internal::GetGeometry< T, IfLS< T, void > > | |
| Clanelet::geometry::internal::GetGeometry< T, IfPoly< T, void > > | |
| Clanelet::GPSPoint | A raw GPS point |
| Cstd::hash< lanelet::ConstRuleParameter > | |
| Cstd::hash< std::pair< U, T > > | |
| Clanelet::HashBase< PrimitiveT > | |
| ►Clanelet::HashBase< lanelet::Area > | |
| Cstd::hash< lanelet::Area > | |
| ►Clanelet::HashBase< lanelet::ConstArea > | |
| Cstd::hash< lanelet::ConstArea > | |
| ►Clanelet::HashBase< lanelet::ConstHybridLineString2d > | |
| Cstd::hash< lanelet::ConstHybridLineString2d > | |
| ►Clanelet::HashBase< lanelet::ConstHybridLineString3d > | |
| Cstd::hash< lanelet::ConstHybridLineString3d > | |
| ►Clanelet::HashBase< lanelet::ConstLanelet > | |
| Cstd::hash< lanelet::ConstLanelet > | |
| ►Clanelet::HashBase< lanelet::ConstLaneletOrArea > | |
| Cstd::hash< lanelet::ConstLaneletOrArea > | |
| ►Clanelet::HashBase< lanelet::ConstLineString2d > | |
| Cstd::hash< lanelet::ConstLineString2d > | |
| ►Clanelet::HashBase< lanelet::ConstLineString3d > | |
| Cstd::hash< lanelet::ConstLineString3d > | |
| ►Clanelet::HashBase< lanelet::ConstPoint2d > | |
| Cstd::hash< lanelet::ConstPoint2d > | |
| ►Clanelet::HashBase< lanelet::ConstPoint3d > | |
| Cstd::hash< lanelet::ConstPoint3d > | |
| ►Clanelet::HashBase< lanelet::ConstPolygon2d > | |
| Cstd::hash< lanelet::ConstPolygon2d > | |
| ►Clanelet::HashBase< lanelet::ConstPolygon3d > | |
| Cstd::hash< lanelet::ConstPolygon3d > | |
| ►Clanelet::HashBase< lanelet::Lanelet > | |
| Cstd::hash< lanelet::Lanelet > | |
| ►Clanelet::HashBase< lanelet::LineString2d > | |
| Cstd::hash< lanelet::LineString2d > | |
| ►Clanelet::HashBase< lanelet::LineString3d > | |
| Cstd::hash< lanelet::LineString3d > | |
| ►Clanelet::HashBase< lanelet::Point2d > | |
| Cstd::hash< lanelet::Point2d > | |
| ►Clanelet::HashBase< lanelet::Point3d > | |
| Cstd::hash< lanelet::Point3d > | |
| ►Clanelet::HashBase< lanelet::Polygon2d > | |
| Cstd::hash< lanelet::Polygon2d > | |
| ►Clanelet::HashBase< lanelet::Polygon3d > | |
| Cstd::hash< lanelet::Polygon3d > | |
| ►Clanelet::HashBase< lanelet::RegulatoryElement > | |
| Cstd::hash< lanelet::RegulatoryElement > | |
| Clanelet::HybridMap< ValueT, PairArrayT, PairArray > | A hybrid map is just like a normal map with keys as string, but elements can also be accessed using an enum for the keys. This is much faster than using strings for the lookup |
| Clanelet::HybridMap< Attribute, decltype(AttributeNamesString::Map)&, AttributeNamesString::Map > | |
| Clanelet::HybridMap< RuleParameters, decltype(RoleNameString::Map)&, RoleNameString::Map > | |
| Clanelet::traits::detail::HybridType< T, Enable > | |
| Clanelet::traits::detail::HybridType< T, std::enable_if_t< traits::isLinestringT< T >(), void > > | |
| Clanelet::traits::detail::HybridType< T, std::enable_if_t<!traits::isLinestringT< T >(), void > > | |
| Clanelet::utils::IdLess< T > | Compares ids of primitives. Can be used for some sorted stl containers |
| Cboost::geometry::traits::interior_const_type< LLPolygon2d > | |
| Cboost::geometry::traits::interior_const_type< LLPolygon3d > | |
| Cboost::geometry::traits::interior_mutable_type< LLPolygon2d > | |
| Cboost::geometry::traits::interior_mutable_type< LLPolygon3d > | |
| Cboost::geometry::traits::interior_rings< LLPolygon2d > | |
| Cboost::geometry::traits::interior_rings< LLPolygon3d > | |
| ►Citerator_adaptor | |
| Clanelet::internal::ReverseAndForwardIterator< IteratorT > | |
| Clanelet::internal::TransformIterator< Iterator, RetType, Converter > | |
| ►Citerator_facade | |
| Clanelet::internal::UniqueCompoundIterator< ContainerT > | This iterator iterates over a container of containers as if it was one single container. Succeeding elements that are equal are ignored |
| ►Clanelet::LaneletMapLayers | Container for all layers of a lanelet map. Used by both LaneletMap and LaneletSubmap |
| Clanelet::LaneletMap | Basic element for accessing and managing the elements of a map |
| Clanelet::LaneletSubmap | A LaneletSubmap only contains the elemets that have be expleicitly added to it |
| ►Clanelet::test_cases::LaneletMapTestCase | |
| CLaneletMapGeometryTest | |
| CLaneletMapTest | |
| Clanelet::LaneletSequence | A collection of Lanelets |
| Clanelet::traits::LaneletTag | Identifies PolygonPrimitives |
| Clanelet::LaneletWithStopLine | |
| Clanelet::traits::LayerPrimitive< T > | |
| Clanelet::traits::LayerPrimitive< const T > | |
| Clanelet::LineStringOrPolygonBase< LineStringT, PolygonT > | Base class for objects that can either refer to linestrings or polygons |
| ►Clanelet::LineStringOrPolygonBase< ConstLineString3d, ConstPolygon3d > | |
| Clanelet::ConstLineStringOrPolygon3d | This class holds either a ConstLineString3d or a ConstPolygon3d |
| ►Clanelet::LineStringOrPolygonBase< LineString3d, Polygon3d > | |
| Clanelet::LineStringOrPolygon3d | This class holds either a LineString3d or a Polygon3d |
| Clanelet::geometry::internal::LineStringsCoordinate | |
| Clanelet::traits::LineStringTag | Identifies bounding boxes |
| Clanelet::utils::detail::MoveIf< Move > | |
| Clanelet::utils::detail::MoveIf< false > | |
| Clanelet::utils::detail::MoveIf< true > | |
| ►Cnoncopyable | |
| Clanelet::CompoundLineStringData | Common data object for all CompoundLineStrings |
| Clanelet::LaneletSequenceData | Common data management class for LaneletSequences |
| Clanelet::RegulatoryElement | A general rule or limitation for a lanelet (abstract base class) |
| Clanelet::traits::Owned< PrimitiveT > | Can be used to determine which primitive type is managed by a primitive |
| Clanelet::traits::Owned< Area > | |
| Clanelet::traits::Owned< Lanelet > | |
| Clanelet::traits::Owned< LineString3d > | |
| Clanelet::traits::Owned< Polygon3d > | |
| Clanelet::traits::Owned< RegulatoryElementPtr > | |
| Clanelet::internal::PairConverter< RetType > | |
| Clanelet::Participants | Parts of tag that have to be combined with either Participants:, OneWay: or SpeedLimit to generate an override |
| Cboost::polygon::point_mutable_traits< AlignedBasicPoint2d > | |
| Cboost::polygon::point_mutable_traits< lanelet::BasicPoint2d > | |
| Cboost::polygon::point_mutable_traits< lanelet::ConstPoint2d > | |
| Cboost::geometry::traits::point_order< lanelet::BasicPolygon2d > | |
| Cboost::geometry::traits::point_order< lanelet::BasicPolygon3d > | |
| Cboost::geometry::traits::point_order< lanelet::CompoundHybridPolygon2d > | |
| Cboost::geometry::traits::point_order< lanelet::CompoundHybridPolygon3d > | |
| Cboost::geometry::traits::point_order< lanelet::CompoundPolygon2d > | |
| Cboost::geometry::traits::point_order< lanelet::CompoundPolygon3d > | |
| Cboost::geometry::traits::point_order< lanelet::ConstHybridPolygon2d > | |
| Cboost::geometry::traits::point_order< lanelet::ConstHybridPolygon3d > | |
| Cboost::geometry::traits::point_order< lanelet::ConstPolygon2d > | |
| Cboost::geometry::traits::point_order< lanelet::ConstPolygon3d > | |
| Cboost::geometry::traits::point_order< lanelet::Polygon2d > | |
| Cboost::geometry::traits::point_order< lanelet::Polygon3d > | |
| Cboost::polygon::point_traits< AlignedBasicPoint2d > | |
| Cboost::polygon::point_traits< lanelet::BasicPoint2d > | |
| Cboost::polygon::point_traits< lanelet::ConstPoint2d > | |
| Clanelet::geometry::internal::PointSearchResult | |
| Clanelet::traits::PointTag | |
| Clanelet::geometry::internal::PointVincinity | |
| Clanelet::traits::PolygonTag | Identifies LineStringPrimitives |
| ►Clanelet::PrimitiveData | Common data class for all lanelet primitives |
| Clanelet::AreaData | Common data management class for all Area-Typed objects |
| Clanelet::LaneletData | Common data management class for all Lanelet-Typed objects |
| Clanelet::LineStringData | |
| Clanelet::PointData | |
| Clanelet::RegulatoryElementData | Data container for all RegulatoryElement types |
| Clanelet::PrimitiveLayer< T > | Each primitive in lanelet2 has its own layer in the map |
| ►Clanelet::PrimitiveLayer< Area > | |
| Clanelet::AreaLayer | Specialized map layer for Area |
| ►Clanelet::PrimitiveLayer< Lanelet > | |
| Clanelet::LaneletLayer | Specialized map layer for Lanelet |
| Clanelet::PrimitiveLayer< LineString3d > | |
| Clanelet::PrimitiveLayer< Point3d > | |
| Clanelet::PrimitiveLayer< Polygon3d > | |
| Clanelet::PrimitiveLayer< RegulatoryElementPtr > | |
| Clanelet::traits::PrimitiveTraits< T > | Identifies RegulatoryElementPrimitives |
| ►Clanelet::traits::PrimitiveTraits< BasicLineString2d > | |
| Clanelet::traits::LineStringTraits< BasicLineString2d > | |
| ►Clanelet::traits::PrimitiveTraits< BasicLineString3d > | |
| Clanelet::traits::LineStringTraits< BasicLineString3d > | |
| ►Clanelet::traits::PrimitiveTraits< BasicPoint2d > | |
| Clanelet::traits::PointTraits< BasicPoint2d > | |
| ►Clanelet::traits::PrimitiveTraits< BasicPoint3d > | Used for templates that require info about this point |
| Clanelet::traits::PointTraits< BasicPoint3d > | |
| Clanelet::traits::PrimitiveTraits< BasicPolygon2d > | |
| Clanelet::traits::PrimitiveTraits< BasicPolygon3d > | |
| Clanelet::traits::PrimitiveTraits< BoundingBox2d > | |
| Clanelet::traits::PrimitiveTraits< BoundingBox3d > | |
| Clanelet::traits::PrimitiveTraits< ConstRuleParameter > | |
| ►Clanelet::traits::PrimitiveTraits< Eigen::Vector2d > | |
| Clanelet::traits::PointTraits< Eigen::Vector2d > | |
| ►Clanelet::traits::PrimitiveTraits< LineStringT > | |
| Clanelet::traits::LineStringTraits< LineStringT > | Specialization of traits for linestrings |
| ►Clanelet::traits::PrimitiveTraits< PointT > | |
| Clanelet::traits::PointTraits< PointT > | Specialization of traits for points |
| ►Clanelet::traits::PrimitiveTraits< PolygonT > | |
| Clanelet::traits::PolygonTraits< PolygonT > | Specialization of traits for polygons |
| Clanelet::traits::PrimitiveTraits< RegulatoryElementConstPtr > | |
| Clanelet::traits::PrimitiveTraits< RegulatoryElementPtr > | |
| Clanelet::traits::PrimitiveTraits< RuleParameter > | |
| ►Clanelet::traits::PrimitiveTraits< Segment< PointT > > | |
| Clanelet::traits::LineStringTraits< Segment< PointT > > | |
| Clanelet::geometry::internal::ProjectedPointInfo< PointT > | |
| Clanelet::RegisterRegulatoryElement< T > | Template class for registering new RegulatoryElements |
| Clanelet::RegulatoryElementFactory | Creates regulatory elements based on their type |
| Clanelet::traits::RegulatoryElementTag | Identifies AreaPrimitives |
| Clanelet::utils::detail::ReserveIfNecessary< ContainerT > | |
| Clanelet::utils::detail::ReserveIfNecessary< std::vector< T > > | |
| Cboost::geometry::traits::ring_const_type< LLPolygon2d > | |
| Cboost::geometry::traits::ring_const_type< LLPolygon3d > | |
| Cboost::geometry::traits::ring_mutable_type< LLPolygon2d > | |
| Cboost::geometry::traits::ring_mutable_type< LLPolygon3d > | |
| Clanelet::RoleNameString | Lists which role strings are mapped to which enum value |
| ►Cruntime_error | |
| ►Clanelet::LaneletError | Generic lanelet error class. All errors lanelet2 will throw derive from this type |
| Clanelet::GeometryError | Thrown when a geometric operation is not valid |
| Clanelet::InvalidInputError | Thrown when a function was called with invalid input arguments |
| Clanelet::InvalidObjectStateError | Thrown when the state of a lanelet object is invalid E.g. when an linestring has no points or member pointers are NULL |
| Clanelet::LaneletMultiError | Thrown when multiple errors occur at the same time |
| Clanelet::NoSuchAttributeError | Thrown when an attribute has been queried that does not exist |
| Clanelet::NoSuchPrimitiveError | Thrown when an element is not part of the map |
| Clanelet::NullptrError | SharedPtrs in lanelet2 must never point to null. If this is violated, this exception is thrown (usually checked at object construction) |
| Clanelet::internal::SearchBox< T > | |
| Clanelet::internal::SearchBox< Point3d > | |
| Clanelet::geometry::internal::SegmentSearch | |
| Clanelet::internal::SelectBasicLineString< PointT > | |
| Clanelet::internal::SelectBasicLineString< BasicPoint2d > | |
| Clanelet::internal::SelectBasicLineString< BasicPoint3d > | |
| Clanelet::internal::SelectCompoundLsIterator< PointT > | This class selects which iterator CompoundLineStringImpl needs |
| Clanelet::internal::SelectCompoundLsIterator< ConstPoint3d > | |
| Clanelet::internal::SelectInsertIterator< T > | |
| Clanelet::internal::SelectInsertIterator< typename SelectLsIterator< Point2d >::Iterator > | |
| Clanelet::internal::SelectLsIterator< PointT > | |
| Clanelet::internal::SelectLsIterator< const Point3d > | |
| Clanelet::internal::SelectLsIterator< const PointT > | |
| Clanelet::internal::SelectLsIterator< Point3d > | |
| Clanelet::geometry::internal::SelfIntersection2d | |
| Clanelet::geometry::internal::SelfIntersectionLong | |
| ►Cstatic_visitor | |
| Clanelet::internal::MutableParameterVisitor | |
| Clanelet::RuleParameterVisitor | You can inherit from this visitor to perform an operation on each parameter of a regulatory element |
| Cboost::geometry::traits::tag< LLPolygon2d > | |
| Cboost::geometry::traits::tag< LLPolygon3d > | |
| ►CTest | |
| CLaneletMapGeometryTest | |
| CLaneletMapTest | |
| CLaneletSequenceTest | |
| CLaneletTest | |
| ►CLineStringPoints | |
| CBasicLineStringTypeTest< T > | |
| ►CBasicLineStringTypeTest< LineString2d > | |
| CLineStringTypeTest< BasicLineString2d > | |
| ►CBasicLineStringTypeTest< LineString3d > | |
| CLineStringTypeTest< BasicLineString3d > | |
| CCompoundLineStringTypeTest< T > | |
| ►CCompoundLineStringTypeTest< CompoundHybridLineString2d > | |
| CLineStringTypeTest< CompoundHybridLineString2d > | |
| ►CCompoundLineStringTypeTest< CompoundHybridLineString3d > | |
| CLineStringTypeTest< CompoundHybridLineString3d > | |
| ►CCompoundLineStringTypeTest< CompoundLineString2d > | |
| CLineStringTypeTest< CompoundLineString2d > | |
| ►CCompoundLineStringTypeTest< CompoundLineString3d > | |
| CLineStringTypeTest< CompoundLineString3d > | |
| ►CLineStringTypeTest< T > | |
| CAllLineStringsTest< T > | |
| CBasicLineStringsTest< T > | |
| CHybridLineStringsTest< T > | |
| CMutableLineStringsTest< T > | |
| CNonHybridLineStringsTest< T > | |
| CNormalLineStringsTest< T > | |
| CPrimitiveLineStringsTest< T > | |
| CThreeDLineStringsTest< T > | |
| CTwoDLineStringsTest< T > | |
| ►CPoint2dTypeTest< T > | |
| CTwoDPointsTest< T > | |
| ►CPolygonPoints | |
| CCompoundPolygonTypeTest< T > | |
| ►CCompoundPolygonTypeTest< CompoundHybridPolygon2d > | |
| CPolygonTypeTest< CompoundHybridPolygon2d > | |
| ►CCompoundPolygonTypeTest< CompoundHybridPolygon3d > | |
| CPolygonTypeTest< CompoundHybridPolygon3d > | |
| ►CCompoundPolygonTypeTest< CompoundPolygon2d > | |
| CPolygonTypeTest< CompoundPolygon2d > | |
| ►CCompoundPolygonTypeTest< CompoundPolygon3d > | |
| CPolygonTypeTest< CompoundPolygon3d > | |
| ►CPolygonTypeTest< T > | |
| CAllPolygonsTest< T > | |
| CHybridPolygonsTest< T > | |
| CHybridPolygonsTwoDTest< T > | |
| CMutablePolygonsTest< T > | |
| CNonHybridPolygonsTest< T > | |
| CNormalPolygonsTest< T > | |
| CPrimitivePolygonsTest< T > | |
| CThreeDAndBasicPolygonsTest< T > | |
| CThreeDPolygonsTest< T > | |
| CTwoDAndBasicPolygonsTest< T > | |
| CTwoDPolygonsTest< T > | |
| CRegulatoryElementTest | |
| CTestArea | |
| CTestLaneletOrArea | |
| Clanelet::TrafficSignsWithType | Used as input argument to create TrafficSign regElem |
| Clanelet::PrimitiveLayer< T >::Tree | |
| ►Ctrue_type | |
| Clanelet::traits::internal::IsPrimitiveHelper< ConstPrimitive< PrimitiveT > > | |
| Clanelet::UsageLookup< T > | |
| Clanelet::UsageLookup< Area > | |
| Clanelet::UsageLookup< Lanelet > | |
| Clanelet::UsageLookup< lanelet::Point3d > | |
| Clanelet::UsageLookup< Point3d > | |
| Clanelet::UsageLookup< RegulatoryElementPtr > | |
| Clanelet::internal::ValueOf< ValueT > | |
| Clanelet::internal::ValueOf< Optional< ValueT > > | |