ROS Electric Opencv transition
Hi there,
I've install the electric version, and after made a program with vision-opencv, cv-bridge and opencv2 based on a example program from vision_opencv/cv_bridge after that i discover that opencv2 is deprecated, so i want to make the change to keep the program working.
The problem is that i dind't understand the instructions on here.
I've put on the CMakeLists.txt this:
find_package(OpenCV REQUIRED)
rosbuild_add_executable(kinect_show src/kinect_show.cpp)
#define some target ...
target_link_libraries(kinect_show ${OpenCV_LIBS})
and at my cpp file i still have:
#include <cv_bridge/cv_bridge.h>
#include <sensor_msgs/image_encodings.h>
#include <opencv2/imgproc/imgproc.hpp>
#include <opencv2/highgui/highgui.hpp>
i did noting in the vision_opencv package. I also see that on /usr/include/opencv-2.3.1/opencv i have the following files:
cvaux.h cv.h cvwimage.h cxcore.hpp cxmisc.h ml.h
cvaux.hpp cv.hpp cxcore.h cxeigen.hpp highgui.h
It doesn't seem ok. for instance the file imgprog.hpp is missing...
what do i do to make ros use the system dependency opencv?
Thanks!
imgproc.hpp is installed under /usr/include/opencv-2.3.1/opencv2/imgproc/. What is your question? Is your build failing? If so, copy-paste the error messages into your question.
no the build is not falling, but it didn't fail when using the ROS opencv2. I only want to check if i'm using the system dependecy of opencv and not the ROS Package opencv2. I'm woried that in a future upgrade the program stops working because it still was suported by the ROS package.
oh and also. i didn't do the step 2 of the guide. I don't understand what i have to do there.