Open nello opened 2 years ago
It seems to be the problem of gazebo under mac os
I set the following two environment variables export GAZEBO_PLUGIN_PATH="/Users/mingyu/git/PX4-Autopilot/build/px4_sitl_nolockstep/build_gazebo-classic" export GAZEBO_MODEL_PATH="/Users/mingyu/git/PX4-Autopilot/Tools/simulation/gazebo-classic/sitl_gazebo-classic/models"
Then execute it at two terminals respectively gzserver --verbose /Users/mingyu/git/PX4-Autopilot/Tools/simulation/gazebo-classic/sitl_gazebo-classic/worlds/empty.world
gz model --verbose --spawn-file="/Users/mingyu/git/PX4-Autopilot/Tools/simulation/gazebo-classic/sitl_gazebo-classic/models/iris/iris.sdf" --model-name=iris
As a result, gzserver crashed Gazebo multi-robot simulator, version 11.12.0 Copyright (C) 2012 Open Source Robotics Foundation. Released under the Apache 2 License. http://gazebosim.org
[Msg] Waiting for master.
[Msg] Connected to gazebo master @ http://127.0.0.1:11345
[Msg] Publicized address: 192.168.1.50
[Msg] Loading world file [/Users/mingyu/git/PX4-Autopilot/Tools/simulation/gazebo-classic/sitl_gazebo-classic/worlds/empty.world]
Warning [parser.cc:833] XML Attribute[version] in element[sdf] not defined in SDF, ignoring.
Warning [parser.cc:833] XML Attribute[version] in element[sdf] not defined in SDF, ignoring.
Warning [parser.cc:833] XML Attribute[version] in element[sdf] not defined in SDF, ignoring.
libc++abi: terminating with uncaught exception of type boost::wrapexcept
Hi,
I've been trying to build this on my M1 Mac off and on for a few months now. Each time I give up and go back to my old Macbook Pro. I'm running at latest versions of the Mac OS, Homebrew and all dependencies.
I'm following the instructions here: https://docs.px4.io/main/en/dev_setup/dev_env_mac.html with no real success, having been blocked in the past with the
Ogre
andtbb
issues amongst a host of others.The
jmavsim
simulator seems to work fine, but I've never got PX4-SITL_gazebo working on M1 despite repeated attempts, including completely blowing away my entireHomebrew
installation three times now.The error this time is:
If anyone has any clues, I would be extremely grateful!