ros kinetic opencv2 dependency not found
i went to ~/catkin_ws(my workspace) and then to src folder and created my package with the command
catkin_create_pkg face sensor_msgs opencv2 cv_bridge rospy std_msgs
The package was successfully created.Then i went to catkin_ws and executed the command
catkin_make
it showed an error
CMake Error at /opt/ros/kinetic/share/catkin/cmake/catkinConfig.cmake:83 (find_package): Could not find a package configuration file provided by "opencv2" with any of the following names:
opencv2Config.cmake
opencv2-config.cmake
Add the installation prefix of "opencv2" to CMAKE_PREFIX_PATH or set "opencv2_DIR" to a directory containing one of the above files. If "opencv2" provides a separate development package or SDK, be sure it has been installed. Call Stack (most recent call first): face/CMakeLists.txt:10 (find_package)
-- Configuring incomplete, errors occurred! See also "/home/hari/catkin_ws/build/CMakeFiles/CMakeOutput.log". See also "/home/hari/catkin_ws/build/CMakeFiles/CMakeError.log". Makefile:738: recipe for target 'cmake_check_build_system' failed make: * [cmake_check_build_system] Error 1 Invoking "make cmake_check_build_system" failed