-
Notifications
You must be signed in to change notification settings - Fork 765
Description
Hello I git cloned the package in the src directory and receive the error below when trying to make the package:
CMake Warning at /opt/ros/indigo/share/catkin/cmake/catkinConfig.cmake:76 (find_package):
Could not find a package configuration file provided by "tf2_geometry_msgs"
with any of the following names:
tf2_geometry_msgsConfig.cmake
tf2_geometry_msgs-config.cmake
Add the installation prefix of "tf2_geometry_msgs" to CMAKE_PREFIX_PATH or
set "tf2_geometry_msgs_DIR" to a directory containing one of the above
files. If "tf2_geometry_msgs" provides a separate development package or
SDK, be sure it has been installed.
Call Stack (most recent call first):
image_pipeline/image_rotate/CMakeLists.txt:4 (find_package)
-- Could not find the required component 'tf2_geometry_msgs'. The following CMake error indicates that you either need to install the package with the same name or change your environment so that it can be found.
CMake Error at /opt/ros/indigo/share/catkin/cmake/catkinConfig.cmake:83 (find_package):
Could not find a package configuration file provided by "tf2_geometry_msgs"
with any of the following names:
tf2_geometry_msgsConfig.cmake
tf2_geometry_msgs-config.cmake
Add the installation prefix of "tf2_geometry_msgs" to CMAKE_PREFIX_PATH or
set "tf2_geometry_msgs_DIR" to a directory containing one of the above
files. If "tf2_geometry_msgs" provides a separate development package or
SDK, be sure it has been installed.
Call Stack (most recent call first):
image_pipeline/image_rotate/CMakeLists.txt:4 (find_package)
-- Configuring incomplete, errors occurred!
See also "/home/odroid/drone/build/CMakeFiles/CMakeOutput.log".
See also "/home/odroid/drone/build/CMakeFiles/CMakeError.log".
make: *** [cmake_check_build_system] Error 1
Invoking "make cmake_check_build_system" failed