I have a problem starting the px4 v1.12.3 with gazebo11 on ubuntu 22.04.
input:
on ubuntu 20.04: everthing works, no problems.
on ubuntu 22.04:
- building the code v1.12.3 is fine.
- building v1.12.3 with jmavsim simulation is fine.
- building v1.12.3 with gazebo11 simulation is problematic.
$ make px4_sitl_default gazebo
the build stops in the middle and the pc crashes (need to reboot)
I have already performed the ./setup/ubuntu.sh > install gazebo harmonics
then I have removed harmonics and installed gazebo11:
$ sudo apt remove gz-harmonic
$ sudo apt install aptitude
$ sudo aptitude install gazebo libgazebo11 libgazebo-dev
any help please?
[0/11] git submodule Tools/sitl_gazebo
[6/11] Performing configure step for 'sitl_gazebo'
-- install-prefix: /usr/local
-- cmake build type: RelWithDebInfo
-- The C compiler identification is GNU 9.5.0
-- The CXX compiler identification is GNU 9.5.0
-- Check for working C compiler: /usr/bin/cc
-- Check for working C compiler: /usr/bin/cc -- works
-- Detecting C compiler ABI info
-- Detecting C compiler ABI info - done
-- Detecting C compile features
-- Detecting C compile features - done
-- Check for working CXX compiler: /usr/bin/c++
-- Check for working CXX compiler: /usr/bin/c++ -- works
-- Detecting CXX compiler ABI info
-- Detecting CXX compiler ABI info - done
-- Detecting CXX compile features
-- Detecting CXX compile features - done
-- Performing Test COMPILER_SUPPORTS_CXX17
-- Performing Test COMPILER_SUPPORTS_CXX17 - Success
-- Performing Test COMPILER_SUPPORTS_CXX14
-- Performing Test COMPILER_SUPPORTS_CXX14 - Success
-- Performing Test COMPILER_SUPPORTS_CXX11
-- Performing Test COMPILER_SUPPORTS_CXX11 - Success
-- Performing Test COMPILER_SUPPORTS_CXX0X
-- Performing Test COMPILER_SUPPORTS_CXX0X - Success
-- Using C++17 standard
-- ccache enabled (export CCACHE_DISABLE=1 to disable)
-- Found Boost: /usr/lib/x86_64-linux-gnu/cmake/Boost-1.74.0/BoostConfig.cmake (found suitable version "1.74.0", minimum required is "1.58") found components: system thread filesystem
-- Found PkgConfig: /usr/bin/pkg-config (found version "0.29.2")
-- Checking for module 'bullet>=2.82'
-- Found bullet, version 3.05
-- Found fcl: /usr/include (found suitable version "0.7.0", minimum required is "0.5.0")
-- Found assimp: /usr/include (found version "5.2.0")
-- Found DART: /usr/include (Required is at least version "6.6") found components: dart
-- Found Boost: /usr/lib/x86_64-linux-gnu/cmake/Boost-1.74.0/BoostConfig.cmake (found suitable version "1.74.0", minimum required is "1.40.0") found components: thread system filesystem program_options regex iostreams date_time
-- Found Protobuf: /usr/lib/x86_64-linux-gnu/libprotobuf.so (found version "3.12.4")
-- Looking for ignition-math6 -- found version 6.15.1
-- Searching for dependencies of ignition-math6
-- Looking for OGRE...
-- OGRE_PREFIX_WATCH changed.
-- Checking for module 'OGRE'
-- Found OGRE, version 1.9.0
-- Found Ogre Ghadamon (1.9.0)
-- Found OGRE: optimized;/usr/lib/x86_64-linux-gnu/libOgreMain.so;debug;/usr/lib/x86_64-linux-gnu/libOgreMain.so
-- Looking for OGRE_Paging...
-- Found OGRE_Paging: optimized;/usr/lib/x86_64-linux-gnu/libOgrePaging.so;debug;/usr/lib/x86_64-linux-gnu/libOgrePaging.so
-- Looking for OGRE_Terrain...
-- Found OGRE_Terrain: optimized;/usr/lib/x86_64-linux-gnu/libOgreTerrain.so;debug;/usr/lib/x86_64-linux-gnu/libOgreTerrain.so
-- Looking for OGRE_Property...
-- Found OGRE_Property: optimized;/usr/lib/x86_64-linux-gnu/libOgreProperty.so;debug;/usr/lib/x86_64-linux-gnu/libOgreProperty.so
-- Looking for OGRE_RTShaderSystem...
-- Found OGRE_RTShaderSystem: optimized;/usr/lib/x86_64-linux-gnu/libOgreRTShaderSystem.so;debug;/usr/lib/x86_64-linux-gnu/libOgreRTShaderSystem.so
-- Looking for OGRE_Volume...
-- Found OGRE_Volume: optimized;/usr/lib/x86_64-linux-gnu/libOgreVolume.so;debug;/usr/lib/x86_64-linux-gnu/libOgreVolume.so
-- Looking for OGRE_Overlay...
-- Found OGRE_Overlay: optimized;/usr/lib/x86_64-linux-gnu/libOgreOverlay.so;debug;/usr/lib/x86_64-linux-gnu/libOgreOverlay.so
-- Looking for ignition-math6 -- found version 6.15.1
-- Looking for ignition-transport8 -- found version 8.2.1
-- Searching for dependencies of ignition-transport8
-- Found Protobuf: /usr/lib/x86_64-linux-gnu/libprotobuf.so (found suitable version "3.12.4", minimum required is "3")
-- Config-file not installed for ZeroMQ -- checking for pkg-config
-- Checking for module 'libzmq >= 4'
-- Found libzmq , version 4.3.4
-- Found ZeroMQ: TRUE (Required is at least version "4")
-- Checking for module 'uuid'
-- Found uuid, version 2.37.2
-- Found UUID: TRUE
-- Looking for ignition-msgs5 -- found version 5.8.1
-- Searching for dependencies of ignition-msgs5
-- Looking for ignition-math6 -- found version 6.15.1
-- Checking for module 'tinyxml2'
-- Found tinyxml2, version 9.0.0
-- Looking for ignition-msgs5 -- found version 5.8.1
-- Looking for ignition-common3 -- found version 3.14.0
-- Searching for dependencies of ignition-common3
-- Looking for dlfcn.h - found
-- Looking for libdl - found
-- Found DL: TRUE
-- Found tinyobjloader: /usr/lib/x86_64-linux-gnu/cmake/tinyobjloader/tinyobjloader-config.cmake (found version "2.0.0")
-- Searching for <ignition-common3> component [graphics]
-- Looking for ignition-common3-graphics -- found version 3.14.0
-- Searching for dependencies of ignition-common3-graphics
-- Looking for ignition-math6 -- found version 6.15.1
-- Looking for ignition-fuel_tools4 -- found version 4.4.0
-- Searching for dependencies of ignition-fuel_tools4
-- Found CURL: /usr/lib/x86_64-linux-gnu/libcurl.so (found version "7.81.0")
-- Checking for module 'jsoncpp'
-- Found jsoncpp, version 1.9.5
-- Found JSONCPP: TRUE
-- Checking for module 'yaml-0.1'
-- Found yaml-0.1, version 0.2.2
-- Found YAML: TRUE
-- Checking for module 'libzip'
-- Found libzip, version 1.7.3
-- Found ZIP: TRUE
-- Looking for ignition-common3 -- found version 3.14.0
-- Looking for ignition-math6 -- found version 6.15.1
-- Looking for ignition-msgs5 -- found version 5.8.1
-- Checking for one of the modules 'glib-2.0'
-- Found PythonInterp: /usr/bin/python3 (found suitable version "3.10.12", minimum required is "3")
-- Found OpenCV: /usr (found version "4.5.4")
-- Found TinyXML: /usr/lib/x86_64-linux-gnu/libtinyxml.so
-- Checking for module 'gstreamer-1.0 >= 1.0'
-- Found gstreamer-1.0 , version 1.20.3
-- Checking for module 'gstreamer-base-1.0 >= 1.0'
-- Found gstreamer-base-1.0 , version 1.20.3
-- Checking for module 'gstreamer-app-1.0 >= 1.0'
-- Found gstreamer-app-1.0 , version 1.20.1
-- Found GStreamer: GSTREAMER_INCLUDE_DIRS;GSTREAMER_LIBRARIES;GSTREAMER_VERSION;GSTREAMER_BASE_INCLUDE_DIRS;GSTREAMER_BASE_LIBRARIES (Required is at least version "1.0")
-- Checking for module 'OGRE'
-- Found OGRE, version 1.9.0
-- Building klt_feature_tracker without catkin
-- Building OpticalFlow with OpenCV
-- Found MAVLink: /home/ava/repos/mypx4/Firmware/mavlink/include (found version "2.0")
-- catkin DISABLED
-- Found Protobuf: /usr/lib/x86_64-linux-gnu/libprotobuf.so (found version "3.12.4")
-- Checking for module 'protobuf'
-- Found protobuf, version 3.12.4
-- Gazebo version: 11.10
-- Found GStreamer: adding gst_camera_plugin
-- Found GStreamer: adding gst_video_stream_widget
-- Configuring done
-- Generating done
-- Build files have been written to: /home/ava/repos/mypx4/Firmware/build/px4_sitl_default/build_gazebo
[7/11] Performing build step for 'sitl_gazebo'
[25/126] Generating /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/c920/c920.sdf
/home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/c920/c920.sdf.jinja -> /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/c920/c920.sdf
[26/126] Generating /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/tailsitter/tailsitter.sdf
/home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/tailsitter/tailsitter.sdf.jinja -> /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/tailsitter/tailsitter.sdf
[27/126] Generating /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/3DR_gps_mag/3DR_gps_mag.sdf
/home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/3DR_gps_mag/3DR_gps_mag.sdf.jinja -> /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/3DR_gps_mag/3DR_gps_mag.sdf
[28/126] Generating /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/depth_camera/depth_camera.sdf
/home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/depth_camera/depth_camera.sdf.jinja -> /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/depth_camera/depth_camera.sdf
[29/126] Generating /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/sf10a/sf10a.sdf
/home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/sf10a/sf10a.sdf.jinja -> /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/sf10a/sf10a.sdf
[31/126] Generating /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/boat/boat.sdf
/home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/boat/boat.sdf.jinja -> /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/boat/boat.sdf
[32/126] Generating /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/standard_vtol/standard_vtol.sdf
/home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/standard_vtol/standard_vtol.sdf.jinja -> /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/standard_vtol/standard_vtol.sdf
[33/126] Generating /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/px4flow/px4flow.sdf
/home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/px4flow/px4flow.sdf.jinja -> /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/px4flow/px4flow.sdf
[36/126] Generating /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/rover/rover.sdf
/home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/rover/rover.sdf.jinja -> /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/rover/rover.sdf
[37/126] Generating /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/iris/iris.sdf
/home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/iris/iris.sdf.jinja -> /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/iris/iris.sdf
[38/126] Generating /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/tiltrotor/tiltrotor.sdf
/home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/tiltrotor/tiltrotor.sdf.jinja -> /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/tiltrotor/tiltrotor.sdf
[39/126] Generating /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/r200/r200.sdf
/home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/r200/r200.sdf.jinja -> /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/r200/r200.sdf
[40/126] Generating /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/pixhawk/pixhawk.sdf
/home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/pixhawk/pixhawk.sdf.jinja -> /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/pixhawk/pixhawk.sdf
[41/126] Generating /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/mb1240-xl-ez4/mb1240-xl-ez4.sdf
/home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/mb1240-xl-ez4/mb1240-xl-ez4.sdf.jinja -> /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/mb1240-xl-ez4/mb1240-xl-ez4.sdf
[42/126] Generating /home/ava/repos/mypx4/Firmware/Tool...gazebo/models/standard_vtol_drop/standard_vtol_drop.sdf
/home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/standard_vtol_drop/standard_vtol_drop.sdf.jinja -> /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/standard_vtol_drop/standard_vtol_drop.sdf
[43/126] Generating /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/cloudship/cloudship.sdf
/home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/cloudship/cloudship.sdf.jinja -> /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/cloudship/cloudship.sdf
[44/126] Generating /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/typhoon_h480/typhoon_h480.sdf
/home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/typhoon_h480/typhoon_h480.sdf.jinja -> /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/typhoon_h480/typhoon_h480.sdf
[45/126] Generating /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/plane/plane.sdf
/home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/plane/plane.sdf.jinja -> /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/plane/plane.sdf
[47/126] Generating /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/r1_rover/r1_rover.sdf
/home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/r1_rover/r1_rover.sdf.jinja -> /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/r1_rover/r1_rover.sdf
[49/126] Generating /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/matrice_100/matrice_100.sdf
/home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/matrice_100/matrice_100.sdf.jinja -> /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/models/matrice_100/matrice_100.sdf
[59/126] Building CXX object CMakeFiles/gazebo_mavlink_interface.dir/src/mavlink_interface.cpp.o
In file included from /usr/include/boost/smart_ptr/detail/sp_thread_sleep.hpp:22,
from /usr/include/boost/smart_ptr/detail/yield_k.hpp:23,
from /usr/include/boost/smart_ptr/detail/spinlock_gcc_atomic.hpp:14,
from /usr/include/boost/smart_ptr/detail/spinlock.hpp:42,
from /usr/include/boost/smart_ptr/detail/spinlock_pool.hpp:25,
from /usr/include/boost/smart_ptr/shared_ptr.hpp:29,
from /usr/include/boost/shared_ptr.hpp:17,
from /usr/include/boost/date_time/time_clock.hpp:17,
from /usr/include/boost/date_time/posix_time/posix_time_types.hpp:10,
from /usr/include/boost/asio/time_traits.hpp:23,
from /usr/include/boost/asio/detail/timer_queue_ptime.hpp:22,
from /usr/include/boost/asio/detail/deadline_timer_service.hpp:29,
from /usr/include/boost/asio/basic_deadline_timer.hpp:25,
from /usr/include/boost/asio.hpp:25,
from /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/include/mavlink_interface.h:36,
from /home/ava/repos/mypx4/Firmware/Tools/sitl_gazebo/src/mavlink_interface.cpp:1:
/usr/include/boost/bind.hpp:36:1: note: #pragma message: The practice of declaring the Bind placeholders (_1, _2, ...) in the global namespace is deprecated. Please use <boost/bind/bind.hpp> + using namespace boost::placeholders, or define BOOST_BIND_GLOBAL_PLACEHOLDERS to retain the current behavior.
36 | BOOST_PRAGMA_MESSAGE(
| ^~~~~~~~~~~~~~~~~~~~
[63/126] Building CXX object CMakeFiles/gazebo_video_st...widget.dir/include/moc_gazebo_video_stream_widget.cpp.o