Carma-platform v4.2.0
CARMA Platform is built on robot operating system (ROS) and utilizes open source software (OSS) that enables Cooperative Driving Automation (CDA) features to allow Automated Driving Systems to interact and cooperate with infrastructure and other vehicles through communication.
|
#include <arbitrator_node.hpp>
Public Member Functions | |
ArbitratorNode (const rclcpp::NodeOptions &options) | |
Constructor. More... | |
carma_ros2_utils::CallbackReturn | handle_on_configure (const rclcpp_lifecycle::State &) |
carma_ros2_utils::CallbackReturn | handle_on_activate (const rclcpp_lifecycle::State &) |
Private Member Functions | |
std::map< std::string, double > | plugin_priorities_map_from_json (const std::string &json_string) |
Private Attributes | |
carma_ros2_utils::SubPtr< geometry_msgs::msg::TwistStamped > | twist_sub_ |
Config | config_ |
std::shared_ptr< carma_wm::WMListener > | wm_listener_ |
carma_wm::WorldModelConstPtr | wm_ |
std::shared_ptr< Arbitrator > | arbitrator_ |
rclcpp::TimerBase::SharedPtr | bumper_pose_timer_ |
rclcpp::TimerBase::SharedPtr | arbitrator_run_ |
An arbitrator node instance with currently used configuration/planning paradigms
Governs the interactions of plugins during the maneuver planning phase of the CARMA planning process by internally using a worker class with generic planning interface.
Definition at line 49 of file arbitrator_node.hpp.
|
explicit |
Constructor.
Definition at line 22 of file arbitrator_node.cpp.
References arbitrator::Config::beam_width, config_, arbitrator::Config::min_plan_duration, arbitrator::Config::planning_frequency, arbitrator::Config::plugin_priorities, plugin_priorities_map_from_json(), arbitrator::Config::target_plan_duration, and arbitrator::Config::use_fixed_costs.
carma_ros2_utils::CallbackReturn arbitrator::ArbitratorNode::handle_on_activate | ( | const rclcpp_lifecycle::State & | ) |
Definition at line 96 of file arbitrator_node.cpp.
References arbitrator_, arbitrator_run_, bumper_pose_timer_, config_, and arbitrator::Config::planning_frequency.
carma_ros2_utils::CallbackReturn arbitrator::ArbitratorNode::handle_on_configure | ( | const rclcpp_lifecycle::State & | ) |
Definition at line 35 of file arbitrator_node.cpp.
References arbitrator_, arbitrator::Config::beam_width, config_, arbitrator::CostSystemCostFunction::init(), arbitrator::Config::min_plan_duration, arbitrator::Config::planning_frequency, arbitrator::Config::plugin_priorities, plugin_priorities_map_from_json(), arbitrator::Config::target_plan_duration, arbitrator::Arbitrator::twist_cb(), twist_sub_, arbitrator::Config::use_fixed_costs, wm_, and wm_listener_.
|
private |
Definition at line 112 of file arbitrator_node.cpp.
Referenced by ArbitratorNode(), and handle_on_configure().
|
private |
Definition at line 72 of file arbitrator_node.hpp.
Referenced by handle_on_activate(), and handle_on_configure().
|
private |
Definition at line 74 of file arbitrator_node.hpp.
Referenced by handle_on_activate().
|
private |
Definition at line 73 of file arbitrator_node.hpp.
Referenced by handle_on_activate().
|
private |
Definition at line 68 of file arbitrator_node.hpp.
Referenced by ArbitratorNode(), handle_on_activate(), and handle_on_configure().
|
private |
Definition at line 66 of file arbitrator_node.hpp.
Referenced by handle_on_configure().
|
private |
Definition at line 71 of file arbitrator_node.hpp.
Referenced by handle_on_configure().
|
private |
Definition at line 70 of file arbitrator_node.hpp.
Referenced by handle_on_configure().