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.
gnss_to_map_convertor::Node Class Reference

#include <gnss_to_map_convertor_node.hpp>

Inheritance diagram for gnss_to_map_convertor::Node:
Inheritance graph
Collaboration diagram for gnss_to_map_convertor::Node:
Collaboration graph

Public Member Functions

 Node (const rclcpp::NodeOptions &)
 Node constructor. More...
 
rcl_interfaces::msg::SetParametersResult parameter_update_callback (const std::vector< rclcpp::Parameter > &parameters)
 
carma_ros2_utils::CallbackReturn handle_on_configure (const rclcpp_lifecycle::State &)
 

Public Attributes

carma_ros2_utils::PubPtr< geometry_msgs::msg::PoseStamped > map_pose_pub
 
carma_ros2_utils::SubPtr< gps_msgs::msg::GPSFix > fix_sub_
 
carma_ros2_utils::SubPtr< std_msgs::msg::String > geo_sub
 

Private Attributes

Config config_
 
std::shared_ptr< tf2_ros::Buffer > tfBuffer_
 
std::shared_ptr< tf2_ros::TransformListener > tfListener_
 
std::shared_ptr< GNSSToMapConvertorconvertor_worker_
 

Detailed Description

Definition at line 46 of file gnss_to_map_convertor_node.hpp.

Constructor & Destructor Documentation

◆ Node()

gnss_to_map_convertor::Node::Node ( const rclcpp::NodeOptions &  options)
explicit

Node constructor.

Definition at line 22 of file gnss_to_map_convertor_node.cpp.

22 : carma_ros2_utils::CarmaLifecycleNode(options)
23 {
24 // Initialize tf buffer with clock and duration
25 tfBuffer_ = std::make_shared<tf2_ros::Buffer>(this->get_clock());
26 // Initialize transform listener with buffer
27 tfListener_ = std::make_shared<tf2_ros::TransformListener>(*tfBuffer_);
28
29 // Create initial config
30 config_ = Config();
31
32 // Declare parameters
33 config_.base_link_frame = declare_parameter<std::string>("base_link_frame", config_.base_link_frame);
34 config_.map_frame = declare_parameter<std::string>("map_frame", config_.map_frame);
35 config_.heading_frame = declare_parameter<std::string>("heading_frame", config_.heading_frame);
36 }
std::shared_ptr< tf2_ros::TransformListener > tfListener_
std::shared_ptr< tf2_ros::Buffer > tfBuffer_

References gnss_to_map_convertor::Config::base_link_frame, config_, gnss_to_map_convertor::Config::heading_frame, gnss_to_map_convertor::Config::map_frame, tfBuffer_, and tfListener_.

Member Function Documentation

◆ handle_on_configure()

carma_ros2_utils::CallbackReturn gnss_to_map_convertor::Node::handle_on_configure ( const rclcpp_lifecycle::State &  )

Definition at line 49 of file gnss_to_map_convertor_node.cpp.

50 {
51 // Reset config
52 config_ = Config();
53
54 // Load parameters
55 get_parameter<std::string>("base_link_frame", config_.base_link_frame);
56 get_parameter<std::string>("map_frame", config_.map_frame);
57 get_parameter<std::string>("heading_frame", config_.heading_frame);
58
59 // Register runtime parameter update callback
60 add_on_set_parameters_callback(std::bind(&Node::parameter_update_callback, this, std_ph::_1));
61
62 // Map pose publisher
63 map_pose_pub = create_publisher<geometry_msgs::msg::PoseStamped>("gnss_pose", 10);
64
65 // Initialize primary worker object
66 convertor_worker_ = std::make_shared<GNSSToMapConvertor>(
67 [this](const auto& msg) { map_pose_pub->publish(msg); }, // Lambda representing publication
68
69 [this](const auto& target, const auto& source) -> boost::optional<geometry_msgs::msg::TransformStamped> { // Lambda representing transform lookup
70 geometry_msgs::msg::TransformStamped tf;
71 try
72 {
73 tf = tfBuffer_->lookupTransform(target, source, rclcpp::Time(1, 0));
74 }
75 catch (tf2::TransformException& ex)
76 {
77 RCLCPP_ERROR_STREAM(get_logger(),"Could not lookup transform with exception " << ex.what());
78 return boost::none;
79 }
80 return tf;
81 },
82
83 config_.map_frame, config_.base_link_frame, config_.heading_frame, this->get_node_logging_interface());
84
85 // Fix Subscriber
86
87 fix_sub_ = create_subscription<gps_msgs::msg::GPSFix>("gnss_fix_fused", 2,
88 std::bind(&GNSSToMapConvertor::gnssFixCb, convertor_worker_.get(), std_ph::_1));
89
90 // Georeference subsciber
91
92 geo_sub = create_subscription<std_msgs::msg::String>("georeference", 1,
93 std::bind(&GNSSToMapConvertor::geoReferenceCallback, convertor_worker_.get(), std_ph::_1));
94
95
96 // Return success if everthing initialized successfully
97 return CallbackReturn::SUCCESS;
98 }
void geoReferenceCallback(std_msgs::msg::String::UniquePtr geo_ref)
Map georeference callback The geodetic description of the map frame should be provided to this callba...
void gnssFixCb(gps_msgs::msg::GPSFix::UniquePtr fix_msg)
GNSS Fix callback which will publish a pose representing that fix in the map frame if the required tr...
carma_ros2_utils::SubPtr< gps_msgs::msg::GPSFix > fix_sub_
std::shared_ptr< GNSSToMapConvertor > convertor_worker_
carma_ros2_utils::SubPtr< std_msgs::msg::String > geo_sub
rcl_interfaces::msg::SetParametersResult parameter_update_callback(const std::vector< rclcpp::Parameter > &parameters)
carma_ros2_utils::PubPtr< geometry_msgs::msg::PoseStamped > map_pose_pub

References gnss_to_map_convertor::Config::base_link_frame, config_, convertor_worker_, fix_sub_, geo_sub, gnss_to_map_convertor::GNSSToMapConvertor::geoReferenceCallback(), gnss_to_map_convertor::GNSSToMapConvertor::gnssFixCb(), gnss_to_map_convertor::Config::heading_frame, gnss_to_map_convertor::Config::map_frame, map_pose_pub, parameter_update_callback(), and tfBuffer_.

Here is the call graph for this function:

◆ parameter_update_callback()

rcl_interfaces::msg::SetParametersResult gnss_to_map_convertor::Node::parameter_update_callback ( const std::vector< rclcpp::Parameter > &  parameters)

Definition at line 38 of file gnss_to_map_convertor_node.cpp.

39 {
40 auto error = update_params<std::string>({{"base_link_frame", config_.base_link_frame},{"map_frame", config_.map_frame},{"heading_frame", config_.heading_frame}}, parameters);
41
42 rcl_interfaces::msg::SetParametersResult result;
43
44 result.successful = !error;
45
46 return result;
47 }

References gnss_to_map_convertor::Config::base_link_frame, config_, gnss_to_map_convertor::Config::heading_frame, and gnss_to_map_convertor::Config::map_frame.

Referenced by handle_on_configure().

Here is the caller graph for this function:

Member Data Documentation

◆ config_

Config gnss_to_map_convertor::Node::config_
private

◆ convertor_worker_

std::shared_ptr<GNSSToMapConvertor> gnss_to_map_convertor::Node::convertor_worker_
private

Definition at line 60 of file gnss_to_map_convertor_node.hpp.

Referenced by handle_on_configure().

◆ fix_sub_

carma_ros2_utils::SubPtr<gps_msgs::msg::GPSFix> gnss_to_map_convertor::Node::fix_sub_

Definition at line 74 of file gnss_to_map_convertor_node.hpp.

Referenced by handle_on_configure().

◆ geo_sub

carma_ros2_utils::SubPtr<std_msgs::msg::String> gnss_to_map_convertor::Node::geo_sub

Definition at line 76 of file gnss_to_map_convertor_node.hpp.

Referenced by handle_on_configure().

◆ map_pose_pub

carma_ros2_utils::PubPtr<geometry_msgs::msg::PoseStamped> gnss_to_map_convertor::Node::map_pose_pub

Definition at line 72 of file gnss_to_map_convertor_node.hpp.

Referenced by handle_on_configure().

◆ tfBuffer_

std::shared_ptr<tf2_ros::Buffer> gnss_to_map_convertor::Node::tfBuffer_
private

Definition at line 54 of file gnss_to_map_convertor_node.hpp.

Referenced by Node(), and handle_on_configure().

◆ tfListener_

std::shared_ptr<tf2_ros::TransformListener> gnss_to_map_convertor::Node::tfListener_
private

Definition at line 57 of file gnss_to_map_convertor_node.hpp.

Referenced by Node().


The documentation for this class was generated from the following files: