Make px4_sitl gazebo OS X 10.15 error protobuf module not found

Hello All, I hope you are well. I’ve been away from the drone world but getting back into it. I’ve installed the development setup according to the documentation, and I have been attempting to run SITL with gazebo. I can get jmavsim to run no problem, but have had a challenge with gazebo. I suspect I have some issues with python3 having multiple installation versions and after attempting to remove the extra ones have been simply answering the various errors such as missing the bullet library though it was installed, then OGRE and one or two others. Now I have a protobuf issue. Here is the output, I have attempted adding to the path and pkg_config_path variables the locations of protobuf but am stuck. I am quite behind on this and any input would be appreciated. In the long run I’d like to correct the python issue, in the shortrun I have to make it work so I can get on to the real work I’m addressing. Here is the output:

make px4_sitl gazebo

[10/853] git submodule src/drivers/gps/devices

[205/853] git submodule Tools/sitl_gazebo

[230/853] git submodule src/modules/mavlink/mavlink

[232/853] Performing configure step for ‘sitl_gazebo’

– install-prefix: /usr/local

– cmake build type: RelWithDebInfo

– 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.3/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.3/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 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

– Looking for ignition-math6 – found version 6.10.0

– Searching for dependencies of ignition-math6

– Looking for OGRE…

– 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

– 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

– Searching for 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

– Checking for module ‘jsoncpp’

– Found jsoncpp, version 1.9.4

– Checking for module ‘yaml-0.1’

– Found yaml-0.1, version 0.2.5

– Checking for module ‘libzip’

– Found libzip, version 1.8.0

– 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 module ‘OGRE’

– No package ‘OGRE’ found

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 value or use a … 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 value or use a … suffix to tell

CMake that the project does not need compatibility with older versions.

– Building klt_feature_tracker without catkin

– Building OpticalFlow with OpenCV

– catkin DISABLED

– Found Protobuf: /usr/local/lib/libprotobuf.dylib (found version “3.19.4”)

– Checking for module ‘protobuf’

– No package ‘protobuf’ found

CMake Error at CMakeLists.txt:147 (message):

protobuf version: not compatible, must be >= 2.5.0

– Configuring incomplete, errors occurred!

See also “/Users/nss/Documents/RIIS/code/PX4-Autopilot/build/px4_sitl_default/build_gazebo/CMakeFiles/CMakeOutput.log”.

[328/853] Linking CXX static library src/lib/parameters/libparameters.a

FAILED: external/Stamp/sitl_gazebo/sitl_gazebo-configure /Users/nss/Documents/RIIS/code/PX4-Autopilot/build/px4_sitl_default/external/Stamp/sitl_gazebo/sitl_gazebo-configure

cd /Users/nss/Documents/RIIS/code/PX4-Autopilot/build/px4_sitl_default/build_gazebo && /usr/local/Cellar/cmake/3.22.3/bin/cmake -DCMAKE_INSTALL_PREFIX=/usr/local -DSEND_ODOMETRY_DATA=ON -DGENERATE_ROS_MODELS=ON -GNinja /Users/nss/Documents/RIIS/code/PX4-Autopilot/Tools/sitl_gazebo && /usr/local/Cellar/cmake/3.22.3/bin/cmake -E touch /Users/nss/Documents/RIIS/code/PX4-Autopilot/build/px4_sitl_default/external/Stamp/sitl_gazebo/sitl_gazebo-configure

[334/853] Generating px4 event json file from source

ninja: build stopped: subcommand failed.

make: *** [px4_sitl] Error 1