20 namespace std_ph = std::placeholders;
23 : carma_ros2_utils::CarmaLifecycleNode(options)
30 wm_listener_ = std::make_shared<carma_wm::WMListener>(get_node_base_interface(), get_node_logging_interface(),
31 get_node_topics_interface(), get_node_parameters_interface());
37 projection_sub_ = create_subscription<std_msgs::msg::String>(
"georeference", 1,
39 mobility_operation_sub_ = create_subscription<carma_v2x_msgs::msg::MobilityOperation>(
"incoming_mobility_operation", 1,
45 rclcpp::PublisherOptions traffic_control_msg_pub_options;
46 traffic_control_msg_pub_options.use_intra_process_comm = rclcpp::IntraProcessSetting::Disable;
48 auto traffic_control_msg_pub_qos = rclcpp::QoS(rclcpp::KeepAll());
49 traffic_control_msg_pub_qos.transient_local();
54 traffic_control_msg_pub_ = create_publisher<carma_v2x_msgs::msg::TrafficControlMessage>(
"geofence", traffic_control_msg_pub_qos, traffic_control_msg_pub_options);
57 return CallbackReturn::SUCCESS;
67#include "rclcpp_components/register_node_macro.hpp"
The class responsible for processing incoming MobilityOperation messages with strategy "carma3/Incide...
carma_ros2_utils::SubPtr< std_msgs::msg::String > projection_sub_
std::shared_ptr< carma_wm::WMListener > wm_listener_
void publishTrafficControlMessage(const carma_v2x_msgs::msg::TrafficControlMessage &traffic_control_msg) const
Publish traffic control message.
carma_ros2_utils::PubPtr< carma_v2x_msgs::msg::TrafficControlMessage > traffic_control_msg_pub_
std::shared_ptr< TrafficIncidentParserWorker > traffic_parser_worker_
TrafficIncidentParserNode(const rclcpp::NodeOptions &)
TrafficIncidentParserNode constructor.
carma_ros2_utils::SubPtr< carma_v2x_msgs::msg::MobilityOperation > mobility_operation_sub_
carma_ros2_utils::CallbackReturn handle_on_configure(const rclcpp_lifecycle::State &)
void georeferenceCallback(std_msgs::msg::String::UniquePtr projection_msg)
Callback for the georeference subscriber used to set the map projection.
void mobilityOperationCallback(carma_v2x_msgs::msg::MobilityOperation::UniquePtr mobility_msg)
Function to receive the incoming mobility operation message from the message node and publish the geo...