Open zsRDPR opened 2 years ago
export PATH=“$PATH:"/usr/local/Cellar/bullet/3.21/lib/""
finds it, however I still suspect it's an issue with my python installations. I tried removing and reinstalling python after removing all the associated PX4 tools so it would be a clean installation but I'm still having issues. So overall protobuf is located and now I get further after addressing a similar issue to above with OGRE. The new message is :
-- 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 <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
-- 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".
[1/6] Generating ../../logs
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
ninja: build stopped: subcommand failed.
make: *** [px4_sitl] Error 1
any help would be appreciated - I haven't been successful adding the associated protobuf or protoc paths to either PATH or PKG_CONFIG_PATH. There is only one installation of protobuf, it appears to be acceptable especially as it's found earlier in the compilation process and a 'which' command only finds one copy.
Hi All, I have been working on getting SITL with gazebo running and have run against a bit of a wall. I'm fairly sure it's a python looking in the wrong place issue since my installation has 3.7 and 3.9, and initially I had issues with some dependencies being installed in 3.7 but px4 looking in 3.9 for the make command. I created an alias as per instructions to the 3.9 installation of pip3 and that resolved the earlier dependency issue. I'm left with the following error and output. Any help as soon as possible would be great, I know it's a simple thing at this point but could use a little input.