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 5a6c12f commit f37816bCopy full SHA for f37816b
depth_image_proc/src/register.cpp
@@ -40,7 +40,7 @@
40
#include <sensor_msgs/image_encodings.hpp>
41
#include <image_geometry/pinhole_camera_model.h>
42
#include <Eigen/Geometry>
43
-#include <tf2_eigen/tf2_eigen.hpp>
+#include <tf2_eigen/tf2_eigen.h>
44
#include <depth_image_proc/depth_traits.hpp>
45
#include <depth_image_proc/visibility.h>
46
#include <memory>
image_rotate/include/image_rotate/image_rotate_node.hpp
@@ -39,7 +39,7 @@
39
#include <image_transport/image_transport.hpp>
#include <cv_bridge/cv_bridge.h>
#include <opencv2/imgproc/imgproc.hpp>
-#include <tf2_geometry_msgs/tf2_geometry_msgs.hpp>
+#include <tf2_geometry_msgs/tf2_geometry_msgs.h>
#include <math.h>
#include <string>
0 commit comments