ROS Resources: Documentation | Support | Discussion Forum | Index | Service Status | ros @ Robotics Stack Exchange
Ask Your Question
0

how to solve the error of Could not find a package gazebo

asked 2019-10-21 11:38:05 -0500

zahra gravatar image

i try to build new package for working with ros and gazebo with

catkin_create_pkg spcbot_description tf rviz gazebo xacro urdf rospy roscpp std_msgs geometry_msgs

but after i run catkin_make i get

 +++ processing catkin package: 'spcbot_description'
 -- ==> add_subdirectory(spcbot/spcbot_description)
 CMake Warning at /opt/ros/kinetic/share/catkin/cmake/catkinConfig.cmake:76 (find_package):
   Could not find a package configuration file provided by "gazebo" with any
   of the following names:

     gazeboConfig.cmake
     gazebo-config.cmake

   Add the installation prefix of "gazebo" to CMAKE_PREFIX_PATH or set
   "gazebo_DIR" to a directory containing one of the above files.  If "gazebo"
   provides a separate development package or SDK, be sure it has been
   installed.
 Call Stack (most recent call first):
   spcbot/spcbot_description/CMakeLists.txt:10 (find_package)


 -- Could not find the required component 'gazebo'. 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/kinetic/share/catkin/cmake/catkinConfig.cmake:83 (find_package):
   Could not find a package configuration file provided by "gazebo" with any
   of the following names:

     gazeboConfig.cmake
     gazebo-config.cmake

   Add the installation prefix of "gazebo" to CMAKE_PREFIX_PATH or set
   "gazebo_DIR" to a directory containing one of the above files.  If "gazebo"
   provides a separate development package or SDK, be sure it has been
   installed.
 Call Stack (most recent call first):
   spcbot/spcbot_description/CMakeLists.txt:10 (find_package)


 -- Configuring incomplete, errors occurred!
 See also "/home/zora/tuto_catkin_ws/build/CMakeFiles/CMakeOutput.log".
 See also "/home/zora/tuto_catkin_ws/build/CMakeFiles/CMakeError.log".
 Makefile:556: recipe for target 'cmake_check_build_system' failed
 make: *** [cmake_check_build_system] Error 1
 Invoking "make cmake_check_build_system" failed

there are any solution ???

edit retag flag offensive close merge delete

1 Answer

Sort by ยป oldest newest most voted
0

answered 2019-10-21 12:21:54 -0500

You need gazebo installed.

sudo apt install ros-kinetic-gazebo*
edit flag offensive delete link more

Comments

i installed i have gazebo7

zahra gravatar image zahra  ( 2019-10-21 12:23:37 -0500 )edit

either you didnt install it where it can be found or you have an incomplete environment to find it. The error is pretty clear.

stevemacenski gravatar image stevemacenski  ( 2019-10-21 12:40:52 -0500 )edit

sir i was used

curl -sSL http://get.gazebosim.org | sh

to install gazebo should i following the Alternative installation ??

zahra gravatar image zahra  ( 2019-10-21 12:50:50 -0500 )edit

Try to use the instructions above

stevemacenski gravatar image stevemacenski  ( 2019-10-21 13:42:44 -0500 )edit

do you mean this

sudo apt install ros-kinetic-gazebo*
zahra gravatar image zahra  ( 2019-10-21 13:52:07 -0500 )edit

Question Tools

2 followers

Stats

Asked: 2019-10-21 11:38:05 -0500

Seen: 5,062 times

Last updated: Oct 21 '19