I d/l-ed PX4-Autopilot from Github and,according to at https://dev.px4.io/master/en/simulation/gazebo.html I tried to build it. I get this error:
jon@jon-ThinkCentre-M92P:~/PX4/PX4-Autopilot$ make px4_sitl gazebo
[0/5] Performing configure step for ‘sitl_gazebo’
– install-prefix: /usr/local
– cmake build type: RelWithDebInfo
– Using C++17 standard
CMake Error at CMakeLists.txt:47 (find_package):
By not providing “Findgazebo.cmake” in CMAKE_MODULE_PATH this project has
asked CMake to find a package configuration file provided by “gazebo”, but
CMake did not find one.
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.
– Configuring incomplete, errors occurred!
See also “/home/jon/PX4/PX4-Autopilot/build/px4_sitl_default/build_gazebo/CMakeFiles/CMakeOutput.log”.
See also “/home/jon/PX4/PX4-Autopilot/build/px4_sitl_default/build_gazebo/CMakeFiles/CMakeError.log”.
FAILED: external/Stamp/sitl_gazebo/sitl_gazebo-configure
cd /home/jon/PX4/PX4-Autopilot/build/px4_sitl_default/build_gazebo && /usr/bin/cmake -DCMAKE_INSTALL_PREFIX=/usr/local -DSEND_ODOMETRY_DATA=ON -GNinja /home/jon/PX4/PX4-Autopilot/Tools/sitl_gazebo && /usr/bin/cmake -E touch /home/jon/PX4/PX4-Autopilot/build/px4_sitl_default/external/Stamp/sitl_gazebo/sitl_gazebo-configure
ninja: build stopped: subcommand failed.
make: *** [Makefile:226: px4_sitl] Error 1
jon@jon-ThinkCentre-M92P:~/PX4/PX4-Autopilot$
To simplify things, I went and d/l-ed just gazebo and, according to https://github.com/PX4/PX4-SITL_gazebo, placed in its own area. Still get the same error:
jon@jon-ThinkCentre-M92P:~$ cd ~/src/sitl_gazebo/build/
jon@jon-ThinkCentre-M92P:~/src/sitl_gazebo/build$ cmake …
– install-prefix: /usr
– cmake build type: RelWithDebInfo
– Using C++17 standard
CMake Error at CMakeLists.txt:47 (find_package):
By not providing “Findgazebo.cmake” in CMAKE_MODULE_PATH this project has
asked CMake to find a package configuration file provided by “gazebo”, but
CMake did not find one.
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 interfaces media models plugins release-notes.html tools worlds
jon@jon-ThinkCentre-M92P:~/gazebo/gazebo-10.0.0$ cd cmake/
installed.
– Configuring incomplete, errors occurred!
See also “/home/jon/src/sitl_gazebo/CMakeFiles/CMakeOutput.log”.
See also “/home/jon/src/sitl_gazebo/CMakeFiles/CMakeError.log”.
jon@jon-ThinkCentre-M92P:~/src/sitl_gazebo/build$
Any help would be greatly appreciated. I’m new here as well as new to cmake, so apologies if this is obvious.
Thanks!