#include <action_node.hpp>
|
| ActionNode (const std::string &name, const BT::NodeConfiguration &config) |
|
| ~ActionNode () override=default |
|
auto | foundConflictingEntity (const lanelet::Ids &following_lanelets) const -> bool |
|
auto | getDistanceToConflictingEntity (const lanelet::Ids &route_lanelets, const math::geometry::CatmullRomSplineInterface &spline) const -> std::optional< double > |
|
auto | getFrontEntityName (const math::geometry::CatmullRomSplineInterface &spline) const -> std::optional< std::string > |
|
auto | calculateStopDistance (const traffic_simulator_msgs::msg::DynamicConstraints &) const -> double |
|
auto | getDistanceToFrontEntity (const math::geometry::CatmullRomSplineInterface &spline) const -> std::optional< double > |
|
auto | getDistanceToStopLine (const lanelet::Ids &route_lanelets, const std::vector< geometry_msgs::msg::Point > &waypoints) const -> std::optional< double > |
|
auto | getDistanceToTrafficLightStopLine (const lanelet::Ids &route_lanelets, const math::geometry::CatmullRomSplineInterface &spline) const -> std::optional< double > |
|
auto | getRightOfWayEntities () const -> std::vector< traffic_simulator::CanonicalizedEntityStatus > |
|
auto | getRightOfWayEntities (const lanelet::Ids &following_lanelets) const -> std::vector< traffic_simulator::CanonicalizedEntityStatus > |
|
auto | getYieldStopDistance (const lanelet::Ids &following_lanelets) const -> std::optional< double > |
|
auto | getOtherEntityStatus (lanelet::Id lanelet_id) const -> std::vector< traffic_simulator::CanonicalizedEntityStatus > |
|
auto | stopEntity () const -> void |
|
auto | getHorizon () const -> double |
|
auto | executeTick () -> BT::NodeStatus override |
| throws if the derived class return RUNNING. More...
|
|
void | halt () override final |
|
auto | getBlackBoardValues () -> void |
|
auto | getEntityStatus (const std::string &target_name) const -> const traffic_simulator::CanonicalizedEntityStatus & |
|
auto | getDistanceToTargetEntityPolygon (const math::geometry::CatmullRomSplineInterface &spline, const std::string target_name, double width_extension_right=0.0, double width_extension_left=0.0, double length_extension_front=0.0, double length_extension_rear=0.0) const -> std::optional< double > |
|
auto | setCanonicalizedEntityStatus (const traffic_simulator::EntityStatus &entity_status) -> void |
|
auto | calculateUpdatedEntityStatus (double target_speed, const traffic_simulator_msgs::msg::DynamicConstraints &) const -> traffic_simulator::EntityStatus |
|
auto | calculateUpdatedEntityStatusInWorldFrame (double target_speed, const traffic_simulator_msgs::msg::DynamicConstraints &) const -> traffic_simulator::EntityStatus |
|
◆ ActionNode()
entity_behavior::ActionNode::ActionNode |
( |
const std::string & |
name, |
|
|
const BT::NodeConfiguration & |
config |
|
) |
| |
◆ ~ActionNode()
entity_behavior::ActionNode::~ActionNode |
( |
| ) |
|
|
overridedefault |
◆ calculateStopDistance()
auto entity_behavior::ActionNode::calculateStopDistance |
( |
const traffic_simulator_msgs::msg::DynamicConstraints & |
constraints | ) |
const -> double |
◆ calculateUpdatedEntityStatus()
auto entity_behavior::ActionNode::calculateUpdatedEntityStatus |
( |
double |
target_speed, |
|
|
const traffic_simulator_msgs::msg::DynamicConstraints & |
constraints |
|
) |
| const -> traffic_simulator::EntityStatus |
◆ calculateUpdatedEntityStatusInWorldFrame()
auto entity_behavior::ActionNode::calculateUpdatedEntityStatusInWorldFrame |
( |
double |
target_speed, |
|
|
const traffic_simulator_msgs::msg::DynamicConstraints & |
constraints |
|
) |
| const -> traffic_simulator::EntityStatus |
◆ executeTick()
auto entity_behavior::ActionNode::executeTick |
( |
| ) |
-> BT::NodeStatus |
|
override |
throws if the derived class return RUNNING.
◆ foundConflictingEntity()
auto entity_behavior::ActionNode::foundConflictingEntity |
( |
const lanelet::Ids & |
following_lanelets | ) |
const -> bool |
◆ getBlackBoardValues()
auto entity_behavior::ActionNode::getBlackBoardValues |
( |
| ) |
-> void |
◆ getDistanceToConflictingEntity()
◆ getDistanceToFrontEntity()
◆ getDistanceToStopLine()
auto entity_behavior::ActionNode::getDistanceToStopLine |
( |
const lanelet::Ids & |
route_lanelets, |
|
|
const std::vector< geometry_msgs::msg::Point > & |
waypoints |
|
) |
| const -> std::optional<double> |
◆ getDistanceToTargetEntityPolygon()
auto entity_behavior::ActionNode::getDistanceToTargetEntityPolygon |
( |
const math::geometry::CatmullRomSplineInterface & |
spline, |
|
|
const std::string |
target_name, |
|
|
double |
width_extension_right = 0.0 , |
|
|
double |
width_extension_left = 0.0 , |
|
|
double |
length_extension_front = 0.0 , |
|
|
double |
length_extension_rear = 0.0 |
|
) |
| const -> std::optional<double> |
◆ getDistanceToTrafficLightStopLine()
◆ getEntityStatus()
◆ getFrontEntityName()
- Note
- hard-coded parameter, if the Yaw value of RPY is in ~1.5708 -> 1.5708, entity is a candidate of front entity.
◆ getHorizon()
auto entity_behavior::ActionNode::getHorizon |
( |
| ) |
const -> double |
◆ getOtherEntityStatus()
◆ getRightOfWayEntities() [1/2]
◆ getRightOfWayEntities() [2/2]
◆ getYieldStopDistance()
auto entity_behavior::ActionNode::getYieldStopDistance |
( |
const lanelet::Ids & |
following_lanelets | ) |
const -> std::optional<double> |
◆ halt()
void entity_behavior::ActionNode::halt |
( |
| ) |
|
|
inlinefinaloverride |
◆ providedPorts()
static BT::PortsList entity_behavior::ActionNode::providedPorts |
( |
| ) |
|
|
inlinestatic |
◆ setCanonicalizedEntityStatus()
◆ stopEntity()
auto entity_behavior::ActionNode::stopEntity |
( |
| ) |
const -> void |
◆ canonicalized_entity_status
◆ current_time
double entity_behavior::ActionNode::current_time |
|
protected |
◆ default_matching_distance_for_lanelet_pose_calculation
double entity_behavior::ActionNode::default_matching_distance_for_lanelet_pose_calculation |
|
protected |
◆ hdmap_utils
◆ other_entity_status
◆ request
◆ route_lanelets
lanelet::Ids entity_behavior::ActionNode::route_lanelets |
|
protected |
◆ step_time
double entity_behavior::ActionNode::step_time |
|
protected |
◆ target_speed
std::optional<double> entity_behavior::ActionNode::target_speed |
|
protected |
◆ traffic_lights
The documentation for this class was generated from the following files: