#include <boost/geometry/algorithms/buffer.hpp>
#include <boost/geometry/algorithms/distance.hpp>
#include "lanelet2_core/LaneletMap.h"
#include "lanelet2_core/primitives/BoundingBox.h"
#include "lanelet2_core/primitives/Lanelet.h"
#include "lanelet2_core/utility/Utilities.h"
Go to the source code of this file.
|
template<typename LayerT , typename GeometryT > |
auto | lanelet::geometry::findWithin2d (LayerT &layer, const GeometryT &geometry, double maxDist=0.) -> std::vector< std::pair< double, traits::LayerPrimitiveType< LayerT >>> |
| Returns all elements that are closer than maxDist to a geometry in 2d. More...
|
|
template<typename LayerT , typename GeometryT > |
auto | lanelet::geometry::findWithin3d (LayerT &layer, const GeometryT &geometry, double maxDist=0.) -> std::vector< std::pair< double, traits::LayerPrimitiveType< LayerT >>> |
| Returns all elements that are closer than maxDist to a geometry in 3d. More...
|
|