PX4 / PX4-SITL_gazebo-classic

Set of plugins, models and worlds to use with OSRF Gazebo Simulator in SITL and HITL.
http://dev.px4.io/simulation-gazebo.html
379 stars 798 forks source link

PX4 simulation in Gazebo #56

Closed DeanJJJ closed 8 years ago

DeanJJJ commented 8 years ago

anyone know how to simulate PX4 in Gazebo? when I enter "make posix_sitl_default gazebo", the error which is CMakeFiles/Makefile2:9960: recipe for target 'src/firmware/posix/CMakeFiles/gazebo.dir/rule' failed make[2]: * [src/firmware/posix/CMakeFiles/gazebo.dir/rule] Error 2 Makefile:3497: recipe for target 'gazebo' failed make[1]: * [gazebo] Error 2 Makefile:160: recipe for target 'posix_sitl_default' failed make: *\ [posix_sitl_default] Error 2 will appear.

julianoes commented 8 years ago

@DeanJJJ Can you please post the whole output of make and the output of

git rev-parse HEAD
DeanJJJ commented 8 years ago

@julianoes thank you for reply! The following is the output of ' git rev-parse HEAD ' db44129ec099a05debf9187da2fd09035c9a67d7

DeanJJJ commented 8 years ago

@julianoes and the following is the while output of make PX4 CONFIG: /home/ubuntu/src/Firmware/build_posix_sitl_default [ 0%] Built target git_genmsg [ 0%] Built target prebuild_targets [ 1%] Built target git_gencpp [ 1%] Performing configure step for 'sitl_gazebo' [ 1%] Built target git_uavcan [ 2%] Built target git_mavlink [ 2%] Built target git_matrix -- install-prefix: /usr [ 2%] Built target git_driverframework [ 2%] Built target git_jmavsim [ 2%] Built target git_ecl [ 4%] Built target df_driver_framework [ 4%] Built target git_gazebo [ 4%] Built target mixer_gen [ 5%] Built target xml_gen [ 24%] Built target msg_gen [ 25%] Built target platforms__common [ 26%] Built target generate_topic_listener CMake Error at CMakeLists.txt:23 (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/ubuntu/src/Firmware/build_posix_sitl_default/build_gazebo/CMakeFiles/CMakeOutput.log". src/firmware/posix/CMakeFiles/sitl_gazebo.dir/build.make:105: recipe for target 'external/Stamp/sitl_gazebo/sitl_gazebo-configure' failed make[4]: * [external/Stamp/sitl_gazebo/sitl_gazebo-configure] Error 1 CMakeFiles/Makefile2:9086: recipe for target 'src/firmware/posix/CMakeFiles/sitl_gazebo.dir/all' failed make[3]: * [src/firmware/posix/CMakeFiles/sitl_gazebo.dir/all] Error 2 make[3]: * Waiting for unfinished jobs.... [ 26%] Built target driversboardssitl [ 28%] Built target driversdevice [ 35%] Built target systemcmdstests CMakeFiles/Makefile2:9960: recipe for target 'src/firmware/posix/CMakeFiles/gazebo.dir/rule' failed make[2]: * [src/firmware/posix/CMakeFiles/gazebo.dir/rule] Error 2 Makefile:3497: recipe for target 'gazebo' failed make[1]: * [gazebo] Error 2 Makefile:160: recipe for target 'posix_sitl_default' failed make: * [posix_sitl_default] Error 2

LorenzMeier commented 8 years ago

You don't have all Gazebo packages installed. Please go back to the PX4 Linux installation instructions and make sure to install everything.

julianoes commented 8 years ago

@DeanJJJ please update to latest master. There have been fixes for gazebo:

https://github.com/PX4/Firmware/commit/2d039af7a4299c6565e0d47f333adad65fd0c0a0

DeanJJJ commented 8 years ago

@julianoes thx a lot, I will try it.

DeanJJJ commented 8 years ago

@julianoes sorry for bothering again. I have updated firmware to latest master and installed Gazebo packages step by step. However, new errors appear after 100% building. Errors is shown below:

[100%] Completed 'sitl_gazebo' [100%] Built target sitl_gazebo Scanning dependencies of target gazebo args: /home/ubuntu/src/Firmware/build_posix_sitl_default/src/firmware/posix/px4 posix-configs/SITL/init/lpe none gazebo none /home/ubuntu/src/Firmware /home/ubuntu/src/Firmware/build_posix_sitl_default SITL ARGS sitl_bin: /home/ubuntu/src/Firmware/build_posix_sitl_default/src/firmware/posix/px4 rcS_dir: posix-configs/SITL/init/lpe debugger: none program: gazebo model: none src_path: /home/ubuntu/src/Firmware build_path: /home/ubuntu/src/Firmware/build_posix_sitl_default empty model, setting iris as default /home/ubuntu/src/Firmware/Tools/sitl_run.sh: line 58: kill: ubuntu: arguments must be process or job IDs src/firmware/posix/CMakeFiles/gazebo.dir/build.make:57: recipe for target 'src/firmware/posix/CMakeFiles/gazebo' failed make[4]: * [src/firmware/posix/CMakeFiles/gazebo] Error 1 CMakeFiles/Makefile2:10004: recipe for target 'src/firmware/posix/CMakeFiles/gazebo.dir/all' failed make[3]: * [src/firmware/posix/CMakeFiles/gazebo.dir/all] Error 2 CMakeFiles/Makefile2:10011: recipe for target 'src/firmware/posix/CMakeFiles/gazebo.dir/rule' failed make[2]: * [src/firmware/posix/CMakeFiles/gazebo.dir/rule] Error 2 Makefile:3510: recipe for target 'gazebo' failed make[1]: * [gazebo] Error 2 Makefile:160: recipe for target 'posix_sitl_default' failed make: *\ [posix_sitl_default] Error 2

julianoes commented 8 years ago

Debug what goes wrong here:

/home/ubuntu/src/Firmware/Tools/sitl_run.sh: line 58: kill: ubuntu: arguments must be process or job IDs
DeanJJJ commented 8 years ago

@julianoes it works, thank you

kevinuav commented 4 years ago

Hey,guys! I encounter an error similar to this issue when I compile for the gazebo with branch master in my Mac OS X(10.15.3 Catalina).What's the problem?Thank you!

here is the message from terminal: %make px4_sitl gazebo_standard_vtol ....... [24/98] Building CXX object CMakeFiles.../liftdrag_plugin/liftdrag_plugin.cpp.o ninja: build stopped: subcommand failed. [712/716] Linking CXX executable bin/px4 FAILED: external/Stamp/sitl_gazebo/sitl_gazebo-build ninja: build stopped: subcommand failed. make: *** [px4_sitl] Error 1

Francis-Herman commented 4 years ago

home/francis/gpstk/dev/ext/lib/Math/Vector/VectorOperators.hpp:124:7: note: in expansion of macro ‘VecBaseNewBinaryOperator’ 124 | VecBaseNewBinaryOperator(!=, Vector) | ^~~~~~~~ /home/francis/gpstk/dev/ext/lib/Math/Vector/VectorOperators.hpp:104:8: note: template argument deduction/substitution failed: 104 | retval operator func(const T l, const ConstVectorBase<T, BaseClass>& r) \ | ^~~~ /home/francis/gpstk/dev/ext/lib/Math/Vector/VectorOperators.hpp:124:7: note: in expansion of macro ‘VecBaseNewBinaryOperator’ hello! how do i overcome this error please

124 | VecBaseNewBinaryOperator(!=, Vector) | ^~~~~~~~ /home/francis/gpstk/dev/ext/apps/geomatics/JPLeph/testSSEph.cpp:243:18: note: ‘std::ostream’ {aka ‘std::basic_ostream’} is not derived from ‘const gpstk::ConstVectorBase<T, BaseClass>’ 243 | if(LOGstrm != cout) cout << PrgmName << " timing: " << fixed << setprecision(9) | ^~~~ make[2]: [ext/apps/geomatics/JPLeph/CMakeFiles/testSSEph.dir/build.make:63: ext/apps/geomatics/JPLeph/CMakeFiles/testSSEph.dir/testSSEph.cpp.o] Error 1 make[1]: [CMakeFiles/Makefile2:1058: ext/apps/geomatics/JPLeph/CMakeFiles/testSSEph.dir/all] Error 2 make: *** [Makefile:152: all] Error 2

Francis-Herman commented 4 years ago

francis@francis-HP-Laptop-15-bs0xx:~/Downloads/source$ ./correctScript bash: ./correctScript: No such file or directory

how do install the software inside the source folder

julianoes commented 4 years ago

Please create new issues and provide all the necessary context, and don't necrobump old threads, thanks.