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
360 stars 782 forks source link

error on m1 macbook pro 2021 #849

Open mengchaoheng opened 2 years ago

mengchaoheng commented 2 years ago
mengchaoheng@mengchaohengdeMacBook-Pro PX4-Autopilot % make px4_sitl gazebo                   
-- PX4 version: v1.13.0-alpha1-4371-gc2c455be0d
-- Found PythonInterp: /usr/local/bin/python3 (found suitable version "3.9.10", minimum required is "3") 
-- PX4 config file: /Users/mengchaoheng/Downloads/PX4-Autopilot/boards/px4/sitl/default.px4board
-- PLATFORM posix
-- ROMFSROOT px4fmu_common
-- TESTING y
-- ETHERNET y
-- PX4 config: px4_sitl_default
-- PX4 platform: posix
-- PX4 lockstep: enabled
-- cmake build type: RelWithDebInfo
-- The CXX compiler identification is AppleClang 13.0.0.13000029
-- The C compiler identification is AppleClang 13.0.0.13000029
-- The ASM compiler identification is Clang with GNU-like command-line
-- Found assembler: /Library/Developer/CommandLineTools/usr/bin/cc
-- Detecting CXX compiler ABI info
-- Detecting CXX compiler ABI info - done
-- Check for working CXX compiler: /Library/Developer/CommandLineTools/usr/bin/c++ - skipped
-- Detecting CXX compile features
-- Detecting CXX compile features - done
-- Detecting C compiler ABI info
-- Detecting C compiler ABI info - done
-- Check for working C compiler: /Library/Developer/CommandLineTools/usr/bin/cc - skipped
-- Detecting C compile features
-- Detecting C compile features - done
-- Building for code coverage
-- ccache enabled (export CCACHE_DISABLE=1 to disable)
-- ROMFS: ROMFS/px4fmu_common
-- Configuring done
-- Generating done
-- Build files have been written to: /Users/mengchaoheng/Downloads/PX4-Autopilot/build/px4_sitl_default
[0/853] git submodule src/drivers/gps/devices
[12/853] git submodule Tools/sitl_gazebo
[15/853] git submodule src/modules/mavlink/mavlink
[19/853] Generating Mavlink development: src/modules/mavlink/mavlink/message_definitions/v1.0/development.xml
Validating /Users/mengchaoheng/Downloads/PX4-Autopilot/src/modules/mavlink/mavlink/message_definitions/v1.0/development.xml
Parsing /Users/mengchaoheng/Downloads/PX4-Autopilot/src/modules/mavlink/mavlink/message_definitions/v1.0/development.xml
Validating /Users/mengchaoheng/Downloads/PX4-Autopilot/src/modules/mavlink/mavlink/message_definitions/v1.0/standard.xml
Parsing /Users/mengchaoheng/Downloads/PX4-Autopilot/src/modules/mavlink/mavlink/message_definitions/v1.0/standard.xml
Validating /Users/mengchaoheng/Downloads/PX4-Autopilot/src/modules/mavlink/mavlink/message_definitions/v1.0/common.xml
Parsing /Users/mengchaoheng/Downloads/PX4-Autopilot/src/modules/mavlink/mavlink/message_definitions/v1.0/common.xml
Validating /Users/mengchaoheng/Downloads/PX4-Autopilot/src/modules/mavlink/mavlink/message_definitions/v1.0/minimal.xml
Parsing /Users/mengchaoheng/Downloads/PX4-Autopilot/src/modules/mavlink/mavlink/message_definitions/v1.0/minimal.xml
Merged enum MAV_CMD
Merged enum MAV_CMD
Found 228 MAVLink message types in 4 XML files
Generating C implementation in directory /Users/mengchaoheng/Downloads/PX4-Autopilot/build/px4_sitl_default/mavlink/development
Generating C implementation in directory /Users/mengchaoheng/Downloads/PX4-Autopilot/build/px4_sitl_default/mavlink/standard
Generating C implementation in directory /Users/mengchaoheng/Downloads/PX4-Autopilot/build/px4_sitl_default/mavlink/common
Generating C implementation in directory /Users/mengchaoheng/Downloads/PX4-Autopilot/build/px4_sitl_default/mavlink/minimal
Copying fixed headers for protocol 2.0 to /Users/mengchaoheng/Downloads/PX4-Autopilot/build/px4_sitl_default/mavlink
[58/853] Performing configure step for 'sitl_gazebo'
-- install-prefix: /usr/local
-- cmake build type: RelWithDebInfo
-- The C compiler identification is AppleClang 13.0.0.13000029
-- The CXX compiler identification is AppleClang 13.0.0.13000029
-- Detecting C compiler ABI info
-- Detecting C compiler ABI info - done
-- Check for working C compiler: /Library/Developer/CommandLineTools/usr/bin/cc - skipped
-- Detecting C compile features
-- Detecting C compile features - done
-- Detecting CXX compiler ABI info
-- Detecting CXX compiler ABI info - done
-- Check for working CXX compiler: /Library/Developer/CommandLineTools/usr/bin/c++ - skipped
-- 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/local/lib/cmake/Boost-1.78.0/BoostConfig.cmake (found suitable version "1.78.0", minimum required is "1.58") found components: system thread filesystem 
CMake Warning (dev) at /usr/local/Cellar/cmake/3.22.2/share/cmake/Modules/FindPackageHandleStandardArgs.cmake:438 (message):
  The package name passed to `find_package_handle_standard_args` (PkgConfig)
  does not match the name of the calling package (gazebo).  This can lead to
  problems in calling code that expects `find_package` result variables
  (e.g., `_FOUND`) to follow a certain pattern.
Call Stack (most recent call first):
  /usr/local/Cellar/cmake/3.22.2/share/cmake/Modules/FindPkgConfig.cmake:99 (find_package_handle_standard_args)
  /usr/local/lib/cmake/gazebo/gazebo-config.cmake:62 (include)
  CMakeLists.txt:48 (find_package)
This warning is for project developers.  Use -Wno-dev to suppress it.

-- Found PkgConfig: /usr/local/bin/pkg-config (found version "0.29.2") 
-- Checking for module 'bullet>=2.82'
--   Found bullet, version 3.20
-- Found fcl: /usr/local/Cellar/fcl/0.7.0/include (found suitable version "0.7.0", minimum required is "0.5.0") 
-- Found assimp: /usr/local/Cellar/assimp/5.2.2/include (found version "5.2.0") 
-- Found DART: /usr/local/include (Required is at least version "6.6") found components: dart 
-- Found Boost: /usr/local/lib/cmake/Boost-1.78.0/BoostConfig.cmake (found suitable version "1.78.0", minimum required is "1.40.0") found components: thread system filesystem program_options regex iostreams date_time 
-- Found Protobuf: /usr/local/lib/libprotobuf.dylib (found version "3.19.4") 
-- Looking for ignition-math6 -- found version 6.10.0
-- 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/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_10/lib/libOgreMain.dylib;debug;/usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_10/lib/libOgreMain.dylib
-- Looking for OGRE_Paging...
-- Found OGRE_Paging: optimized;/usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_10/lib/libOgrePaging.dylib;debug;/usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_10/lib/libOgrePaging.dylib
-- Looking for OGRE_Terrain...
-- Found OGRE_Terrain: optimized;/usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_10/lib/libOgreTerrain.dylib;debug;/usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_10/lib/libOgreTerrain.dylib
-- Looking for OGRE_Property...
-- Found OGRE_Property: optimized;/usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_10/lib/libOgreProperty.dylib;debug;/usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_10/lib/libOgreProperty.dylib
-- Looking for OGRE_RTShaderSystem...
-- Found OGRE_RTShaderSystem: optimized;/usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_10/lib/libOgreRTShaderSystem.dylib;debug;/usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_10/lib/libOgreRTShaderSystem.dylib
-- Looking for OGRE_Volume...
-- Found OGRE_Volume: optimized;/usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_10/lib/libOgreVolume.dylib;debug;/usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_10/lib/libOgreVolume.dylib
-- Looking for OGRE_Overlay...
-- Found OGRE_Overlay: optimized;/usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_10/lib/libOgreOverlay.dylib;debug;/usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_10/lib/libOgreOverlay.dylib
-- Looking for ignition-math6 -- found version 6.10.0
-- Looking for ignition-transport8 -- found version 8.2.1
-- Searching for dependencies of ignition-transport8
-- Found Protobuf: /usr/local/lib/libprotobuf.dylib (found suitable version "3.19.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") 
-- 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.10.0
-- 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  
-- 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.10.0
-- Looking for ignition-fuel_tools4 -- found version 4.4.0
-- Searching for dependencies of ignition-fuel_tools4
-- Found CURL: /Library/Developer/CommandLineTools/SDKs/MacOSX12.1.sdk/usr/lib/libcurl.tbd (found version "7.77.0")  
-- Checking for module 'jsoncpp'
--   Found jsoncpp, version 1.9.4
-- Found JSONCPP: TRUE  
-- Checking for module 'yaml-0.1'
--   Found yaml-0.1, version 0.2.5
-- Found YAML: TRUE  
-- Checking for module 'libzip'
--   Found libzip, version 1.8.0
-- Found ZIP: TRUE  
-- Looking for ignition-common3 -- found version 3.14.0
-- Looking for ignition-math6 -- found version 6.10.0
-- Looking for ignition-msgs5 -- found version 5.8.1
-- Checking for one of the modules 'glib-2.0'
-- Found PythonInterp: /usr/local/bin/python3 (found suitable version "3.9.10", minimum required is "3") 
-- Found OpenCV: /usr/local/Cellar/opencv/4.5.4_4 (found version "4.5.4") 
-- Found TinyXML: /usr/local/lib/libtinyxml.dylib  
-- Checking for module 'gstreamer-1.0 >= 1.0'
--   Found gstreamer-1.0 , version 1.18.5
-- Checking for module 'gstreamer-base-1.0 >= 1.0'
--   Found gstreamer-base-1.0 , version 1.18.5
-- Checking for module 'gstreamer-app-1.0 >= 1.0'
--   Found gstreamer-app-1.0 , version 1.18.5
-- 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 one of the modules 'icu-uc'
-- Checking for module 'OGRE'
--   Found OGRE, version 1.9.0
CMake Deprecation Warning at external/OpticalFlow/CMakeLists.txt:34 (cmake_minimum_required):
  Compatibility with CMake < 2.8.12 will be removed from a future version of
  CMake.

  Update the VERSION argument <min> value or use a ...<max> suffix to tell
  CMake that the project does not need compatibility with older versions.

CMake Deprecation Warning at external/OpticalFlow/external/klt_feature_tracker/CMakeLists.txt:1 (cmake_minimum_required):
  Compatibility with CMake < 2.8.12 will be removed from a future version of
  CMake.

  Update the VERSION argument <min> value or use a ...<max> suffix to tell
  CMake that the project does not need compatibility with older versions.

-- Building klt_feature_tracker without catkin
-- Building OpticalFlow with OpenCV
-- Found MAVLink: /Users/mengchaoheng/Downloads/PX4-Autopilot/build/px4_sitl_default/mavlink (found version "2.0") 
-- catkin DISABLED
-- Found Protobuf: /usr/local/lib/libprotobuf.dylib (found version "3.19.4") 
-- Checking for module 'protobuf'
--   Found protobuf, version 3.19.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: /Users/mengchaoheng/Downloads/PX4-Autopilot/build/px4_sitl_default/build_gazebo
[518/853] Linking CXX static library platforms/common/libpx4_platform.a
/Library/Developer/CommandLineTools/usr/bin/ranlib: file: platforms/common/libpx4_platform.a(i2c.cpp.o) has no symbols
/Library/Developer/CommandLineTools/usr/bin/ranlib: file: platforms/common/libpx4_platform.a(spi.cpp.o) has no symbols
/Library/Developer/CommandLineTools/usr/bin/ranlib: file: platforms/common/libpx4_platform.a(i2c.cpp.o) has no symbols
/Library/Developer/CommandLineTools/usr/bin/ranlib: file: platforms/common/libpx4_platform.a(spi.cpp.o) has no symbols
[611/853] Linking CXX static library src/lib/bezier/libbezier.a
/Library/Developer/CommandLineTools/usr/bin/ranlib: file: src/lib/bezier/libbezier.a(BezierQuad.cpp.o) has no symbols
/Library/Developer/CommandLineTools/usr/bin/ranlib: file: src/lib/bezier/libbezier.a(BezierQuad.cpp.o) has no symbols
[617/853] Linking CXX static library src/lib/slew_rate/libSlewRate.a
/Library/Developer/CommandLineTools/usr/bin/ranlib: file: src/lib/slew_rate/libSlewRate.a(dummy.cpp.o) has no symbols
/Library/Developer/CommandLineTools/usr/bin/ranlib: file: src/lib/slew_rate/libSlewRate.a(dummy.cpp.o) has no symbols
warning: /Library/Developer/CommandLineTools/usr/bin/ranlib: archive library: src/lib/slew_rate/libSlewRate.a the table of contents is empty (no object file members in the library define global symbols)
[633/853] Linking CXX static library src/drivers/camera_trigger/libdrivers__camera_trigger.a
/Library/Developer/CommandLineTools/usr/bin/ranlib: file: src/drivers/camera_trigger/libdrivers__camera_trigger.a(pwm.cpp.o) has no symbols
/Library/Developer/CommandLineTools/usr/bin/ranlib: file: src/drivers/camera_trigger/libdrivers__camera_trigger.a(seagull_map2.cpp.o) has no symbols
/Library/Developer/CommandLineTools/usr/bin/ranlib: file: src/drivers/camera_trigger/libdrivers__camera_trigger.a(gpio.cpp.o) has no symbols
/Library/Developer/CommandLineTools/usr/bin/ranlib: file: src/drivers/camera_trigger/libdrivers__camera_trigger.a(pwm.cpp.o) has no symbols
/Library/Developer/CommandLineTools/usr/bin/ranlib: file: src/drivers/camera_trigger/libdrivers__camera_trigger.a(seagull_map2.cpp.o) has no symbols
/Library/Developer/CommandLineTools/usr/bin/ranlib: file: src/drivers/camera_trigger/libdrivers__camera_trigger.a(gpio.cpp.o) has no symbols
[849/853] Performing build step for 'sitl_gazebo'
[1/130] Generating /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/iris/iris.sdf
/Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/iris/iris.sdf.jinja -> /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/iris/iris.sdf
[2/130] Generating /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/pixhawk/pixhawk.sdf
/Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/pixhawk/pixhawk.sdf.jinja -> /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/pixhawk/pixhawk.sdf
[3/130] Generating /Users/mengchaoheng/Downloads/PX4-Au...ot/Tools/sitl_gazebo/models/3DR_gps_mag/3DR_gps_mag.sdf
/Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/3DR_gps_mag/3DR_gps_mag.sdf.jinja -> /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/3DR_gps_mag/3DR_gps_mag.sdf
[4/130] Generating /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/cloudship/cloudship.sdf
/Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/cloudship/cloudship.sdf.jinja -> /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/cloudship/cloudship.sdf
[5/130] Generating /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/boat/boat.sdf
/Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/boat/boat.sdf.jinja -> /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/boat/boat.sdf
[6/130] Generating /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/c920/c920.sdf
/Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/c920/c920.sdf.jinja -> /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/c920/c920.sdf
[7/130] Generating /Users/mengchaoheng/Downloads/PX4-Au.../Tools/sitl_gazebo/models/depth_camera/depth_camera.sdf
/Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/depth_camera/depth_camera.sdf.jinja -> /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/depth_camera/depth_camera.sdf
[8/130] Generating /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/plane/plane.sdf
/Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/plane/plane.sdf.jinja -> /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/plane/plane.sdf
[9/130] Generating /Users/mengchaoheng/Downloads/PX4-Au...ot/Tools/sitl_gazebo/models/matrice_100/matrice_100.sdf
/Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/matrice_100/matrice_100.sdf.jinja -> /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/matrice_100/matrice_100.sdf
[10/130] Generating /Users/mengchaoheng/Downloads/PX4-A...ools/sitl_gazebo/models/mb1240-xl-ez4/mb1240-xl-ez4.sdf
/Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/mb1240-xl-ez4/mb1240-xl-ez4.sdf.jinja -> /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/mb1240-xl-ez4/mb1240-xl-ez4.sdf
[11/130] Generating /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/px4flow/px4flow.sdf
/Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/px4flow/px4flow.sdf.jinja -> /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/px4flow/px4flow.sdf
[12/130] Generating /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/r200/r200.sdf
/Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/r200/r200.sdf.jinja -> /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/r200/r200.sdf
[13/130] Generating /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/rover/rover.sdf
/Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/rover/rover.sdf.jinja -> /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/rover/rover.sdf
[14/130] Generating /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/r1_rover/r1_rover.sdf
/Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/r1_rover/r1_rover.sdf.jinja -> /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/r1_rover/r1_rover.sdf
[15/130] Generating /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/sf10a/sf10a.sdf
/Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/sf10a/sf10a.sdf.jinja -> /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/sf10a/sf10a.sdf
[17/130] Generating /Users/mengchaoheng/Downloads/PX4-A...gazebo/models/standard_vtol_drop/standard_vtol_drop.sdf
/Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/standard_vtol_drop/standard_vtol_drop.sdf.jinja -> /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/standard_vtol_drop/standard_vtol_drop.sdf
[18/130] Generating /Users/mengchaoheng/Downloads/PX4-A...ools/sitl_gazebo/models/standard_vtol/standard_vtol.sdf
/Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/standard_vtol/standard_vtol.sdf.jinja -> /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/standard_vtol/standard_vtol.sdf
[19/130] Generating /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/tailsitter/tailsitter.sd
/Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/tailsitter/tailsitter.sdf.jinja -> /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/tailsitter/tailsitter.sdf
[21/130] Generating /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/tiltrotor/tiltrotor.sdf
/Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/tiltrotor/tiltrotor.sdf.jinja -> /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/tiltrotor/tiltrotor.sdf
[24/130] Generating /Users/mengchaoheng/Downloads/PX4-A.../Tools/sitl_gazebo/models/typhoon_h480/typhoon_h480.sdf
/Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/typhoon_h480/typhoon_h480.sdf.jinja -> /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/models/typhoon_h480/typhoon_h480.sdf
[58/130] Building CXX object CMakeFiles/gazebo_airspeed_plugin.dir/src/gazebo_airspeed_plugin.cpp.o
FAILED: CMakeFiles/gazebo_airspeed_plugin.dir/src/gazebo_airspeed_plugin.cpp.o 
/usr/local/bin/ccache /Library/Developer/CommandLineTools/usr/bin/c++ -DBOOST_ATOMIC_DYN_LINK -DBOOST_ATOMIC_NO_LIB -DBOOST_DATE_TIME_DYN_LINK -DBOOST_DATE_TIME_NO_LIB -DBOOST_FILESYSTEM_DYN_LINK -DBOOST_FILESYSTEM_NO_LIB -DBOOST_IOSTREAMS_DYN_LINK -DBOOST_IOSTREAMS_NO_LIB -DBOOST_PROGRAM_OPTIONS_DYN_LINK -DBOOST_PROGRAM_OPTIONS_NO_LIB -DBOOST_REGEX_DYN_LINK -DBOOST_REGEX_NO_LIB -DBOOST_SYSTEM_DYN_LINK -DBOOST_SYSTEM_NO_LIB -DBOOST_TEST_DYN_LINK -DBOOST_THREAD_DYN_LINK -DBOOST_THREAD_NO_LIB -DLIBBULLET_VERSION=3.20 -DLIBBULLET_VERSION_GT_282 -Dgazebo_airspeed_plugin_EXPORTS -I/Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/include -I/Users/mengchaoheng/Downloads/PX4-Autopilot/build/px4_sitl_default/build_gazebo -I/usr/local/include/eigen3/eigen3 -I/usr/local/include/gazebo-11/gazebo/msgs -I/Users/mengchaoheng/Downloads/PX4-Autopilot/build/px4_sitl_default/mavlink -I/Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/external/OpticalFlow/include -I/usr/local/Cellar/libffi/3.4.2/include -I/usr/local/Cellar/gstreamer/1.18.5/include/gstreamer-1.0 -I/usr/local/Cellar/glib/2.70.4/include -I/usr/local/Cellar/glib/2.70.4/include/glib-2.0 -I/usr/local/Cellar/glib/2.70.4/lib/glib-2.0/include -I/usr/local/opt/gettext/include -I/usr/local/Cellar/pcre/8.45/include -I/usr/local/Cellar/gst-plugins-base/1.18.5/include/gstreamer-1.0 -isystem /usr/local/include -isystem /usr/local/include/gazebo-11 -isystem /usr/local/Cellar/bullet/3.21/include/bullet -isystem /usr/local/Cellar/bullet/3.21/include -isystem /usr/local/include/simbody -isystem /usr/local/Cellar/sdformat9/9.7.0/include/sdformat-9.7 -isystem /usr/local/include/ignition/math6 -isystem /usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_10/include/OGRE -isystem /usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_10/include -isystem /usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_10/include/OGRE/Terrain -isystem /usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_10/include/OGRE/Paging -isystem /usr/local/include/ignition/transport8 -isystem /usr/local/include/ignition/msgs5 -isystem /usr/local/include/ignition/common3 -isystem /usr/local/include/ignition/fuel_tools4 -iframework /usr/local/opt/qt@5/lib -isystem /usr/local/opt/qt@5/lib/QtCore.framework/Headers -isystem /usr/local/opt/qt@5/./mkspecs/macx-clang -isystem /usr/local/include/eigen3 -isystem /usr/local/Cellar/opencv/4.5.4_4/include/opencv4 -isystem /usr/local/Cellar/fcl/0.7.0/include -isystem /usr/local/Cellar/assimp/5.2.2/include -isystem /usr/local/include/sdformat-9.7/sdf/.. -isystem /usr/local/include/ignition/cmake2 -O2 -g -DNDEBUG -arch x86_64 -isysroot /Library/Developer/CommandLineTools/SDKs/MacOSX12.1.sdk -fPIC -F/Library/Developer/CommandLineTools/SDKs/MacOSX11.sdk/System/Library/Frameworks  -Wno-deprecated-declarations -Wno-address-of-packed-member -std=gnu++17 -MD -MT CMakeFiles/gazebo_airspeed_plugin.dir/src/gazebo_airspeed_plugin.cpp.o -MF CMakeFiles/gazebo_airspeed_plugin.dir/src/gazebo_airspeed_plugin.cpp.o.d -o CMakeFiles/gazebo_airspeed_plugin.dir/src/gazebo_airspeed_plugin.cpp.o -c /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/src/gazebo_airspeed_plugin.cpp
In file included from /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/src/gazebo_airspeed_plugin.cpp:41:
In file included from /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/include/gazebo_airspeed_plugin.h:55:
In file included from /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/include/common.h:29:
In file included from /usr/local/include/gazebo-11/gazebo/gazebo.hh:20:
In file included from /usr/local/include/gazebo-11/gazebo/gazebo_core.hh:19:
In file included from /usr/local/include/gazebo-11/gazebo/common/common.hh:53:
/usr/local/include/gazebo-11/gazebo/common/ffmpeg_inc.h:32:10: fatal error: 'libavcodec/avcodec.h' file not found
#include <libavcodec/avcodec.h>
         ^~~~~~~~~~~~~~~~~~~~~~
1 error generated.
[59/130] Building CXX object CMakeFiles/gazebo_camera_manager_plugin.dir/src/gazebo_camera_manager_plugin.cpp.o
FAILED: CMakeFiles/gazebo_camera_manager_plugin.dir/src/gazebo_camera_manager_plugin.cpp.o 
/usr/local/bin/ccache /Library/Developer/CommandLineTools/usr/bin/c++ -DBOOST_ATOMIC_DYN_LINK -DBOOST_ATOMIC_NO_LIB -DBOOST_DATE_TIME_DYN_LINK -DBOOST_DATE_TIME_NO_LIB -DBOOST_FILESYSTEM_DYN_LINK -DBOOST_FILESYSTEM_NO_LIB -DBOOST_IOSTREAMS_DYN_LINK -DBOOST_IOSTREAMS_NO_LIB -DBOOST_PROGRAM_OPTIONS_DYN_LINK -DBOOST_PROGRAM_OPTIONS_NO_LIB -DBOOST_REGEX_DYN_LINK -DBOOST_REGEX_NO_LIB -DBOOST_SYSTEM_DYN_LINK -DBOOST_SYSTEM_NO_LIB -DBOOST_TEST_DYN_LINK -DBOOST_THREAD_DYN_LINK -DBOOST_THREAD_NO_LIB -DLIBBULLET_VERSION=3.20 -DLIBBULLET_VERSION_GT_282 -Dgazebo_camera_manager_plugin_EXPORTS -I/Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/include -I/Users/mengchaoheng/Downloads/PX4-Autopilot/build/px4_sitl_default/build_gazebo -I/usr/local/include/eigen3/eigen3 -I/usr/local/include/gazebo-11/gazebo/msgs -I/Users/mengchaoheng/Downloads/PX4-Autopilot/build/px4_sitl_default/mavlink -I/Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/external/OpticalFlow/include -I/usr/local/Cellar/libffi/3.4.2/include -I/usr/local/Cellar/gstreamer/1.18.5/include/gstreamer-1.0 -I/usr/local/Cellar/glib/2.70.4/include -I/usr/local/Cellar/glib/2.70.4/include/glib-2.0 -I/usr/local/Cellar/glib/2.70.4/lib/glib-2.0/include -I/usr/local/opt/gettext/include -I/usr/local/Cellar/pcre/8.45/include -I/usr/local/Cellar/gst-plugins-base/1.18.5/include/gstreamer-1.0 -isystem /usr/local/include -isystem /usr/local/include/gazebo-11 -isystem /usr/local/Cellar/bullet/3.21/include/bullet -isystem /usr/local/Cellar/bullet/3.21/include -isystem /usr/local/include/simbody -isystem /usr/local/Cellar/sdformat9/9.7.0/include/sdformat-9.7 -isystem /usr/local/include/ignition/math6 -isystem /usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_10/include/OGRE -isystem /usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_10/include -isystem /usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_10/include/OGRE/Terrain -isystem /usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_10/include/OGRE/Paging -isystem /usr/local/include/ignition/transport8 -isystem /usr/local/include/ignition/msgs5 -isystem /usr/local/include/ignition/common3 -isystem /usr/local/include/ignition/fuel_tools4 -iframework /usr/local/opt/qt@5/lib -isystem /usr/local/opt/qt@5/lib/QtCore.framework/Headers -isystem /usr/local/opt/qt@5/./mkspecs/macx-clang -isystem /usr/local/include/eigen3 -isystem /usr/local/Cellar/opencv/4.5.4_4/include/opencv4 -isystem /usr/local/Cellar/fcl/0.7.0/include -isystem /usr/local/Cellar/assimp/5.2.2/include -isystem /usr/local/include/sdformat-9.7/sdf/.. -isystem /usr/local/include/ignition/cmake2 -O2 -g -DNDEBUG -arch x86_64 -isysroot /Library/Developer/CommandLineTools/SDKs/MacOSX12.1.sdk -fPIC -F/Library/Developer/CommandLineTools/SDKs/MacOSX11.sdk/System/Library/Frameworks  -Wno-deprecated-declarations -Wno-address-of-packed-member -std=gnu++17 -MD -MT CMakeFiles/gazebo_camera_manager_plugin.dir/src/gazebo_camera_manager_plugin.cpp.o -MF CMakeFiles/gazebo_camera_manager_plugin.dir/src/gazebo_camera_manager_plugin.cpp.o.d -o CMakeFiles/gazebo_camera_manager_plugin.dir/src/gazebo_camera_manager_plugin.cpp.o -c /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/src/gazebo_camera_manager_plugin.cpp
In file included from /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/src/gazebo_camera_manager_plugin.cpp:18:
In file included from /Users/mengchaoheng/Downloads/PX4-Autopilot/Tools/sitl_gazebo/include/gazebo_camera_manager_plugin.h:24:
In file included from /usr/local/include/gazebo-11/gazebo/gazebo.hh:20:
In file included from /usr/local/include/gazebo-11/gazebo/gazebo_core.hh:19:
In file included from /usr/local/include/gazebo-11/gazebo/common/common.hh:53:
/usr/local/include/gazebo-11/gazebo/common/ffmpeg_inc.h:32:10: fatal error: 'libavcodec/avcodec.h' file not found
#include <libavcodec/avcodec.h>
         ^~~~~~~~~~~~~~~~~~~~~~
1 error generated.
ninja: build stopped: subcommand failed.
FAILED: external/Stamp/sitl_gazebo/sitl_gazebo-build /Users/mengchaoheng/Downloads/PX4-Autopilot/build/px4_sitl_default/external/Stamp/sitl_gazebo/sitl_gazebo-build 
cd /Users/mengchaoheng/Downloads/PX4-Autopilot/build/px4_sitl_default/build_gazebo && /usr/local/Cellar/cmake/3.22.2/bin/cmake --build /Users/mengchaoheng/Downloads/PX4-Autopilot/build/px4_sitl_default/build_gazebo -- -j 2
ninja: build stopped: subcommand failed.
make: *** [px4_sitl] Error 1
mengchaoheng commented 2 years ago

https://github.com/PX4/PX4-Autopilot/issues/19266

Jaeyoung-Lim commented 2 years ago

@mengchaoheng I dont think gazebo is supported on the m1. Can you run gazebo without px4?

mengchaoheng commented 2 years ago

@mengchaoheng I dont think gazebo is supported on the m1. Can you run gazebo without px4?

Yes! it can run!

Jaeyoung-Lim commented 2 years ago
In file included from /usr/local/include/gazebo-11/gazebo/common/common.hh:53:
/usr/local/include/gazebo-11/gazebo/common/ffmpeg_inc.h:32:10: fatal error: 'libavcodec/avcodec.h' file not found
#include <libavcodec/avcodec.h>

@mengchaoheng But this is from gazebo?

Also, I don't have access to an m1 laptop so unfortunately I cannot test this usecase.

mengchaoheng commented 2 years ago

help please!

In file included from /usr/local/include/gazebo-11/gazebo/common/common.hh:53:
/usr/local/include/gazebo-11/gazebo/common/ffmpeg_inc.h:32:10: fatal error: 'libavcodec/avcodec.h' file not found
#include <libavcodec/avcodec.h>

@mengchaoheng But this is from gazebo?

sorry I don't know. Now I realize my buying the m1 was a huge mistake!!!