Skip to content

Commit 2f740f5

Browse files
authored
Deprecating tf2 C Headers (#4828)
Signed-off-by: CursedRock17 <mtglucas1@gmail.com>
1 parent 01d669e commit 2f740f5

File tree

4 files changed

+5
-5
lines changed

4 files changed

+5
-5
lines changed

source/Tutorials/Intermediate/Tf2/Quaternion-Fundamentals.rst

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -45,7 +45,7 @@ The commonly-used unit quaternion that yields no rotation about the x/y/z axes i
4545

4646
.. code-block:: C++
4747

48-
#include <tf2/LinearMath/Quaternion.h>
48+
#include <tf2/LinearMath/Quaternion.hpp>
4949
...
5050

5151
tf2::Quaternion q;

source/Tutorials/Intermediate/Tf2/Writing-A-Tf2-Broadcaster-Cpp.rst

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -78,7 +78,7 @@ Open the file using your preferred text editor.
7878

7979
#include "geometry_msgs/msg/transform_stamped.hpp"
8080
#include "rclcpp/rclcpp.hpp"
81-
#include "tf2/LinearMath/Quaternion.h"
81+
#include "tf2/LinearMath/Quaternion.hpp"
8282
#include "tf2_ros/transform_broadcaster.h"
8383
#include "turtlesim_msgs/msg/pose.hpp"
8484

source/Tutorials/Intermediate/Tf2/Writing-A-Tf2-Listener-Cpp.rst

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -78,7 +78,7 @@ Open the file using your preferred text editor.
7878
#include "geometry_msgs/msg/transform_stamped.hpp"
7979
#include "geometry_msgs/msg/twist.hpp"
8080
#include "rclcpp/rclcpp.hpp"
81-
#include "tf2/exceptions.h"
81+
#include "tf2/exceptions.hpp"
8282
#include "tf2_ros/transform_listener.h"
8383
#include "tf2_ros/buffer.h"
8484
#include "turtlesim_msgs/srv/spawn.hpp"

source/Tutorials/Intermediate/Tf2/Writing-A-Tf2-Static-Broadcaster-Cpp.rst

Lines changed: 2 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -94,7 +94,7 @@ Open the file using your preferred text editor.
9494

9595
#include "geometry_msgs/msg/transform_stamped.hpp"
9696
#include "rclcpp/rclcpp.hpp"
97-
#include "tf2/LinearMath/Quaternion.h"
97+
#include "tf2/LinearMath/Quaternion.hpp"
9898
#include "tf2_ros/static_transform_broadcaster.h"
9999

100100
class StaticFramePublisher : public rclcpp::Node
@@ -186,7 +186,7 @@ We also include ``tf2_ros/static_transform_broadcaster.h`` to use the ``StaticTr
186186

187187
.. code-block:: C++
188188

189-
#include "tf2/LinearMath/Quaternion.h"
189+
#include "tf2/LinearMath/Quaternion.hpp"
190190
#include "tf2_ros/static_transform_broadcaster.h"
191191

192192
The ``StaticFramePublisher`` class constructor initializes the node with the name ``static_turtle_tf2_broadcaster``.

0 commit comments

Comments
 (0)