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.
frame_transformer.hpp
Go to the documentation of this file.
1#pragma once
2
3/*
4 * Copyright (C) 2021 LEIDOS.
5 *
6 * Licensed under the Apache License, Version 2.0 (the "License"); you may not
7 * use this file except in compliance with the License. You may obtain a copy of
8 * the License at
9 *
10 * http://www.apache.org/licenses/LICENSE-2.0
11 *
12 * Unless required by applicable law or agreed to in writing, software
13 * distributed under the License is distributed on an "AS IS" BASIS, WITHOUT
14 * WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. See the
15 * License for the specific language governing permissions and limitations under
16 * the License.
17 */
18
20#include <carma_ros2_utils/carma_lifecycle_node.hpp>
21#include <tf2/exceptions.h>
22#include <tf2_ros/transform_listener.h>
23#include <tf2_ros/buffer.h>
24#include <tf2_geometry_msgs/tf2_geometry_msgs.hpp>
25#include <tf2_sensor_msgs/tf2_sensor_msgs.hpp>
26#include <autoware_auto_tf2/tf2_autoware_auto_msgs_extension.hpp>
27#include <chrono>
28#include <gtest/gtest_prod.h>
29
31{
32 namespace std_ph = std::placeholders;
33 using std_ms = std::chrono::milliseconds;
34
42 template <class T>
43 class Transformer : public TransformerBase // TransformerBase allows for type polymorphism in the containing Node and constructor enforcement
44 {
45
46 protected:
47 // Subscribers
48 carma_ros2_utils::SubPtr<T> input_sub_;
49
50 // Publishers
51 carma_ros2_utils::PubPtr<T> output_pub_;
52
53
54 public:
55
61 Transformer(Config config, std::shared_ptr<tf2_ros::Buffer> buffer, std::shared_ptr<carma_ros2_utils::CarmaLifecycleNode> node)
62 : TransformerBase(config, buffer, node) {
63
64 input_sub_ = node_->create_subscription<T>("input", config_.queue_size,
65 std::bind(&Transformer::input_callback, this, std_ph::_1));
66
67 // Setup publishers
68 output_pub_ = node_->create_publisher<T>("output", config_.queue_size);
69 }
70
71
84 bool transform(const T &in, T &out, const std::string &target_frame, const std_ms timeout)
85 {
86
87 try
88 {
89 buffer_->transform(in, out, target_frame, timeout);
90 }
91 catch (tf2::TransformException &ex)
92 {
93 std::string error = ex.what();
94 error = "Failed to get transform with exception: " + error;
95 auto& clk = *node_->get_clock(); // Separate reference required for proper throttle macro call
96 RCLCPP_WARN_THROTTLE(node_->get_logger(), clk, 1000, error.c_str());
97
98 return false;
99 }
100
101 return true;
102 }
103
111 void input_callback(std::unique_ptr<T> in_msg)
112 {
113 T out_msg;
114
115 if (!transform(*in_msg, out_msg, config_.target_frame, std_ms(config_.timeout)))
116 {
117 return;
118 }
119
120 output_pub_->publish(out_msg);
121 }
122
123 // Unit Test Accessors
124 FRIEND_TEST(frame_transformer_test, transform_test);
125 };
126
127 // Specialization of input_callback for PointCloud2 messages to allow for preallocation of points vector
128 // This is done due to the large size of that data set
129 template <>
130 inline void Transformer<sensor_msgs::msg::PointCloud2>::input_callback(std::unique_ptr<sensor_msgs::msg::PointCloud2> in_msg) {
131
132 sensor_msgs::msg::PointCloud2 out_msg;
133 out_msg.data.reserve(in_msg->data.size()); // Preallocate points vector
134
135
136 if (!transform(*in_msg, out_msg, config_.target_frame, std_ms(config_.timeout)))
137 {
138 return;
139 }
140
141 // The following if block is added purely for ensuring consistency with Autoware.Auto (prevent "Malformed PointCloud2" error from ray_ground_filter)
142 // It's a bit out of scope for this node to have this functionality here,
143 // but the alternative is to modify a 3rd party driver, an Autoware.Auto component, or make a new node just for this.
144 // Therefore, the logic will live here until such a time as a better location presents itself.
145 if (out_msg.height == 1) // 1d point cloud
146 {
147 out_msg.row_step = out_msg.data.size();
148 }
149
150 output_pub_->publish(out_msg);
151 }
152
153}
Transformer base class provides default member variables for tf2 lookup and ros network access....
std::shared_ptr< carma_ros2_utils::CarmaLifecycleNode > node_
Containing node which provides access to the ros network.
Config config_
Transformation configuration.
std::shared_ptr< tf2_ros::Buffer > buffer_
TF2 Buffer for storing transform history and looking up transforms.
Class template for data transformers which use the tf2_ros::Buffer.transform() method to perform tran...
bool transform(const T &in, T &out, const std::string &target_frame, const std_ms timeout)
Helper method which takes in an input message and transforms it to the provided frame....
carma_ros2_utils::SubPtr< T > input_sub_
void input_callback(std::unique_ptr< T > in_msg)
Callback for input data. Transforms the data then republishes it.
Transformer(Config config, std::shared_ptr< tf2_ros::Buffer > buffer, std::shared_ptr< carma_ros2_utils::CarmaLifecycleNode > node)
Constructor which sets up the required publishers and subscribers.
FRIEND_TEST(frame_transformer_test, transform_test)
carma_ros2_utils::PubPtr< T > output_pub_
std::chrono::milliseconds std_ms
Stuct containing the algorithm configuration values for frame_transformer.
int timeout
Timeout in ms for transform lookup. A value of 0 means lookup will occur once without blocking if it ...
std::string target_frame
The target coordinate frame id to transform data into.
int queue_size
Queue size for publishers and subscribers.