15 #ifndef TRAFFIC_SIMULATOR__LANELET_WRAPPER_HPP_
16 #define TRAFFIC_SIMULATOR__LANELET_WRAPPER_HPP_
18 #include <lanelet2_routing/RoutingGraph.h>
19 #include <lanelet2_routing/RoutingGraphContainer.h>
20 #include <lanelet2_traffic_rules/TrafficRulesFactory.h>
22 #include <autoware_lanelet2_extension/utility/utilities.hpp>
26 #include <geometry_msgs/msg/point.hpp>
27 #include <geometry_msgs/msg/pose.hpp>
28 #include <geometry_msgs/msg/pose_stamped.hpp>
29 #include <geometry_msgs/msg/vector3.hpp>
35 #include <traffic_simulator_msgs/msg/bounding_box.hpp>
36 #include <traffic_simulator_msgs/msg/entity_type.hpp>
37 #include <traffic_simulator_msgs/msg/lanelet_pose.hpp>
42 struct hash<
std::tuple<lanelet::Id, lanelet::Id, bool>>
45 size_t operator()(
const std::tuple<lanelet::Id, lanelet::Id, bool> & data)
const
47 std::hash<lanelet::Id> lanelet_id_hash;
50 seed ^= lanelet_id_hash(std::get<0>(data)) + 0x9e3779b9 + (seed << 6) + (seed >> 2);
51 seed ^= lanelet_id_hash(std::get<1>(data)) + 0x9e3779b9 + (seed << 6) + (seed >> 2);
52 seed ^= std::hash<bool>{}(std::get<2>(data)) + 0x9e3779b9 + (seed << 6) + (seed >> 2);
60 namespace lanelet_wrapper
76 const lanelet::Id from_lanelet_id,
const lanelet::Id to_lanelet_id,
78 const lanelet::routing::RoutingGraphConstPtr & routing_graph) -> lanelet::Ids
80 if (!exists(from_lanelet_id, to_lanelet_id, routing_configuration.allow_lane_change)) {
82 constexpr
int routing_cost_id = 0;
83 const auto & from_lanelet = lanelet_map->laneletLayer.get(from_lanelet_id);
84 const auto & to_lanelet = lanelet_map->laneletLayer.get(to_lanelet_id);
85 if (
const auto route = routing_graph->getRoute(
86 from_lanelet, to_lanelet, routing_cost_id, routing_configuration.allow_lane_change);
89 from_lanelet_id, to_lanelet_id, routing_configuration.allow_lane_change, lanelet::Ids());
91 lanelet::Ids shortest_path_ids;
92 for (
const auto & lanelet :
route->shortestPath()) {
93 shortest_path_ids.push_back(lanelet.id());
96 from_lanelet_id, to_lanelet_id, routing_configuration.allow_lane_change,
100 return readData(from_lanelet_id, to_lanelet_id, routing_configuration.allow_lane_change);
103 auto getRoute(
const lanelet::Id from,
const lanelet::Id to,
const bool allow_lane_change)
106 if (!exists(from, to, allow_lane_change)) {
108 "route from : ", from,
" to : ", to, (allow_lane_change ?
" with" :
" without"),
109 " lane change does not exists on route cache.");
111 return readData(from, to, allow_lane_change);
116 auto exists(
const lanelet::Id from,
const lanelet::Id to,
const bool allow_lane_change) ->
bool
118 std::lock_guard lock(mutex_);
119 std::tuple<lanelet::Id, lanelet::Id, bool> key = {from, to, allow_lane_change};
120 return data_.find(key) != data_.end();
123 auto readData(
const lanelet::Id from,
const lanelet::Id to,
const bool allow_lane_change)
126 std::lock_guard lock(mutex_);
127 return data_.at({from, to, allow_lane_change});
131 const lanelet::Id from,
const lanelet::Id to,
const bool allow_lane_change,
132 const lanelet::Ids &
route) ->
void
134 std::lock_guard lock(mutex_);
135 data_[{from, to, allow_lane_change}] =
route;
138 std::unordered_map<std::tuple<lanelet::Id, lanelet::Id, bool>, lanelet::Ids> data_;
147 if (!exists(lanelet_id)) {
150 return readData(lanelet_id);
155 if (!exists(lanelet_id)) {
158 return readDataSpline(lanelet_id);
161 auto getCenterPoints(
const lanelet::Id lanelet_id,
const lanelet::LaneletMapPtr & lanelet_map)
162 -> std::vector<Point>
164 if (!exists(lanelet_id)) {
165 appendData(lanelet_id,
centerPoints(lanelet_id, lanelet_map));
167 return readData(lanelet_id);
171 const lanelet::Id lanelet_id,
const lanelet::LaneletMapPtr & lanelet_map)
172 -> std::shared_ptr<Spline>
174 if (!exists(lanelet_id)) {
175 appendData(lanelet_id,
centerPoints(lanelet_id, lanelet_map));
177 return readDataSpline(lanelet_id);
181 auto exists(
const lanelet::Id lanelet_id) ->
bool
183 std::lock_guard lock(mutex_);
184 return data_.find(lanelet_id) != data_.end();
187 auto readData(
const lanelet::Id lanelet_id) -> std::vector<Point>
189 std::lock_guard lock(mutex_);
190 return data_.at(lanelet_id);
193 auto readDataSpline(
const lanelet::Id lanelet_id) -> std::shared_ptr<Spline>
195 std::lock_guard lock(mutex_);
196 return splines_.at(lanelet_id);
199 auto appendData(
const lanelet::Id lanelet_id,
const std::vector<Point> &
route) ->
void
201 std::lock_guard lock(mutex_);
202 data_[lanelet_id] =
route;
203 splines_[lanelet_id] = std::make_shared<Spline>(
route);
206 auto centerPoints(
const lanelet::Id lanelet_id,
const lanelet::LaneletMapPtr & lanelet_map)
const
207 -> std::vector<Point>
209 std::vector<Point> center_points;
210 for (
const auto & point : lanelet_map->laneletLayer.get(lanelet_id).centerline()) {
211 center_points.push_back(geometry_msgs::build<Point>().x(point.x()).y(point.y()).z(point.z()));
213 if (center_points.size() == 2) {
214 const auto p0 = center_points[0];
215 const auto p2 = center_points[1];
216 const auto p1 = geometry_msgs::build<Point>()
217 .x((p0.x + p2.x) * 0.5)
218 .y((p0.y + p2.y) * 0.5)
219 .z((p0.z + p2.z) * 0.5);
220 center_points.clear();
221 center_points.push_back(p0);
222 center_points.push_back(p1);
223 center_points.push_back(p2);
225 return center_points;
228 std::unordered_map<lanelet::Id, std::vector<Point>> data_;
229 std::unordered_map<lanelet::Id, std::shared_ptr<Spline>> splines_;
238 if (!exists(lanelet_id)) {
241 return readData(lanelet_id);
244 auto getLength(
const lanelet::Id lanelet_id,
const lanelet::LaneletMapPtr & lanelet_map) ->
double
246 if (!exists(lanelet_id)) {
248 lanelet_id, lanelet::utils::getLaneletLength2d(lanelet_map->laneletLayer.get(lanelet_id)));
250 return readData(lanelet_id);
254 auto exists(
const lanelet::Id lanelet_id) ->
bool
256 std::lock_guard lock(mutex_);
257 return data_.find(lanelet_id) != data_.end();
260 auto readData(
const lanelet::Id lanelet_id) ->
double
262 std::lock_guard lock(mutex_);
263 return data_.at(lanelet_id);
266 auto appendData(
const lanelet::Id lanelet_id,
double length) ->
void
268 std::lock_guard lock(mutex_);
269 data_[lanelet_id] = length;
272 std::unordered_map<lanelet::Id, double> data_;
278 lanelet::traffic_rules::TrafficRulesPtr
rules;
279 lanelet::routing::RoutingGraphConstPtr
graph;
283 const lanelet::LaneletMapPtr lanelet_map_ptr,
const std::string & locations,
286 rules = lanelet::traffic_rules::TrafficRulesFactory::create(locations, participants);
287 graph = lanelet::routing::RoutingGraph::build(*lanelet_map_ptr, *
rules);
296 [[nodiscard]]
static auto map() -> lanelet::LaneletMapPtr;
298 -> lanelet::routing::RoutingGraphConstPtr;
300 -> lanelet::traffic_rules::TrafficRulesPtr;
307 explicit LaneletWrapper(
const std::filesystem::path & lanelet_map_path);
310 inline static std::unique_ptr<LaneletWrapper> instance{
nullptr};
312 inline static std::mutex mutex_;
314 const lanelet::LaneletMapPtr lanelet_map_ptr_;
Definition: catmull_rom_spline_interface.hpp:30
Definition: catmull_rom_spline.hpp:32
Definition: lanelet_wrapper.hpp:143
auto getCenterPointsSpline(const lanelet::Id lanelet_id, const lanelet::LaneletMapPtr &lanelet_map) -> std::shared_ptr< Spline >
Definition: lanelet_wrapper.hpp:170
auto centerPointsSpline(lanelet::Id lanelet_id) -> decltype(auto)
Definition: lanelet_wrapper.hpp:153
auto centerPoints(lanelet::Id lanelet_id) -> decltype(auto)
Definition: lanelet_wrapper.hpp:145
auto getCenterPoints(const lanelet::Id lanelet_id, const lanelet::LaneletMapPtr &lanelet_map) -> std::vector< Point >
Definition: lanelet_wrapper.hpp:161
Definition: lanelet_wrapper.hpp:234
auto getLength(lanelet::Id lanelet_id)
Definition: lanelet_wrapper.hpp:236
auto getLength(const lanelet::Id lanelet_id, const lanelet::LaneletMapPtr &lanelet_map) -> double
Definition: lanelet_wrapper.hpp:244
Definition: lanelet_wrapper.hpp:292
static auto routingGraph(const RoutingGraphType type) -> lanelet::routing::RoutingGraphConstPtr
Definition: lanelet_wrapper.cpp:34
static auto centerPointsCache() -> CenterPointsCache &
Definition: lanelet_wrapper.cpp:84
static auto routeCache(const RoutingGraphType type) -> RouteCache &
Definition: lanelet_wrapper.cpp:68
static auto activate(const std::string &lanelet_map_path) -> void
Definition: lanelet_wrapper.cpp:23
static auto map() -> lanelet::LaneletMapPtr
Definition: lanelet_wrapper.cpp:32
static auto laneletLengthCache() -> LaneletLengthCache &
Definition: lanelet_wrapper.cpp:89
static auto trafficRules(const RoutingGraphType type) -> lanelet::traffic_rules::TrafficRulesPtr
Definition: lanelet_wrapper.cpp:51
Definition: lanelet_wrapper.hpp:73
auto getRoute(const lanelet::Id from_lanelet_id, const lanelet::Id to_lanelet_id, const lanelet::LaneletMapPtr &lanelet_map, const RoutingConfiguration &routing_configuration, const lanelet::routing::RoutingGraphConstPtr &routing_graph) -> lanelet::Ids
Definition: lanelet_wrapper.hpp:75
auto getRoute(const lanelet::Id from, const lanelet::Id to, const bool allow_lane_change) -> decltype(auto)
Definition: lanelet_wrapper.hpp:103
#define THROW_SIMULATION_ERROR(...)
Definition: exception.hpp:60
Definition: lanelet_wrapper.hpp:40
geometry_msgs::msg::Pose Pose
Definition: lanelet_wrapper.hpp:66
traffic_simulator_msgs::msg::BoundingBox BoundingBox
Definition: lanelet_wrapper.hpp:62
traffic_simulator_msgs::msg::LaneletPose LaneletPose
Definition: lanelet_wrapper.hpp:64
geometry_msgs::msg::Point Point
Definition: lanelet_wrapper.hpp:65
traffic_simulator_msgs::msg::EntityType EntityType
Definition: lanelet_wrapper.hpp:63
geometry_msgs::msg::PoseStamped PoseStamped
Definition: lanelet_wrapper.hpp:67
geometry_msgs::msg::Vector3 Vector3
Definition: lanelet_wrapper.hpp:69
auto route(Ts &&... xs)
Definition: route.hpp:30
RoutingGraphType
Definition: routing_graph_type.hpp:24
std::string string
Definition: junit5.hpp:26
traffic_simulator_msgs::EntityType EntityType
Definition: helper_functions.hpp:31
size_t operator()(const std::tuple< lanelet::Id, lanelet::Id, bool > &data) const
Definition: lanelet_wrapper.hpp:45
Definition: routing_configuration.hpp:24
Definition: lanelet_wrapper.hpp:277
RouteCache route_cache
Definition: lanelet_wrapper.hpp:280
TrafficRulesWithRoutingGraph(const lanelet::LaneletMapPtr lanelet_map_ptr, const std::string &locations, const std::string &participants)
Definition: lanelet_wrapper.hpp:282
lanelet::traffic_rules::TrafficRulesPtr rules
Definition: lanelet_wrapper.hpp:278
lanelet::routing::RoutingGraphConstPtr graph
Definition: lanelet_wrapper.hpp:279