scenario_simulator_v2 C++ API
hdmap_utils::HdMapUtils Member List

This is the complete list of members for hdmap_utils::HdMapUtils, including all inherited members.

canChangeLane(const lanelet::Id from, const lanelet::Id to) const -> boolhdmap_utils::HdMapUtils
canonicalizeLaneletPose(const traffic_simulator_msgs::msg::LaneletPose &) const -> std::tuple< std::optional< traffic_simulator_msgs::msg::LaneletPose >, std::optional< lanelet::Id >>hdmap_utils::HdMapUtils
canonicalizeLaneletPose(const traffic_simulator_msgs::msg::LaneletPose &, const lanelet::Ids &route_lanelets) const -> std::tuple< std::optional< traffic_simulator_msgs::msg::LaneletPose >, std::optional< lanelet::Id >>hdmap_utils::HdMapUtils
clipTrajectoryFromLaneletIds(const lanelet::Id, const double s, const lanelet::Ids &, const double forward_distance=20) const -> std::vector< geometry_msgs::msg::Point >hdmap_utils::HdMapUtils
countLaneChanges(const traffic_simulator_msgs::msg::LaneletPose &from, const traffic_simulator_msgs::msg::LaneletPose &to, bool allow_lane_change) const -> std::optional< std::pair< int, int >>hdmap_utils::HdMapUtils
filterLaneletIds(const lanelet::Ids &, const char subtype[]) const -> lanelet::Idshdmap_utils::HdMapUtils
generateMarker() const -> visualization_msgs::msg::MarkerArrayhdmap_utils::HdMapUtils
getAllCanonicalizedLaneletPoses(const traffic_simulator_msgs::msg::LaneletPose &) const -> std::vector< traffic_simulator_msgs::msg::LaneletPose >hdmap_utils::HdMapUtils
getAlongLaneletPose(const traffic_simulator_msgs::msg::LaneletPose &from, const double along) const -> traffic_simulator_msgs::msg::LaneletPosehdmap_utils::HdMapUtils
getCenterPoints(const lanelet::Ids &) const -> std::vector< geometry_msgs::msg::Point >hdmap_utils::HdMapUtils
getCenterPoints(const lanelet::Id) const -> std::vector< geometry_msgs::msg::Point >hdmap_utils::HdMapUtils
getCenterPointsSpline(const lanelet::Id) const -> std::shared_ptr< math::geometry::CatmullRomSpline >hdmap_utils::HdMapUtils
getClosestLaneletId(const geometry_msgs::msg::Pose &, const double distance_thresh=30.0, const bool include_crosswalk=false) const -> std::optional< lanelet::Id >hdmap_utils::HdMapUtils
getCollisionPointInLaneCoordinate(const lanelet::Id lanelet_id, const lanelet::Id crossing_lanelet_id) const -> std::optional< double >hdmap_utils::HdMapUtils
getConflictingCrosswalkIds(const lanelet::Ids &) const -> lanelet::Idshdmap_utils::HdMapUtils
getConflictingLaneIds(const lanelet::Ids &) const -> lanelet::Idshdmap_utils::HdMapUtils
getDistanceToStopLine(const lanelet::Ids &route_lanelets, const math::geometry::CatmullRomSplineInterface &spline) const -> std::optional< double >hdmap_utils::HdMapUtils
getDistanceToStopLine(const lanelet::Ids &route_lanelets, const std::vector< geometry_msgs::msg::Point > &waypoints) const -> std::optional< double >hdmap_utils::HdMapUtils
getDistanceToTrafficLightStopLine(const lanelet::Ids &route_lanelets, const math::geometry::CatmullRomSplineInterface &spline) const -> std::optional< double >hdmap_utils::HdMapUtils
getDistanceToTrafficLightStopLine(const lanelet::Ids &route_lanelets, const std::vector< geometry_msgs::msg::Point > &waypoints) const -> std::optional< double >hdmap_utils::HdMapUtils
getDistanceToTrafficLightStopLine(const math::geometry::CatmullRomSplineInterface &spline, const lanelet::Id traffic_light_id) const -> std::optional< double >hdmap_utils::HdMapUtils
getDistanceToTrafficLightStopLine(const std::vector< geometry_msgs::msg::Point > &waypoints, const lanelet::Id traffic_light_id) const -> std::optional< double >hdmap_utils::HdMapUtils
getFollowingLanelets(const lanelet::Id current_lanelet_id, const lanelet::Ids &route, const double horizon=100, const bool include_current_lanelet_id=true) const -> lanelet::Idshdmap_utils::HdMapUtils
getFollowingLanelets(const lanelet::Id, const double distance=100, const bool include_self=true) const -> lanelet::Idshdmap_utils::HdMapUtils
getHeight(const traffic_simulator_msgs::msg::LaneletPose &) const -> doublehdmap_utils::HdMapUtils
getLaneChangeableLaneletId(const lanelet::Id, const traffic_simulator::lane_change::Direction) const -> std::optional< lanelet::Id >hdmap_utils::HdMapUtils
getLaneChangeableLaneletId(const lanelet::Id, const traffic_simulator::lane_change::Direction, const std::uint8_t shift) const -> std::optional< lanelet::Id >hdmap_utils::HdMapUtils
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 >>hdmap_utils::HdMapUtils
getLaneChangeTrajectory(const traffic_simulator_msgs::msg::LaneletPose &from, const traffic_simulator::lane_change::Parameter &lane_change_parameter) const -> std::optional< std::pair< math::geometry::HermiteCurve, double >>hdmap_utils::HdMapUtils
getLaneletIds() const -> lanelet::Idshdmap_utils::HdMapUtils
getLaneletLength(const lanelet::Id) const -> doublehdmap_utils::HdMapUtils
getLaneletPolygon(const lanelet::Id) const -> std::vector< geometry_msgs::msg::Point >hdmap_utils::HdMapUtils
getLanelets(const lanelet::Ids &) const -> lanelet::Laneletshdmap_utils::HdMapUtils
getLateralDistance(const traffic_simulator_msgs::msg::LaneletPose &from, const traffic_simulator_msgs::msg::LaneletPose &to, bool allow_lane_change=false) const -> std::optional< double >hdmap_utils::HdMapUtils
getLeftBound(const lanelet::Id) const -> std::vector< geometry_msgs::msg::Point >hdmap_utils::HdMapUtils
getLeftLaneletIds(const lanelet::Id, const traffic_simulator::RoutingGraphType, const bool include_opposite_direction=true) const -> lanelet::Idshdmap_utils::HdMapUtils
getLongitudinalDistance(const traffic_simulator_msgs::msg::LaneletPose &from_pose, const traffic_simulator_msgs::msg::LaneletPose &to_pose, const bool allow_lane_change=false) const -> std::optional< double >hdmap_utils::HdMapUtils
getNearbyLaneletIds(const geometry_msgs::msg::Point &, const double distance_threshold, const bool include_crosswalk, const std::size_t search_count=5) const -> lanelet::Idshdmap_utils::HdMapUtils
getNearbyLaneletIds(const geometry_msgs::msg::Point &, const double distance_threshold, const std::size_t search_count=5) const -> lanelet::Idshdmap_utils::HdMapUtils
getNextLaneletIds(const lanelet::Ids &) const -> lanelet::Idshdmap_utils::HdMapUtils
getNextLaneletIds(const lanelet::Ids &, const std::string &turn_direction, const traffic_simulator::RoutingGraphType type=traffic_simulator::RoutingGraphType::VEHICLE) const -> lanelet::Idshdmap_utils::HdMapUtils
getNextLaneletIds(const lanelet::Id) const -> lanelet::Idshdmap_utils::HdMapUtils
getNextLaneletIds(const lanelet::Id, const std::string &turn_direction, const traffic_simulator::RoutingGraphType type=traffic_simulator::RoutingGraphType::VEHICLE) const -> lanelet::Idshdmap_utils::HdMapUtils
getPreviousLaneletIds(const lanelet::Ids &) const -> lanelet::Idshdmap_utils::HdMapUtils
getPreviousLaneletIds(const lanelet::Ids &, const std::string &turn_direction, const traffic_simulator::RoutingGraphType type=traffic_simulator::RoutingGraphType::VEHICLE) const -> lanelet::Idshdmap_utils::HdMapUtils
getPreviousLaneletIds(const lanelet::Id) const -> lanelet::Idshdmap_utils::HdMapUtils
getPreviousLaneletIds(const lanelet::Id, const std::string &turn_direction, const traffic_simulator::RoutingGraphType type=traffic_simulator::RoutingGraphType::VEHICLE) const -> lanelet::Idshdmap_utils::HdMapUtils
getPreviousLanelets(const lanelet::Id, const double backward_horizon=100) const -> lanelet::Idshdmap_utils::HdMapUtils
getRightBound(const lanelet::Id) const -> std::vector< geometry_msgs::msg::Point >hdmap_utils::HdMapUtils
getRightLaneletIds(const lanelet::Id, const traffic_simulator::RoutingGraphType, const bool include_opposite_direction=true) const -> lanelet::Idshdmap_utils::HdMapUtils
getRightOfWayLaneletIds(const lanelet::Ids &) const -> std::unordered_map< lanelet::Id, lanelet::Ids >hdmap_utils::HdMapUtils
getRightOfWayLaneletIds(const lanelet::Id) const -> lanelet::Idshdmap_utils::HdMapUtils
getRoute(const lanelet::Id from, const lanelet::Id to, bool allow_lane_change=false) const -> lanelet::Idshdmap_utils::HdMapUtils
getSpeedLimit(const lanelet::Ids &) const -> doublehdmap_utils::HdMapUtils
getStopLineIds() const -> lanelet::Idshdmap_utils::HdMapUtils
getStopLineIdsOnPath(const lanelet::Ids &route_lanelets) const -> lanelet::Idshdmap_utils::HdMapUtils
getStopLinePolygon(const lanelet::Id) const -> std::vector< geometry_msgs::msg::Point >hdmap_utils::HdMapUtils
getTangentVector(const lanelet::Id, const double s) const -> std::optional< geometry_msgs::msg::Vector3 >hdmap_utils::HdMapUtils
getTrafficLightBulbPosition(const lanelet::Id traffic_light_id, const std::string &) const -> std::optional< geometry_msgs::msg::Point >hdmap_utils::HdMapUtils
getTrafficLightIds() const -> lanelet::Idshdmap_utils::HdMapUtils
getTrafficLightIdsOnPath(const lanelet::Ids &route_lanelets) const -> lanelet::Idshdmap_utils::HdMapUtils
getTrafficLightRegulatoryElement(const lanelet::Id) const -> lanelet::TrafficLight::Ptrhdmap_utils::HdMapUtils
getTrafficLightRegulatoryElementIDsFromTrafficLight(const lanelet::Id) const -> lanelet::Idshdmap_utils::HdMapUtils
getTrafficLightStopLineIds(const lanelet::Id traffic_light_id) const -> lanelet::Idshdmap_utils::HdMapUtils
getTrafficLightStopLinesPoints(const lanelet::Id traffic_light_id) const -> std::vector< std::vector< geometry_msgs::msg::Point >>hdmap_utils::HdMapUtils
HdMapUtils(const boost::filesystem::path &, const geographic_msgs::msg::GeoPoint &)hdmap_utils::HdMapUtilsexplicit
insertMarkerArray(visualization_msgs::msg::MarkerArray &, const visualization_msgs::msg::MarkerArray &) const -> voidhdmap_utils::HdMapUtils
isInLanelet(const lanelet::Id, const double s) const -> boolhdmap_utils::HdMapUtils
isInRoute(const lanelet::Id, const lanelet::Ids &route) const -> boolhdmap_utils::HdMapUtils
isTrafficLight(const lanelet::Id) const -> boolhdmap_utils::HdMapUtils
isTrafficLightRegulatoryElement(const lanelet::Id) const -> boolhdmap_utils::HdMapUtils
matchToLane(const geometry_msgs::msg::Pose &, const traffic_simulator_msgs::msg::BoundingBox &, const bool include_crosswalk, const double matching_distance=1.0, const double reduction_ratio=0.8) const -> std::optional< lanelet::Id >hdmap_utils::HdMapUtils
toLaneletPose(const geometry_msgs::msg::Pose &, const bool include_crosswalk, const double matching_distance=1.0) const -> std::optional< traffic_simulator_msgs::msg::LaneletPose >hdmap_utils::HdMapUtils
toLaneletPose(const geometry_msgs::msg::Pose &, const lanelet::Ids &, const double matching_distance=1.0) const -> std::optional< traffic_simulator_msgs::msg::LaneletPose >hdmap_utils::HdMapUtils
toLaneletPose(const geometry_msgs::msg::Point &, const traffic_simulator_msgs::msg::BoundingBox &, const bool include_crosswalk, const double matching_distance=1.0) const -> std::optional< traffic_simulator_msgs::msg::LaneletPose >hdmap_utils::HdMapUtils
toLaneletPose(const geometry_msgs::msg::Pose &, const traffic_simulator_msgs::msg::BoundingBox &, const bool include_crosswalk, const double matching_distance=1.0) const -> std::optional< traffic_simulator_msgs::msg::LaneletPose >hdmap_utils::HdMapUtils
toLaneletPose(const geometry_msgs::msg::Pose &, const lanelet::Id, const double matching_distance=1.0) const -> std::optional< traffic_simulator_msgs::msg::LaneletPose >hdmap_utils::HdMapUtils
toLaneletPoses(const geometry_msgs::msg::Pose &, const lanelet::Id, const double matching_distance=5.0, const bool include_opposite_direction=true) const -> std::vector< traffic_simulator_msgs::msg::LaneletPose >hdmap_utils::HdMapUtils
toMapBin() const -> autoware_auto_mapping_msgs::msg::HADMapBinhdmap_utils::HdMapUtils
toMapPoints(const lanelet::Id, const std::vector< double > &s) const -> std::vector< geometry_msgs::msg::Point >hdmap_utils::HdMapUtils
toMapPose(const traffic_simulator_msgs::msg::LaneletPose &, const bool fill_pitch=true) const -> geometry_msgs::msg::PoseStampedhdmap_utils::HdMapUtils