diff --git a/crane_x7_examples/src/aruco_detection.cpp b/crane_x7_examples/src/aruco_detection.cpp index e32b7b9f..0c14168f 100644 --- a/crane_x7_examples/src/aruco_detection.cpp +++ b/crane_x7_examples/src/aruco_detection.cpp @@ -27,7 +27,7 @@ #include "sensor_msgs/msg/image.hpp" #include "opencv2/opencv.hpp" #include "opencv2/aruco.hpp" -#include "cv_bridge/cv_bridge.h" +#include "cv_bridge/cv_bridge.hpp" #include "tf2/LinearMath/Quaternion.h" #include "tf2/LinearMath/Matrix3x3.h" #include "tf2_ros/transform_broadcaster.h" diff --git a/crane_x7_examples/src/color_detection.cpp b/crane_x7_examples/src/color_detection.cpp index 72bc9e17..bd1e853c 100644 --- a/crane_x7_examples/src/color_detection.cpp +++ b/crane_x7_examples/src/color_detection.cpp @@ -29,8 +29,8 @@ #include "tf2_ros/transform_broadcaster.h" #include "opencv2/opencv.hpp" #include "opencv2/imgproc/imgproc.hpp" -#include "cv_bridge/cv_bridge.h" -#include "image_geometry/pinhole_camera_model.h" +#include "cv_bridge/cv_bridge.hpp" +#include "image_geometry/pinhole_camera_model.hpp" using std::placeholders::_1; class ImageSubscriber : public rclcpp::Node