Skip to content

Commit 21db0d9

Browse files
authored
Update trajopt_example.cpp
1 parent 2d7eaaa commit 21db0d9

File tree

1 file changed

+0
-7
lines changed

1 file changed

+0
-7
lines changed

doc/examples/trajopt_planner/src/trajopt_example.cpp

Lines changed: 0 additions & 7 deletions
Original file line numberDiff line numberDiff line change
@@ -18,16 +18,9 @@
1818

1919
#include <geometry_msgs/TransformStamped.h>
2020

21-
// TODO(mosfet80): remove else after EOL galactic
22-
#if __has_include(<tf2/utils.hpp>)
2321
#include <tf2/utils.hpp>
2422
#include <tf2_eigen/tf2_eigen.hpp>
2523
#include <tf2_ros/transform_listener.hpp>
26-
#else
27-
#include <tf2/utils.h>
28-
#include <tf2_eigen/tf2_eigen.h>
29-
#include <tf2_ros/transform_listener.h>
30-
#endif
3124

3225
/* Author: Omid Heidari
3326
Desc: This file is a test for using trajopt in MoveIt. The goal is to make different types of constraints in

0 commit comments

Comments
 (0)