Skip to content

Commit e89b7a0

Browse files
authored
Replace deprecated tf2_ros headers (#1529)
Signed-off-by: Alejandro Hernandez Cordero <[email protected]>
1 parent 09e440f commit e89b7a0

File tree

20 files changed

+26
-25
lines changed

20 files changed

+26
-25
lines changed

rviz_common/include/rviz_common/adapter_filter_display.hpp

Lines changed: 2 additions & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -31,7 +31,6 @@
3131
#ifndef RVIZ_COMMON__ADAPTER_FILTER_DISPLAY_HPP_
3232
#define RVIZ_COMMON__ADAPTER_FILTER_DISPLAY_HPP_
3333

34-
#include <tf2_ros/message_filter.h>
3534
#include <cstdint>
3635
#include <memory>
3736
#include <string>
@@ -40,6 +39,8 @@
4039

4140
#include <message_filters/subscriber.hpp>
4241

42+
#include <tf2_ros/message_filter.hpp>
43+
4344
#include "rviz_common/ros_topic_display.hpp"
4445
#include "rviz_common/properties/int_property.hpp"
4546

rviz_common/include/rviz_common/message_filter_display.hpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -31,7 +31,7 @@
3131
#ifndef RVIZ_COMMON__MESSAGE_FILTER_DISPLAY_HPP_
3232
#define RVIZ_COMMON__MESSAGE_FILTER_DISPLAY_HPP_
3333

34-
#include <tf2_ros/message_filter.h>
34+
#include <tf2_ros/message_filter.hpp>
3535
#include <memory>
3636
#include <string>
3737

rviz_common/include/rviz_common/transformation/frame_transformer.hpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -38,7 +38,7 @@
3838

3939
#include "tf2/buffer_core_interface.hpp"
4040
#include "tf2/exceptions.hpp"
41-
#include "tf2_ros/async_buffer_interface.h"
41+
#include "tf2_ros/async_buffer_interface.hpp"
4242

4343
#include <QString> // NOLINT
4444

rviz_common/include/rviz_common/visualization_manager.hpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -40,7 +40,7 @@
4040

4141
#include "rclcpp/clock.hpp"
4242
#include "rclcpp/time.hpp"
43-
#include "tf2_ros/transform_listener.h"
43+
#include "tf2_ros/transform_listener.hpp"
4444

4545
#include "rviz_common/bit_allocator.hpp"
4646
#include "rviz_common/config.hpp"

rviz_common/src/rviz_common/properties/tf_frame_property.cpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -37,7 +37,7 @@
3737

3838
#include <QString> // NOLINT: cpplint is unable to handle the include order here
3939

40-
#include "tf2_ros/transform_listener.h"
40+
#include "tf2_ros/transform_listener.hpp"
4141

4242
#include "../frame_manager.hpp"
4343

rviz_common/src/rviz_common/visualization_frame.cpp

Lines changed: 2 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -63,8 +63,8 @@
6363
#include <QToolButton> // NOLINT cpplint cannot handle include order here
6464

6565
#include "rclcpp/clock.hpp"
66-
#include "tf2_ros/buffer.h"
67-
#include "tf2_ros/transform_listener.h"
66+
#include "tf2_ros/buffer.hpp"
67+
#include "tf2_ros/transform_listener.hpp"
6868

6969
#include "rviz_common/load_resource.hpp"
7070
#include "rviz_common/logging.hpp"

rviz_default_plugins/include/rviz_default_plugins/displays/camera/camera_display.hpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -51,7 +51,7 @@
5151
#include <message_filters/cache.hpp>
5252

5353
# include "sensor_msgs/msg/camera_info.hpp"
54-
# include "tf2_ros/message_filter.h"
54+
# include "tf2_ros/message_filter.hpp"
5555

5656
# include "rviz_default_plugins/displays/image/image_transport_display.hpp"
5757
# include "rviz_default_plugins/displays/image/ros_image_texture_iface.hpp"

rviz_default_plugins/include/rviz_default_plugins/displays/depth_cloud/depth_cloud_display.hpp

Lines changed: 2 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -35,8 +35,6 @@
3535
#include <QObject> // NOLINT: cpplint cannot handle the include order here
3636
#include <Ogre.h>
3737

38-
#include <tf2_ros/message_filter.h>
39-
4038
#include <memory>
4139
#include <mutex>
4240
#include <set>
@@ -65,6 +63,8 @@
6563

6664
#include <sensor_msgs/msg/image.hpp>
6765
#include <sensor_msgs/msg/camera_info.hpp>
66+
67+
#include <tf2_ros/message_filter.hpp>
6868
#endif
6969

7070
#include "rviz_default_plugins/visibility_control.hpp"

rviz_default_plugins/include/rviz_default_plugins/transformation/tf_wrapper.hpp

Lines changed: 3 additions & 3 deletions
Original file line numberDiff line numberDiff line change
@@ -35,9 +35,9 @@
3535
#include <string>
3636
#include <vector>
3737

38-
#include "tf2_ros/buffer.h"
39-
#include "tf2_ros/create_timer_ros.h"
40-
#include "tf2_ros/transform_listener.h"
38+
#include "tf2_ros/buffer.hpp"
39+
#include "tf2_ros/create_timer_ros.hpp"
40+
#include "tf2_ros/transform_listener.hpp"
4141
#include "tf2_geometry_msgs/tf2_geometry_msgs.hpp"
4242

4343
#include "rviz_common/transformation/frame_transformer.hpp"

rviz_default_plugins/src/rviz_default_plugins/displays/depth_cloud/depth_cloud_display.cpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -31,7 +31,6 @@
3131
#include "rviz_default_plugins/displays/depth_cloud/depth_cloud_display.hpp"
3232

3333
#include <Ogre.h>
34-
#include <tf2_ros/message_filter.h>
3534

3635
#include <QRegularExpression>
3736
#include <QString>
@@ -64,6 +63,7 @@
6463

6564
#include <rviz_common/depth_cloud_mld.hpp>
6665
#include <sensor_msgs/msg/image.hpp>
66+
#include <tf2_ros/message_filter.hpp>
6767

6868
namespace rviz_default_plugins
6969
{

0 commit comments

Comments
 (0)