Debugging with GDB on Posix hangs

Currently on the stable branch trying to debug a posix sitl build.

When I enter the following command:

make posix gazebo___gdb

I get the following output

➜  Firmware git:(stable) make posix gazebo___gdb
ninja: Entering directory `/Users/dlw/Workspace/FlightWave/Firmware/build/posix_sitl_default'
[3/7] Performing configure step for 'sitl_gazebo'
-- install-prefix: /usr/local
-- Boost version: 1.68.0
-- Found the following Boost libraries:
--   system
--   thread
--   timer
--   chrono
--   date_time
--   atomic
-- Found DART: /usr/local/include (Required is at least version "6") found components:  dart
-- Boost version: 1.68.0
-- Found the following Boost libraries:
--   thread
--   signals
--   system
--   filesystem
--   program_options
--   regex
--   iostreams
--   date_time
--   chrono
--   atomic
-- Boost version: 1.68.0
-- Looking for OGRE...
-- Found Ogre Ghadamon (1.9.0)
-- Looking for OGRE_Paging...
-- Found OGRE_Paging: optimized;/usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_7/lib/libOgrePaging.dylib;debug;/usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_7/lib/libOgrePaging.dylib
-- Looking for OGRE_Terrain...
-- Found OGRE_Terrain: optimized;/usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_7/lib/libOgreTerrain.dylib;debug;/usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_7/lib/libOgreTerrain.dylib
-- Looking for OGRE_Property...
-- Found OGRE_Property: optimized;/usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_7/lib/libOgreProperty.dylib;debug;/usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_7/lib/libOgreProperty.dylib
-- Looking for OGRE_RTShaderSystem...
-- Found OGRE_RTShaderSystem: optimized;/usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_7/lib/libOgreRTShaderSystem.dylib;debug;/usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_7/lib/libOgreRTShaderSystem.dylib
-- Looking for OGRE_Volume...
-- Found OGRE_Volume: optimized;/usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_7/lib/libOgreVolume.dylib;debug;/usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_7/lib/libOgreVolume.dylib
-- Looking for OGRE_Overlay...
-- Found OGRE_Overlay: optimized;/usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_7/lib/libOgreOverlay.dylib;debug;/usr/local/Cellar/ogre1.9/1.9-20160714-108ab0bcc69603dba32c0ffd4bbbc39051f421c9_7/lib/libOgreOverlay.dylib
-- Found Protobuf: /usr/local/lib/libprotobuf.dylib (found suitable version "3.6.1", minimum required is "2.3.0")
-- Config-file not installed for ZeroMQ -- checking for pkg-config
-- Checking for module 'libzmq >= 4'
--   Found libzmq , version 4.2.5
-- Checking for module 'uuid'
--   Found uuid, version 1.6.2
-- Checking for module 'tinyxml2'
--   Found tinyxml2, version 7.0.1
-- Looking for dlfcn.h - found
-- Looking for libdl - found
-- FreeImage.pc not found, we will search for FreeImage_INCLUDE_DIRS and FreeImage_LIBRARIES
-- Checking for module 'gts'
--   Found gts, version 0.7.6
-- Checking for module 'libswscale'
--   Found libswscale, version 5.3.100
-- Checking for module 'libavdevice >= 56.4.100'
--   Found libavdevice , version 58.5.100
-- Checking for module 'libavformat'
--   Found libavformat, version 58.20.100
-- Checking for module 'libavcodec'
--   Found libavcodec, version 58.35.100
-- Checking for module 'libavutil'
--   Found libavutil, version 56.22.100
-- Checking for module 'jsoncpp'
--   Found jsoncpp, version 1.8.4
-- Checking for module 'yaml-0.1'
--   Found yaml-0.1, version 0.2.1
-- Checking for module 'libzip'
--   Found libzip, version 1.5.1
-- Building klt_feature_tracker without catkin
-- Building OpticalFlow with OpenCV
-- catkin DISABLED
-- Found Protobuf: /usr/local/lib/libprotobuf.dylib (found version "3.6.1")
Gazebo version: 9.5
-- Using C++17 compiler
-- Configuring done
-- Generating done
-- Build files have been written to: /Users/dlw/Workspace/FlightWave/Firmware/build/posix_sitl_default/build_gazebo
[4/7] Performing build step for 'sitl_gazebo'
[1/53] Building CXX object CMakeFiles/gazebo_mavlink_interface.dir/src/geo_mag_declination.cpp.o
[2/53] Building CXX object CMakeFiles/sensor_msgs.dir/Groundtruth.pb.cc.o
[3/53] Building CXX object CMakeFiles/sensor_msgs.dir/Range.pb.cc.o
[4/53] Building CXX object CMakeFiles/sensor_msgs.dir/SITLGps.pb.cc.o
[5/53] Building CXX object CMakeFiles/gazebo_gimbal_controller_plugin.dir/src/gazebo_gimbal_controller_plugin.cpp.o
[6/53] Building CXX object CMakeFiles/gazebo_lidar_plugin.dir/src/gazebo_lidar_plugin.cpp.o
[7/53] Building CXX object CMakeFiles/gazebo_uuv_plugin.dir/src/gazebo_uuv_plugin.cpp.o
In file included from /Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/src/gazebo_uuv_plugin.cpp:25:
In file included from /Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/include/gazebo_uuv_plugin.h:23:
/Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/include/common.h:68:10: warning: expression result unused [-Wunused-value]
    for( e_model; e_model; e_model=e_model->NextSiblingElement("model") )
         ^~~~~~~
1 warning generated.
[8/53] Building CXX object CMakeFiles/gazebo_imu_plugin.dir/src/gazebo_imu_plugin.cpp.o
In file included from /Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/src/gazebo_imu_plugin.cpp:21:
In file included from /Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/include/gazebo_imu_plugin.h:33:
/Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/include/common.h:68:10: warning: expression result unused [-Wunused-value]
    for( e_model; e_model; e_model=e_model->NextSiblingElement("model") )
         ^~~~~~~
1 warning generated.
[9/53] Building CXX object CMakeFiles/gazebo_vision_plugin.dir/src/gazebo_vision_plugin.cpp.o
In file included from /Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/src/gazebo_vision_plugin.cpp:41:
In file included from /Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/include/gazebo_vision_plugin.h:46:
/Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/include/common.h:68:10: warning: expression result unused [-Wunused-value]
    for( e_model; e_model; e_model=e_model->NextSiblingElement("model") )
         ^~~~~~~
1 warning generated.
[10/53] Building CXX object CMakeFiles/gazebo_controller_interface.dir/src/gazebo_controller_interface.cpp.o
In file included from /Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/src/gazebo_controller_interface.cpp:22:
In file included from /Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/include/gazebo_controller_interface.h:36:
/Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/include/common.h:68:10: warning: expression result unused [-Wunused-value]
    for( e_model; e_model; e_model=e_model->NextSiblingElement("model") )
         ^~~~~~~
1 warning generated.
[11/53] Building CXX object CMakeFiles/mav_msgs.dir/CommandMotorSpeed.pb.cc.o
[12/53] Building CXX object CMakeFiles/gazebo_sonar_plugin.dir/src/gazebo_sonar_plugin.cpp.o
[13/53] Building CXX object CMakeFiles/mav_msgs.dir/MotorSpeed.pb.cc.o
[14/53] Linking CXX shared library libmav_msgs.dylib
[15/53] Building CXX object CMakeFiles/gazebo_gps_plugin.dir/src/gazebo_gps_plugin.cpp.o
In file included from /Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/src/gazebo_gps_plugin.cpp:27:
In file included from /Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/include/gazebo_gps_plugin.h:37:
/Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/include/common.h:68:10: warning: expression result unused [-Wunused-value]
    for( e_model; e_model; e_model=e_model->NextSiblingElement("model") )
         ^~~~~~~
1 warning generated.
[16/53] Building CXX object CMakeFiles/sensor_msgs.dir/OpticalFlow.pb.cc.o
[17/53] Building CXX object CMakeFiles/sensor_msgs.dir/IRLock.pb.cc.o
[18/53] Building CXX object CMakeFiles/sensor_msgs.dir/Imu.pb.cc.o
[19/53] Building CXX object OpticalFlow/CMakeFiles/OpticalFlow.dir/src/px4flow.cpp.o
[20/53] Building CXX object OpticalFlow/CMakeFiles/OpticalFlow.dir/src/optical_flow.cpp.o
[21/53] Building CXX object OpticalFlow/CMakeFiles/OpticalFlow.dir/src/flow_px4.cpp.o
[22/53] Building CXX object CMakeFiles/sensor_msgs.dir/Float.pb.cc.o
[23/53] Linking CXX shared library libsensor_msgs.dylib
[24/53] Building CXX object CMakeFiles/std_msgs.dir/Int32.pb.cc.o
[25/53] Building CXX object CMakeFiles/gazebo_mavlink_interface.dir/src/gazebo_mavlink_interface.cpp.o
In file included from /Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/src/gazebo_mavlink_interface.cpp:22:
In file included from /Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/include/gazebo_mavlink_interface.h:56:
/Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/include/common.h:68:10: warning: expression result unused [-Wunused-value]
    for( e_model; e_model; e_model=e_model->NextSiblingElement("model") )
         ^~~~~~~
In file included from /Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/src/gazebo_mavlink_interface.cpp:22:
In file included from /Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/include/gazebo_mavlink_interface.h:67:
In file included from /Users/dlw/Workspace/FlightWave/Firmware/mavlink/include/mavlink/v2.0/common/mavlink.h:32:
In file included from /Users/dlw/Workspace/FlightWave/Firmware/mavlink/include/mavlink/v2.0/common/common.h:30:
In file included from /Users/dlw/Workspace/FlightWave/Firmware/mavlink/include/mavlink/v2.0/common/../protocol.h:83:
/Users/dlw/Workspace/FlightWave/Firmware/mavlink/include/mavlink/v2.0/common/../mavlink_helpers.h:248:25: warning: taking address of packed member 'checksum' of class or structure '__mavlink_message' may result in an unaligned pointer value [-Waddress-of-packed-member]
        crc_accumulate_buffer(&msg->checksum, _MAV_PAYLOAD(msg), msg->len);
                               ^~~~~~~~~~~~~
/Users/dlw/Workspace/FlightWave/Firmware/mavlink/include/mavlink/v2.0/common/../mavlink_helpers.h:249:29: warning: taking address of packed member 'checksum' of class or structure '__mavlink_message' may result in an unaligned pointer value [-Waddress-of-packed-member]
        crc_accumulate(crc_extra, &msg->checksum);
                                   ^~~~~~~~~~~~~
/Users/dlw/Workspace/FlightWave/Firmware/mavlink/include/mavlink/v2.0/common/../mavlink_helpers.h:472:12: warning: taking address of packed member 'checksum' of class or structure '__mavlink_message' may result in an unaligned pointer value [-Waddress-of-packed-member]
        crc_init(&msg->checksum);
                  ^~~~~~~~~~~~~
/Users/dlw/Workspace/FlightWave/Firmware/mavlink/include/mavlink/v2.0/common/../mavlink_helpers.h:477:21: warning: taking address of packed member 'checksum' of class or structure '__mavlink_message' may result in an unaligned pointer value [-Waddress-of-packed-member]
        crc_accumulate(c, &msg->checksum);
                           ^~~~~~~~~~~~~
In file included from /Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/src/gazebo_mavlink_interface.cpp:22:
In file included from /Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/include/gazebo_mavlink_interface.h:56:
/Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/include/common.h:68:10: warning: expression result unused [-Wunused-value]
    for( e_model; e_model; e_model=e_model->NextSiblingElement("model") )
         ^~~~~~~
/Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/src/gazebo_mavlink_interface.cpp:284:3: note: in instantiation of function template specialization 'gazebo::model_param<int>' requested here
  model_param(worldName, model_->GetName(), "mavlink_udp_port", mavlink_udp_port_);
  ^
6 warnings generated.
[26/53] Linking CXX shared library libstd_msgs.dylib
[27/53] Building CXX object CMakeFiles/nav_msgs.dir/Odometry.pb.cc.o
[28/53] Linking CXX shared library libnav_msgs.dylib
[29/53] Linking CXX shared library libgazebo_lidar_plugin.dylib
[30/53] Linking CXX shared library libgazebo_vision_plugin.dylib
[31/53] Linking CXX shared library libgazebo_controller_interface.dylib
[32/53] Linking CXX shared library libgazebo_mavlink_interface.dylib
[33/53] Linking CXX shared library libgazebo_gps_plugin.dylib
[34/53] Building CXX object OpticalFlow/CMakeFiles/OpticalFlow.dir/src/flow_opencv.cpp.o
[35/53] Linking CXX shared library libgazebo_imu_plugin.dylib
[36/53] Linking CXX shared library libgazebo_gimbal_controller_plugin.dylib
[37/53] Linking CXX shared library libgazebo_sonar_plugin.dylib
[38/53] Linking CXX shared library libgazebo_uuv_plugin.dylib
[39/53] Building CXX object OpticalFlow/klt_feature_tracker/CMakeFiles/klt_feature_tracker.dir/src/trackFeatures.cpp.o
[40/53] Linking CXX static library OpticalFlow/klt_feature_tracker/libklt_feature_tracker.a
[41/53] Linking CXX shared library OpticalFlow/libOpticalFlow.dylib
[42/53] Building CXX object CMakeFiles/gazebo_opticalflow_plugin.dir/src/gazebo_opticalflow_plugin.cpp.o
[43/53] Linking CXX shared library libgazebo_opticalflow_plugin.dylib
[44/53] Building CXX object CMakeFiles/LiftDragPlugin.dir/src/liftdrag_plugin/liftdrag_plugin.cpp.o
In file included from /Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/src/liftdrag_plugin/liftdrag_plugin.cpp:21:
/Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/include/common.h:68:10: warning: expression result unused [-Wunused-value]
    for( e_model; e_model; e_model=e_model->NextSiblingElement("model") )
         ^~~~~~~
1 warning generated.
[45/53] Linking CXX shared library libLiftDragPlugin.dylib
[46/53] Building CXX object CMakeFiles/gazebo_multirotor_base_plugin.dir/src/gazebo_multirotor_base_plugin.cpp.o
In file included from /Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/src/gazebo_multirotor_base_plugin.cpp:21:
In file included from /Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/include/gazebo_multirotor_base_plugin.h:29:
/Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/include/common.h:68:10: warning: expression result unused [-Wunused-value]
    for( e_model; e_model; e_model=e_model->NextSiblingElement("model") )
         ^~~~~~~
1 warning generated.
[47/53] Building CXX object CMakeFiles/gazebo_irlock_plugin.dir/src/gazebo_irlock_plugin.cpp.o
[48/53] Linking CXX shared library libgazebo_multirotor_base_plugin.dylib
[49/53] Linking CXX shared library libgazebo_irlock_plugin.dylib
[50/53] Building CXX object CMakeFiles/gazebo_motor_model.dir/src/gazebo_motor_model.cpp.o
In file included from /Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/src/gazebo_motor_model.cpp:22:
In file included from /Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/include/gazebo_motor_model.h:38:
/Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/include/common.h:68:10: warning: expression result unused [-Wunused-value]
    for( e_model; e_model; e_model=e_model->NextSiblingElement("model") )
         ^~~~~~~
1 warning generated.
[51/53] Linking CXX shared library libgazebo_motor_model.dylib
[52/53] Building CXX object CMakeFiles/gazebo_geotagged_images_plugin.dir/src/gazebo_geotagged_images_plugin.cpp.o
In file included from /Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/src/gazebo_geotagged_images_plugin.cpp:18:
In file included from /Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/include/gazebo_geotagged_images_plugin.h:20:
In file included from /Users/dlw/Workspace/FlightWave/Firmware/mavlink/include/mavlink/v2.0/common/mavlink.h:32:
In file included from /Users/dlw/Workspace/FlightWave/Firmware/mavlink/include/mavlink/v2.0/common/common.h:30:
In file included from /Users/dlw/Workspace/FlightWave/Firmware/mavlink/include/mavlink/v2.0/common/../protocol.h:83:
/Users/dlw/Workspace/FlightWave/Firmware/mavlink/include/mavlink/v2.0/common/../mavlink_helpers.h:248:25: warning: taking address of packed member 'checksum' of class or structure '__mavlink_message' may result in an unaligned pointer value [-Waddress-of-packed-member]
        crc_accumulate_buffer(&msg->checksum, _MAV_PAYLOAD(msg), msg->len);
                               ^~~~~~~~~~~~~
/Users/dlw/Workspace/FlightWave/Firmware/mavlink/include/mavlink/v2.0/common/../mavlink_helpers.h:249:29: warning: taking address of packed member 'checksum' of class or structure '__mavlink_message' may result in an unaligned pointer value [-Waddress-of-packed-member]
        crc_accumulate(crc_extra, &msg->checksum);
                                   ^~~~~~~~~~~~~
/Users/dlw/Workspace/FlightWave/Firmware/mavlink/include/mavlink/v2.0/common/../mavlink_helpers.h:472:12: warning: taking address of packed member 'checksum' of class or structure '__mavlink_message' may result in an unaligned pointer value [-Waddress-of-packed-member]
        crc_init(&msg->checksum);
                  ^~~~~~~~~~~~~
/Users/dlw/Workspace/FlightWave/Firmware/mavlink/include/mavlink/v2.0/common/../mavlink_helpers.h:477:21: warning: taking address of packed member 'checksum' of class or structure '__mavlink_message' may result in an unaligned pointer value [-Waddress-of-packed-member]
        crc_accumulate(c, &msg->checksum);
                           ^~~~~~~~~~~~~
4 warnings generated.
[53/53] Linking CXX shared library libgazebo_geotagged_images_plugin.dylib
[6/7] cd /Users/dlw/Workspace/FlightWave/Firmware/build/posix_sitl_defa...mware /Users/dlw/Workspace/FlightWave/Firmware/build/posix_sitl_default
args: /Users/dlw/Workspace/FlightWave/Firmware/build/posix_sitl_default/px4 posix-configs/SITL/init/ekf2 gdb gazebo none /Users/dlw/Workspace/FlightWave/Firmware /Users/dlw/Workspace/FlightWave/Firmware/build/posix_sitl_default
SITL ARGS
sitl_bin: /Users/dlw/Workspace/FlightWave/Firmware/build/posix_sitl_default/px4
rcS_dir: posix-configs/SITL/init/ekf2
debugger: gdb
program: gazebo
model: none
src_path: /Users/dlw/Workspace/FlightWave/Firmware
build_path: /Users/dlw/Workspace/FlightWave/Firmware/build/posix_sitl_default
empty model, setting iris as default
GAZEBO_PLUGIN_PATH /Users/dlw/Workspace/Flightwave/Firmware/build/posix_sitl_default/build_gazebo:/Users/dlw/Workspace/FlightWave/Firmware/build/posix_sitl_default/build_gazebo
GAZEBO_MODEL_PATH /Users/dlw/Workspace/Flightwave/Firmware/Tools/sitl_gazebo/models:/usr/local/Cellar/gazebo9/9.5.0/share/gazebo-9/models::/Users/dlw/Workspace/FlightWave/Firmware/Tools/sitl_gazebo/models
LD_LIBRARY_PATH :/Users/dlw/Workspace/FlightWave/Firmware/build/posix_sitl_default/build_gazebo
Gazebo multi-robot simulator, version 9.5.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: 10.120.117.153
[Msg] Home latitude is set to 34.174528.
[Msg] Home longitude is set to -118.481175.
[Msg] Home altitude is set to 0.
[Msg] Home altitude is set to 0.
[Dbg] [gazebo_mavlink_interface.cpp:138] <joint_name> not found for channel[0] no joint control will be performed for this channel.
[Dbg] [gazebo_mavlink_interface.cpp:138] <joint_name> not found for channel[1] no joint control will be performed for this channel.
[Dbg] [gazebo_mavlink_interface.cpp:138] <joint_name> not found for channel[2] no joint control will be performed for this channel.
[Dbg] [gazebo_mavlink_interface.cpp:138] <joint_name> not found for channel[3] no joint control will be performed for this channel.
[Wrn] [gazebo_mavlink_interface.cpp:127] joint [zephyr_delta_wing::propeller_joint] not found for channel[4] no joint control for this channel.
[Wrn] [gazebo_mavlink_interface.cpp:127] joint [zephyr_delta_wing::flap_left_joint] not found for channel[5] no joint control for this channel.
[Wrn] [gazebo_mavlink_interface.cpp:127] joint [zephyr_delta_wing::flap_right_joint] not found for channel[6] no joint control for this channel.
[Dbg] [gazebo_mavlink_interface.cpp:138] <joint_name> not found for channel[7] no joint control will be performed for this channel.
[Msg] Using MAVLink protocol v2.0
SITL COMMAND: /Users/dlw/Workspace/FlightWave/Firmware/build/posix_sitl_default/px4 /Users/dlw/Workspace/FlightWave/Firmware /Users/dlw/Workspace/FlightWave/Firmware/posix-configs/SITL/init/ekf2/iris
Gazebo multi-robot simulator, version 9.5.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: 10.120.117.153
GNU gdb (GDB) 8.2
Copyright (C) 2018 Free Software Foundation, Inc.
License GPLv3+: GNU GPL version 3 or later <http://gnu.org/licenses/gpl.html>
This is free software: you are free to change and redistribute it.
There is NO WARRANTY, to the extent permitted by law.
Type "show copying" and "show warranty" for details.
This GDB was configured as "x86_64-apple-darwin18.2.0".
Type "show configuration" for configuration details.
For bug reporting instructions, please see:
<http://www.gnu.org/software/gdb/bugs/>.
Find the GDB manual and other documentation resources online at:
    <http://www.gnu.org/software/gdb/documentation/>.

For help, type "help".
Type "apropos word" to search for commands related to "word"...
Reading symbols from /Users/dlw/Workspace/FlightWave/Firmware/build/posix_sitl_default/px4...[Wrn] [Publisher.cc:141] Queue limit reached for topic /gazebo/default/iris/imu, deleting message. This warning is printed only once.
done.
[New Thread 0x2803 of process 94458]
[Wrn] [GuiIface.cc:120] Failed to get QCocoaScreen for NSObject(0x0)
[Wrn] [Publisher.cc:141] Queue limit reached for topic /gazebo/default/iris/motors, deleting message. This warning is printed only once.

All I can do is hit Ctrl+C and then the following happens:

^C[Wrn] [Publisher.cc:141] Queue limit reached for topic /gazebo/default/iris/motor_speed/0, deleting message. This warning is printed only once.
[Wrn] [Publisher.cc:141] Queue limit reached for topic /gazebo/default/iris/motor_speed/1, deleting message. This warning is printed only once.
[Wrn] [Publisher.cc:141] Queue limit reached for topic /gazebo/default/iris/motor_speed/2, deleting message. This warning is printed only once.
[Wrn] [Publisher.cc:141] Queue limit reached for topic /gazebo/default/iris/motor_speed/3, deleting message. This warning is printed only once.
[Err] [Connection.hh:210] AsyncRead on a closed socket
[Wrn] [Publisher.cc:141] Queue limit reached for topic /gazebo/default/iris/groundtruth, deleting message. This warning is printed only once.
[Wrn] [Publisher.cc:141] Queue limit reached for topic /gazebo/default/physics/contacts, deleting message. This warning is printed only once.

I get no gdb prompt or anything. The system just hangs and I have to restart my terminal.