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 <gnss_to_map_convertor_node.hpp>
Public Member Functions | |
Node (const rclcpp::NodeOptions &) | |
Node constructor. More... | |
rcl_interfaces::msg::SetParametersResult | parameter_update_callback (const std::vector< rclcpp::Parameter > ¶meters) |
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_ |
tf2_ros::Buffer | tfBuffer_ |
tf2_ros::TransformListener | tfListener_ {tfBuffer_} |
std::shared_ptr< GNSSToMapConvertor > | convertor_worker_ |
Definition at line 44 of file gnss_to_map_convertor_node.hpp.
|
explicit |
Node constructor.
Definition at line 22 of file gnss_to_map_convertor_node.cpp.
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.
carma_ros2_utils::CallbackReturn gnss_to_map_convertor::Node::handle_on_configure | ( | const rclcpp_lifecycle::State & | ) |
Definition at line 44 of file gnss_to_map_convertor_node.cpp.
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_.
rcl_interfaces::msg::SetParametersResult gnss_to_map_convertor::Node::parameter_update_callback | ( | const std::vector< rclcpp::Parameter > & | parameters | ) |
Definition at line 33 of file gnss_to_map_convertor_node.cpp.
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().
|
private |
Definition at line 49 of file gnss_to_map_convertor_node.hpp.
Referenced by Node(), handle_on_configure(), and parameter_update_callback().
|
private |
Definition at line 59 of file gnss_to_map_convertor_node.hpp.
Referenced by handle_on_configure().
carma_ros2_utils::SubPtr<gps_msgs::msg::GPSFix> gnss_to_map_convertor::Node::fix_sub_ |
Definition at line 73 of file gnss_to_map_convertor_node.hpp.
Referenced by handle_on_configure().
carma_ros2_utils::SubPtr<std_msgs::msg::String> gnss_to_map_convertor::Node::geo_sub |
Definition at line 75 of file gnss_to_map_convertor_node.hpp.
Referenced by handle_on_configure().
carma_ros2_utils::PubPtr<geometry_msgs::msg::PoseStamped> gnss_to_map_convertor::Node::map_pose_pub |
Definition at line 71 of file gnss_to_map_convertor_node.hpp.
Referenced by handle_on_configure().
|
private |
Definition at line 53 of file gnss_to_map_convertor_node.hpp.
Referenced by handle_on_configure().
|
private |
Definition at line 56 of file gnss_to_map_convertor_node.hpp.