Make Gazebo sitl

Hi Im newbee, I am trying to make px4_sitl gazebo on a MacOS, but get the error, see below. Any knows what I am doing wrong? I have followed the setup.

FAILED: CMakeFiles/gazebo_gst_camera_plugin.dir/src/gazebo_gst_camera_plugin.cpp.o
/usr/local/bin/ccache /Library/Developer/CommandLineTools/usr/bin/c++ -DBOOST_ALL_NO_LIB -DBOOST_DATE_TIME_DYN_LINK -DBOOST_FILESYSTEM_DYN_LINK -DBOOST_IOSTREAMS_DYN_LINK -DBOOST_PROGRAM_OPTIONS_DYN_LINK -DBOOST_REGEX_DYN_LINK -DBOOST_SYSTEM_DYN_LINK -DBOOST_TEST_DYN_LINK -DBOOST_THREAD_DYN_LINK -DLIBBULLET_VERSION=3.17 -DLIBBULLET_VERSION_GT_282 -Dgazebo_gst_camera_plugin_EXPORTS -I/Users/razzdk/PX4-Autopilot/Tools/sitl_gazebo/include -I/Users/razzdk/PX4-Autopilot/build/px4_sitl_default/build_gazebo -I/usr/local/include/eigen3/eigen3 -I/usr/local/include/gazebo-11/gazebo/msgs -I/Users/razzdk/PX4-Autopilot/mavlink/include -I/usr/local/include/Paging -I/Users/razzdk/PX4-Autopilot/Tools/sitl_gazebo/external/OpticalFlow/include -I/usr/local/Cellar/libffi/3.3_3/include -I/usr/local/Cellar/gstreamer/1.18.4/include/gstreamer-1.0 -I/usr/local/Cellar/glib/2.68.3/include -I/usr/local/Cellar/glib/2.68.3/include/glib-2.0 -I/usr/local/Cellar/glib/2.68.3/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.4/include/gstreamer-1.0 -isystem /usr/local/include -isystem /usr/local/include/gazebo-11 -isystem /usr/local/Cellar/bullet/3.17/include/bullet -isystem /usr/local/Cellar/bullet/3.17/include -isystem /usr/local/include/simbody -isystem /usr/local/Cellar/sdformat9/9.5.0_1/include/sdformat-9.5 -isystem /usr/local/include/ignition/math6 -isystem /usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_9/include -isystem /usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_9/include/OGRE -isystem /usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_9/include/OGRE/Terrain -isystem /usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_9/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.3_2/include/opencv4 -isystem /usr/local/Cellar/fcl/0.6.1/include -isystem /usr/local/include/sdformat-9.5/sdf/… -isystem /usr/local/include/ignition/cmake2 -O2 -g -DNDEBUG -isysroot /Library/Developer/CommandLineTools/SDKs/MacOSX11.3.sdk -fPIC -Wno-deprecated-declarations -Wno-address-of-packed-member -std=gnu++17 -MD -MT CMakeFiles/gazebo_gst_camera_plugin.dir/src/gazebo_gst_camera_plugin.cpp.o -MF CMakeFiles/gazebo_gst_camera_plugin.dir/src/gazebo_gst_camera_plugin.cpp.o.d -o CMakeFiles/gazebo_gst_camera_plugin.dir/src/gazebo_gst_camera_plugin.cpp.o -c /Users/razzdk/PX4-Autopilot/Tools/sitl_gazebo/src/gazebo_gst_camera_plugin.cpp
In file included from /Users/razzdk/PX4-Autopilot/Tools/sitl_gazebo/src/gazebo_gst_camera_plugin.cpp:24:
In file included from /Users/razzdk/PX4-Autopilot/Tools/sitl_gazebo/include/gazebo_gst_camera_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:21:
In file included from /usr/local/include/gazebo-11/gazebo/transport/transport.hh:3:
/usr/local/include/gazebo-11/gazebo/transport/Connection.hh:57:65: error: expected class name
class GZ_TRANSPORT_VISIBLE ConnectionReadTask : public tbb::task
^
/usr/local/include/gazebo-11/gazebo/transport/Connection.hh:73:20: error: no type named ‘task’ in namespace ‘tbb’
public: tbb::task *execute()
~~~~~^
/usr/local/include/gazebo-11/gazebo/transport/Connection.hh:313:61: error: no member named ‘allocate_root’ in namespace ‘tbb::v1::task’
ConnectionReadTask *task = new(tbb::task::allocate_root())
~^
/usr/local/include/gazebo-11/gazebo/transport/Connection.hh:315:19: error: no type named ‘enqueue’ in namespace ‘tbb::v1::task’; did you mean ‘ifqueue’?
tbb::task::enqueue(*task);
^

/Library/Developer/CommandLineTools/SDKs/MacOSX11.3.sdk/usr/include/net/if_var.h:230:9: note: ‘ifqueue’ declared here
struct ifqueue {
^
In file included from /Users/razzdk/PX4-Autopilot/Tools/sitl_gazebo/src/gazebo_gst_camera_plugin.cpp:24:
In file included from /Users/razzdk/PX4-Autopilot/Tools/sitl_gazebo/include/gazebo_gst_camera_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:21:
In file included from /usr/local/include/gazebo-11/gazebo/transport/transport.hh:6:
/usr/local/include/gazebo-11/gazebo/transport/Node.hh:39:58: error: expected class name
class GZ_TRANSPORT_VISIBLE PublishTask : public tbb::task
^
/usr/local/include/gazebo-11/gazebo/transport/Node.hh:54:20: error: no type named ‘task’ in namespace ‘tbb’
public: tbb::task *execute()
~~~~~^
/usr/local/include/gazebo-11/gazebo/transport/Node.hh:162:52: error: no member named ‘allocate_root’ in namespace ‘tbb::v1::task’
PublishTask *task = new(tbb::task::allocate_root())
~^
/usr/local/include/gazebo-11/gazebo/transport/Node.hh:165:17: error: no type named ‘enqueue’ in namespace ‘tbb::v1::task’; did you mean ‘ifqueue’?
tbb::task::enqueue(*task);
^

/Library/Developer/CommandLineTools/SDKs/MacOSX11.3.sdk/usr/include/net/if_var.h:230:9: note: ‘ifqueue’ declared here
struct ifqueue {
^
8 errors generated.
ninja: build stopped: subcommand failed.
FAILED: external/Stamp/sitl_gazebo/sitl_gazebo-build /Users/razzdk/PX4-Autopilot/build/px4_sitl_default/external/Stamp/sitl_gazebo/sitl_gazebo-build
cd /Users/razzdk/PX4-Autopilot/build/px4_sitl_default/build_gazebo && /usr/local/Cellar/cmake/3.21.1/bin/cmake --build /Users/razzdk/PX4-Autopilot/build/px4_sitl_default/build_gazebo – -j 6
ninja: build stopped: subcommand failed.
make: *** [px4_sitl] Error 1

Same error as Errors while it is building for the gazebo simulation - #3 by matthewoots, please refer to the link and try to use Gazebo 9 and see whether the error still persist