scenario_simulator_v2 C++ API
hdmap_utils.hpp
Go to the documentation of this file.
1 // Copyright 2015 TIER IV, Inc. All rights reserved.
2 //
3 // Licensed under the Apache License, Version 2.0 (the "License");
4 // you may not use this file except in compliance with the License.
5 // You may obtain a copy of the License at
6 //
7 // http://www.apache.org/licenses/LICENSE-2.0
8 //
9 // Unless required by applicable law or agreed to in writing, software
10 // distributed under the License is distributed on an "AS IS" BASIS,
11 // WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied.
12 // See the License for the specific language governing permissions and
13 // limitations under the License.
14 
15 #ifndef TRAFFIC_SIMULATOR__HDMAP_UTILS__HDMAP_UTILS_HPP_
16 #define TRAFFIC_SIMULATOR__HDMAP_UTILS__HDMAP_UTILS_HPP_
17 
18 #include <geometry_msgs/msg/vector3.h>
19 #include <lanelet2_core/LaneletMap.h>
20 #include <lanelet2_core/geometry/Lanelet.h>
21 #include <lanelet2_core/primitives/BasicRegulatoryElements.h>
22 #include <lanelet2_core/primitives/LaneletSequence.h>
23 #include <lanelet2_matching/LaneletMatching.h>
24 #include <lanelet2_routing/Route.h>
25 #include <lanelet2_routing/RoutingCost.h>
26 #include <lanelet2_routing/RoutingGraph.h>
27 #include <lanelet2_routing/RoutingGraphContainer.h>
28 #include <lanelet2_traffic_rules/TrafficRulesFactory.h>
29 #include <tf2/LinearMath/Matrix3x3.h>
30 
31 #include <autoware_lanelet2_extension/utility/message_conversion.hpp>
32 #include <autoware_lanelet2_extension/utility/query.hpp>
33 #include <autoware_lanelet2_extension/utility/utilities.hpp>
34 #include <autoware_map_msgs/msg/lanelet_map_bin.hpp>
35 #include <boost/filesystem.hpp>
36 #include <geographic_msgs/msg/geo_point.hpp>
40 #include <geometry_msgs/msg/pose_stamped.hpp>
41 #include <map>
42 #include <memory>
43 #include <optional>
44 #include <rclcpp/rclcpp.hpp>
45 #include <string>
46 #include <tf2_geometry_msgs/tf2_geometry_msgs.hpp>
51 #include <traffic_simulator_msgs/msg/bounding_box.hpp>
52 #include <traffic_simulator_msgs/msg/entity_status.hpp>
53 #include <tuple>
54 #include <unordered_map>
55 #include <utility>
56 #include <vector>
57 #include <visualization_msgs/msg/marker_array.hpp>
58 
59 namespace hdmap_utils
60 {
61 enum class LaneletType { LANE, CROSSWALK };
62 
64 {
65 public:
66  explicit HdMapUtils(const boost::filesystem::path &, const geographic_msgs::msg::GeoPoint &);
67 
68  auto canChangeLane(
69  const lanelet::Id from, const lanelet::Id to,
71  traffic_simulator::RoutingConfiguration().routing_graph_type) const -> bool;
72 
74  const lanelet::Id, const double s, const lanelet::Ids &,
75  const double forward_distance = 20) const -> std::vector<geometry_msgs::msg::Point>;
76 
77  auto countLaneChanges(
80  const traffic_simulator::RoutingConfiguration & routing_configuration =
81  traffic_simulator::RoutingConfiguration()) const -> std::optional<std::pair<int, int>>;
82 
83  auto filterLaneletIds(const lanelet::Ids &, const char subtype[]) const -> lanelet::Ids;
84 
85  auto generateMarker() const -> visualization_msgs::msg::MarkerArray;
86 
87  auto getCenterPoints(const lanelet::Ids &) const -> std::vector<geometry_msgs::msg::Point>;
88 
89  auto getCenterPoints(const lanelet::Id) const -> std::vector<geometry_msgs::msg::Point>;
90 
91  auto getCenterPointsSpline(const lanelet::Id) const
92  -> std::shared_ptr<math::geometry::CatmullRomSpline>;
93 
95  const geometry_msgs::msg::Pose &, const double distance_thresh = 30.0,
96  const bool include_crosswalk = false) const -> std::optional<lanelet::Id>;
97 
99  const lanelet::Id lanelet_id, const lanelet::Id crossing_lanelet_id) const
100  -> std::optional<double>;
101 
102  auto getConflictingCrosswalkIds(const lanelet::Ids &) const -> lanelet::Ids;
103 
105  const lanelet::Ids &, const traffic_simulator::RoutingGraphType type =
106  traffic_simulator::RoutingConfiguration().routing_graph_type) const
107  -> lanelet::Ids;
108 
110  const lanelet::Ids & route_lanelets,
111  const math::geometry::CatmullRomSplineInterface & spline) const -> std::optional<double>;
112 
114  const lanelet::Ids & route_lanelets,
115  const std::vector<geometry_msgs::msg::Point> & waypoints) const -> std::optional<double>;
116 
119  const lanelet::Id traffic_light_id) const -> std::optional<double>;
120 
122  const std::vector<geometry_msgs::msg::Point> & waypoints,
123  const lanelet::Id traffic_light_id) const -> std::optional<double>;
124 
126  const lanelet::Id current_lanelet_id, const lanelet::Ids & route, const double horizon = 100,
127  const bool include_current_lanelet_id = true,
129  traffic_simulator::RoutingConfiguration().routing_graph_type) const -> lanelet::Ids;
130 
132  const lanelet::Id, const double distance = 100, const bool include_self = true,
134  traffic_simulator::RoutingConfiguration().routing_graph_type) const -> lanelet::Ids;
135 
136  auto getAltitude(const traffic_simulator_msgs::msg::LaneletPose &) const -> double;
137 
139  const geometry_msgs::msg::Pose & from,
140  const traffic_simulator::lane_change::Parameter & lane_change_parameter,
141  const double maximum_curvature_threshold, const double target_trajectory_length,
142  const double forward_distance_threshold) const
143  -> std::optional<std::pair<math::geometry::HermiteCurve, double>>;
144 
147  const traffic_simulator::lane_change::Parameter & lane_change_parameter) const
148  -> std::optional<std::pair<math::geometry::HermiteCurve, double>>;
149 
151  const lanelet::Id, const traffic_simulator::lane_change::Direction,
153  traffic_simulator::RoutingConfiguration().routing_graph_type) const
154  -> std::optional<lanelet::Id>;
155 
157  const lanelet::Id, const traffic_simulator::lane_change::Direction, const std::uint8_t shift,
159  traffic_simulator::RoutingConfiguration().routing_graph_type) const
160  -> std::optional<lanelet::Id>;
161 
162  auto getLaneletIds() const -> lanelet::Ids;
163 
164  auto getLaneletPolygon(const lanelet::Id) const -> std::vector<geometry_msgs::msg::Point>;
165 
166  auto getLanelets(const lanelet::Ids &) const -> lanelet::Lanelets;
167 
171  const traffic_simulator::RoutingConfiguration & routing_configuration =
172  traffic_simulator::RoutingConfiguration()) const -> std::optional<double>;
173 
174  auto getNearbyLaneletIds(
175  const geometry_msgs::msg::Point &, const double distance_threshold,
176  const bool include_crosswalk, const std::size_t search_count = 5) const -> lanelet::Ids;
177 
178  auto getNearbyLaneletIds(
179  const geometry_msgs::msg::Point &, const double distance_threshold,
180  const std::size_t search_count = 5) const -> lanelet::Ids;
181 
182  auto getPreviousLanelets(
183  const lanelet::Id, const double backward_horizon = 100,
185  traffic_simulator::RoutingConfiguration().routing_graph_type) const -> lanelet::Ids;
186 
187  auto getRightOfWayLaneletIds(const lanelet::Ids &) const
188  -> std::unordered_map<lanelet::Id, lanelet::Ids>;
189 
190  auto getRightOfWayLaneletIds(const lanelet::Id) const -> lanelet::Ids;
191 
192  auto getRoute(
193  const lanelet::Id from, const lanelet::Id to,
194  const traffic_simulator::RoutingConfiguration & routing_configuration =
195  traffic_simulator::RoutingConfiguration()) const -> lanelet::Ids;
196 
197  auto getSpeedLimit(
198  const lanelet::Ids &, const traffic_simulator::RoutingGraphType type =
199  traffic_simulator::RoutingConfiguration().routing_graph_type) const
200  -> double;
201 
202  auto getTangentVector(const lanelet::Id, const double s) const
203  -> std::optional<geometry_msgs::msg::Vector3>;
204 
205  auto getTrafficLightBulbPosition(const lanelet::Id traffic_light_id, const std::string &) const
206  -> std::optional<geometry_msgs::msg::Point>;
207 
208  auto getTrafficLightIds() const -> lanelet::Ids;
209 
210  auto getTrafficLightIdsOnPath(const lanelet::Ids & route_lanelets) const -> lanelet::Ids;
211 
212  auto getTrafficLightRegulatoryElement(const lanelet::Id) const -> lanelet::TrafficLight::Ptr;
213 
214  auto getTrafficLightRegulatoryElementIDsFromTrafficLight(const lanelet::Id) const -> lanelet::Ids;
215 
216  auto getTrafficLightStopLineIds(const lanelet::Id traffic_light_id) const -> lanelet::Ids;
217 
218  auto getTrafficLightStopLinesPoints(const lanelet::Id traffic_light_id) const
219  -> std::vector<std::vector<geometry_msgs::msg::Point>>;
220 
221  auto insertMarkerArray(
222  visualization_msgs::msg::MarkerArray &, const visualization_msgs::msg::MarkerArray &) const
223  -> void;
224 
225  auto isInIntersection(const lanelet::Id) const -> bool;
226 
227  auto isInLanelet(const lanelet::Id, const double s) const -> bool;
228 
229  auto isInRoute(const lanelet::Id, const lanelet::Ids & route) const -> bool;
230 
231  auto isTrafficLight(const lanelet::Id) const -> bool;
232 
233  auto isTrafficLightRegulatoryElement(const lanelet::Id) const -> bool;
234 
235 private:
238  constexpr static double DEFAULT_MATCH_TO_LANE_REDUCTION_RATIO = 0.8;
239 
240 public:
241  auto toMapBin() const -> autoware_map_msgs::msg::LaneletMapBin;
242 
243  auto toMapPoints(const lanelet::Id, const std::vector<double> & s) const
244  -> std::vector<geometry_msgs::msg::Point>;
245 
246 private:
250  // @{
251  mutable CenterPointsCache center_points_cache_;
252  mutable LaneletLengthCache lanelet_length_cache_;
253  // @}
254 
255  lanelet::LaneletMapPtr lanelet_map_ptr_;
256 
257  class RoutingGraphs
258  {
259  public:
260  explicit RoutingGraphs(const lanelet::LaneletMapPtr & lanelet_map);
261 
263  {
264  lanelet::traffic_rules::TrafficRulesPtr rules;
265  lanelet::routing::RoutingGraphPtr graph;
267  };
268 
269  [[nodiscard]] lanelet::routing::RoutingGraphPtr routing_graph(
270  const traffic_simulator::RoutingGraphType type) const;
271 
272  [[nodiscard]] lanelet::traffic_rules::TrafficRulesPtr traffic_rule(
273  const traffic_simulator::RoutingGraphType type) const;
274 
275  [[nodiscard]] auto getRoute(
276  const lanelet::Id from_lanelet_id, const lanelet::Id to_lanelet_id,
277  lanelet::LaneletMapPtr lanelet_map_ptr,
278  const traffic_simulator::RoutingConfiguration & routing_configuration =
279  traffic_simulator::RoutingConfiguration()) -> lanelet::Ids;
280 
281  private:
282  [[nodiscard]] RouteCache & route_cache(const traffic_simulator::RoutingGraphType type);
283 
284  RuleWithGraph vehicle;
285 
286  RuleWithGraph vehicle_with_road_shoulder;
287 
288  RuleWithGraph pedestrian;
289  };
290 
291  std::unique_ptr<RoutingGraphs> routing_graphs_;
292 
293  template <typename Lanelet>
294  auto getLaneletIds(const std::vector<Lanelet> & lanelets) const -> lanelet::Ids
295  {
296  lanelet::Ids ids;
297  std::transform(
298  lanelets.begin(), lanelets.end(), std::back_inserter(ids),
299  [](const auto & lanelet) { return lanelet.id(); });
300  return ids;
301  }
302 
303  auto absoluteHull(
304  const lanelet::BasicPolygon2d & relative_hull, const lanelet::matching::Pose2d &) const
305  -> lanelet::BasicPolygon2d;
306 
307  auto calcEuclidDist(
308  const std::vector<double> & x, const std::vector<double> & y,
309  const std::vector<double> & z) const -> std::vector<double>;
310 
311  auto calculateAccumulatedLengths(const lanelet::ConstLineString3d &) const -> std::vector<double>;
312 
313  auto calculateSegmentDistances(const lanelet::ConstLineString3d &) const -> std::vector<double>;
314 
315  auto excludeSubtypeLanelets(
316  const std::vector<std::pair<double, lanelet::Lanelet>> &, const char subtype[]) const
317  -> std::vector<std::pair<double, lanelet::Lanelet>>;
318 
319  auto filterLanelets(const lanelet::Lanelets &, const char subtype[]) const -> lanelet::Lanelets;
320 
321  auto findNearestIndexPair(
322  const std::vector<double> & accumulated_lengths, const double target_length) const
323  -> std::pair<std::size_t, std::size_t>;
324 
325  auto generateFineCenterline(const lanelet::ConstLanelet &, const double resolution) const
326  -> lanelet::LineString3d;
327 
331  const double tangent_vector_size = 100) const -> math::geometry::HermiteCurve;
332 
333  auto getTrafficLightRegulatoryElementsOnPath(const lanelet::Ids &) const
334  -> std::vector<std::shared_ptr<const lanelet::autoware::AutowareTrafficLight>>;
335 
336  auto getTrafficLights(const lanelet::Id traffic_light_id) const
337  -> std::vector<lanelet::AutowareTrafficLightConstPtr>;
338 
339  auto getTrafficSignRegulatoryElementsOnPath(const lanelet::Ids &) const
340  -> std::vector<std::shared_ptr<const lanelet::TrafficSign>>;
341 
342  auto getTrafficSignRegulatoryElements() const
343  -> std::vector<std::shared_ptr<const lanelet::TrafficSign>>;
344 
345  auto getVectorFromPose(const geometry_msgs::msg::Pose &, const double magnitude) const
346  -> geometry_msgs::msg::Vector3;
347 
348  auto mapCallback(const autoware_map_msgs::msg::LaneletMapBin &) const -> void;
349 
350  auto overwriteLaneletsCenterline() -> void;
351 
352  auto resamplePoints(const lanelet::ConstLineString3d &, const std::int32_t num_segments) const
353  -> lanelet::BasicPoints3d;
354 
355  auto toPoint2d(const geometry_msgs::msg::Point &) const -> lanelet::BasicPoint2d;
356 
357  auto toPolygon(const lanelet::ConstLineString3d &) const
358  -> std::vector<geometry_msgs::msg::Point>;
359 };
360 } // namespace hdmap_utils
361 
362 #endif // TRAFFIC_SIMULATOR__HDMAP_UTILS__HDMAP_UTILS_HPP_
Definition: cache.hpp:67
Definition: hdmap_utils.hpp:64
auto getTangentVector(const lanelet::Id, const double s) const -> std::optional< geometry_msgs::msg::Vector3 >
Definition: hdmap_utils.cpp:910
auto getLongitudinalDistance(const traffic_simulator_msgs::msg::LaneletPose &from_pose, const traffic_simulator_msgs::msg::LaneletPose &to_pose, const traffic_simulator::RoutingConfiguration &routing_configuration=traffic_simulator::RoutingConfiguration()) const -> std::optional< double >
Definition: hdmap_utils.cpp:925
auto getRoute(const lanelet::Id from, const lanelet::Id to, const traffic_simulator::RoutingConfiguration &routing_configuration=traffic_simulator::RoutingConfiguration()) const -> lanelet::Ids
Definition: hdmap_utils.cpp:620
auto toMapPoints(const lanelet::Id, const std::vector< double > &s) const -> std::vector< geometry_msgs::msg::Point >
Definition: hdmap_utils.cpp:899
HdMapUtils(const boost::filesystem::path &, const geographic_msgs::msg::GeoPoint &)
Definition: hdmap_utils.cpp:65
auto isInIntersection(const lanelet::Id) const -> bool
Definition: hdmap_utils.cpp:889
auto getCenterPointsSpline(const lanelet::Id) const -> std::shared_ptr< math::geometry::CatmullRomSpline >
Definition: hdmap_utils.cpp:628
auto getDistanceToTrafficLightStopLine(const lanelet::Ids &route_lanelets, const math::geometry::CatmullRomSplineInterface &spline) const -> std::optional< double >
Definition: hdmap_utils.cpp:1277
auto getTrafficLightStopLinesPoints(const lanelet::Id traffic_light_id) const -> std::vector< std::vector< geometry_msgs::msg::Point >>
Definition: hdmap_utils.cpp:1219
auto getCollisionPointInLaneCoordinate(const lanelet::Id lanelet_id, const lanelet::Id crossing_lanelet_id) const -> std::optional< double >
Definition: hdmap_utils.cpp:226
auto getTrafficLightIds() const -> lanelet::Ids
Definition: hdmap_utils.cpp:688
auto getSpeedLimit(const lanelet::Ids &, const traffic_simulator::RoutingGraphType type=traffic_simulator::RoutingConfiguration().routing_graph_type) const -> double
Definition: hdmap_utils.cpp:443
auto getConflictingLaneIds(const lanelet::Ids &, const traffic_simulator::RoutingGraphType type=traffic_simulator::RoutingConfiguration().routing_graph_type) const -> lanelet::Ids
Definition: hdmap_utils.cpp:275
auto isInRoute(const lanelet::Id, const lanelet::Ids &route) const -> bool
Definition: hdmap_utils.cpp:533
auto canChangeLane(const lanelet::Id from, const lanelet::Id to, const traffic_simulator::RoutingGraphType type=traffic_simulator::RoutingConfiguration().routing_graph_type) const -> bool
Definition: hdmap_utils.cpp:916
auto getRightOfWayLaneletIds(const lanelet::Ids &) const -> std::unordered_map< lanelet::Id, lanelet::Ids >
Definition: hdmap_utils.cpp:1118
auto filterLaneletIds(const lanelet::Ids &, const char subtype[]) const -> lanelet::Ids
Definition: hdmap_utils.cpp:147
auto getLaneChangeTrajectory(const geometry_msgs::msg::Pose &from, const traffic_simulator::lane_change::Parameter &lane_change_parameter, const double maximum_curvature_threshold, const double target_trajectory_length, const double forward_distance_threshold) const -> std::optional< std::pair< math::geometry::HermiteCurve, double >>
Definition: hdmap_utils.cpp:797
auto getTrafficLightRegulatoryElement(const lanelet::Id) const -> lanelet::TrafficLight::Ptr
Definition: hdmap_utils.cpp:1468
auto getAltitude(const traffic_simulator_msgs::msg::LaneletPose &) const -> double
Definition: hdmap_utils.cpp:220
auto isTrafficLightRegulatoryElement(const lanelet::Id) const -> bool
Definition: hdmap_utils.cpp:1461
auto getTrafficLightBulbPosition(const lanelet::Id traffic_light_id, const std::string &) const -> std::optional< geometry_msgs::msg::Point >
Definition: hdmap_utils.cpp:707
auto clipTrajectoryFromLaneletIds(const lanelet::Id, const double s, const lanelet::Ids &, const double forward_distance=20) const -> std::vector< geometry_msgs::msg::Point >
Definition: hdmap_utils.cpp:313
auto getTrafficLightRegulatoryElementIDsFromTrafficLight(const lanelet::Id) const -> lanelet::Ids
Definition: hdmap_utils.cpp:1476
auto getTrafficLightIdsOnPath(const lanelet::Ids &route_lanelets) const -> lanelet::Ids
Definition: hdmap_utils.cpp:1241
auto isTrafficLight(const lanelet::Id) const -> bool
Definition: hdmap_utils.cpp:1447
auto getLaneletIds() const -> lanelet::Ids
Definition: hdmap_utils.cpp:122
auto getFollowingLanelets(const lanelet::Id current_lanelet_id, const lanelet::Ids &route, const double horizon=100, const bool include_current_lanelet_id=true, const traffic_simulator::RoutingGraphType type=traffic_simulator::RoutingConfiguration().routing_graph_type) const -> lanelet::Ids
Definition: hdmap_utils.cpp:538
auto generateMarker() const -> visualization_msgs::msg::MarkerArray
Definition: hdmap_utils.cpp:1020
auto getClosestLaneletId(const geometry_msgs::msg::Pose &, const double distance_thresh=30.0, const bool include_crosswalk=false) const -> std::optional< lanelet::Id >
Definition: hdmap_utils.cpp:411
auto getTrafficLightStopLineIds(const lanelet::Id traffic_light_id) const -> lanelet::Ids
Definition: hdmap_utils.cpp:1207
auto getCenterPoints(const lanelet::Ids &) const -> std::vector< geometry_msgs::msg::Point >
Definition: hdmap_utils.cpp:635
auto getLaneletPolygon(const lanelet::Id) const -> std::vector< geometry_msgs::msg::Point >
Definition: hdmap_utils.cpp:131
auto toMapBin() const -> autoware_map_msgs::msg::LaneletMapBin
Definition: hdmap_utils.cpp:997
auto getLaneChangeableLaneletId(const lanelet::Id, const traffic_simulator::lane_change::Direction, const traffic_simulator::RoutingGraphType type=traffic_simulator::RoutingConfiguration().routing_graph_type) const -> std::optional< lanelet::Id >
Definition: hdmap_utils.cpp:483
auto getPreviousLanelets(const lanelet::Id, const double backward_horizon=100, const traffic_simulator::RoutingGraphType type=traffic_simulator::RoutingConfiguration().routing_graph_type) const -> lanelet::Ids
Definition: hdmap_utils.cpp:507
auto getLanelets(const lanelet::Ids &) const -> lanelet::Lanelets
Definition: hdmap_utils.cpp:1438
auto isInLanelet(const lanelet::Id, const double s) const -> bool
Definition: hdmap_utils.cpp:894
auto getConflictingCrosswalkIds(const lanelet::Ids &) const -> lanelet::Ids
Definition: hdmap_utils.cpp:291
auto getNearbyLaneletIds(const geometry_msgs::msg::Point &, const double distance_threshold, const bool include_crosswalk, const std::size_t search_count=5) const -> lanelet::Ids
Definition: hdmap_utils.cpp:182
auto insertMarkerArray(visualization_msgs::msg::MarkerArray &, const visualization_msgs::msg::MarkerArray &) const -> void
Definition: hdmap_utils.cpp:1013
auto countLaneChanges(const traffic_simulator_msgs::msg::LaneletPose &from, const traffic_simulator_msgs::msg::LaneletPose &to, const traffic_simulator::RoutingConfiguration &routing_configuration=traffic_simulator::RoutingConfiguration()) const -> std::optional< std::pair< int, int >>
Definition: hdmap_utils.cpp:88
Definition: cache.hpp:109
Definition: cache.hpp:30
Definition: catmull_rom_spline_interface.hpp:30
Definition: sim_model_delay_steer_acc_geared_wo_fall_guard.hpp:26
Definition: cache.hpp:28
LaneletType
Definition: hdmap_utils.hpp:61
Definition: bounding_box.hpp:32
auto distance(const geometry_msgs::Pose &pose1, const geometry_msgs::Pose &pose2)
Definition: detection_sensor.cpp:38
Definition: lanelet_wrapper.hpp:40
TrajectoryShape
Definition: lane_change.hpp:31
Direction
Definition: lane_change.hpp:29
auto route(const lanelet::Id from_lanelet_id, const lanelet::Id to_lanelet_id, const RoutingConfiguration &routing_configuration=RoutingConfiguration()) -> lanelet::Ids
Definition: route.cpp:33
geometry_msgs::msg::Pose Pose
Definition: lanelet_wrapper.hpp:66
geometry_msgs::msg::Point Point
Definition: lanelet_wrapper.hpp:65
geometry_msgs::msg::Vector3 Vector3
Definition: lanelet_wrapper.hpp:69
RoutingGraphType
Definition: routing_graph_type.hpp:24
traffic_simulator_msgs::msg::LaneletPose LaneletPose
Definition: lanelet_pose.hpp:23
std::string string
Definition: junit5.hpp:26
lanelet::traffic_rules::TrafficRulesPtr rules
Definition: hdmap_utils.hpp:264
RouteCache route_cache
Definition: hdmap_utils.hpp:266
lanelet::routing::RoutingGraphPtr graph
Definition: hdmap_utils.hpp:265
Definition: routing_configuration.hpp:24
parameters for behavior plugin
Definition: lane_change.hpp:75