We read every piece of feedback, and take your input very seriously.
To see all available qualifiers, see our documentation.
There was an error while loading. Please reload this page.
1 parent 2d7eaaa commit 21db0d9Copy full SHA for 21db0d9
doc/examples/trajopt_planner/src/trajopt_example.cpp
@@ -18,16 +18,9 @@
18
19
#include <geometry_msgs/TransformStamped.h>
20
21
-// TODO(mosfet80): remove else after EOL galactic
22
-#if __has_include(<tf2/utils.hpp>)
23
#include <tf2/utils.hpp>
24
#include <tf2_eigen/tf2_eigen.hpp>
25
#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
31
32
/* Author: Omid Heidari
33
Desc: This file is a test for using trajopt in MoveIt. The goal is to make different types of constraints in
0 commit comments