Connect QGroundControl with jMAVSim or Gazebo

I am trying to connect QGroundControl with Gazebo but its not working.
After failure I tried to connect QGroundControl with jMAVSim that didn’t worked either.

To run the Gazebo, I am using the following command but didn’t worked. (Output is given at the end of this post)
make px4_sitl gazebo_plane

Here is the output if I try to run jMAVSim simulator.

bilal@bilal-ubuntu:~/Simulator_Gazebo/Firmware$ make px4_sitl jMAVSim
ninja: error: unknown target ‘jMAVSim’
Makefile:205: recipe for target ‘px4_sitl’ failed
make: *** [px4_sitl] Error 1

I installed the following things in the given order:

STEP 1: Get Gazeebo Script
wget https://raw.githubusercontent.com/PX4/Firmware/v1.10.0/Tools/setup/ubuntu.sh
wget https://raw.githubusercontent.com/PX4/Firmware/v1.10.0/Tools/setup/requirements.txt

STEP 2: Install Gazeebo from Script
source ubuntu.sh

STEP 3: Get PX4 Firmware
git clone GitHub - PX4/PX4-Autopilot: PX4 Autopilot Software
make posix gazebo_plane
make px4_sitl gazebo_plane

STEP 4: Get QGroundControl
https://s3-us-west-2.amazonaws.com/qgroundcontrol/latest/QGroundControl.AppImage

STEP 5: Run QGroundControl
chmod +x ./QGroundControl.AppImage
./QGroundControl.AppImage

Here is the directory structure I am following:
…\Simulator_Gazebo\Firmware(Clone of Step 3 PX4)
…\Simulator_Gazebo\gazebo\ubuntu.sh
…\Simulator_Gazebo\gazebo\requirements.txt
…\Simulator_Gazebo\qgc\QGroundControl.AppImage

Please let me know what I am doing wrong here?

OUTPUT OF GAZEBO RUN COMMAND

bilal@bilal-ubuntu:~/Simulator_Gazebo$ git clone GitHub - PX4/PX4-Autopilot: PX4 Autopilot Software
Cloning into ‘Firmware’…
remote: Enumerating objects: 40, done.
remote: Counting objects: 100% (40/40), done.
remote: Compressing objects: 100% (33/33), done.
remote: Total 311493 (delta 16), reused 15 (delta 7), pack-reused 311453
Receiving objects: 100% (311493/311493), 112.36 MiB | 2.58 MiB/s, done.
Resolving deltas: 100% (233765/233765), done.

bilal@bilal-ubuntu:~/Simulator_Gazebo$ cd Firmware/

bilal@bilal-ubuntu:~/Simulator_Gazebo/Firmware$ make px4_sitl gazebo_plane
– PX4 version: v1.11.0-beta1-752-g2da38ae81c
– PX4 config file: /home/bilal/Simulator_Gazebo/Firmware/boards/px4/sitl/default.cmake
– PX4 config: px4_sitl_default
– PX4 platform: posix
– PX4 lockstep: enabled
– cmake build type: RelWithDebInfo
– The CXX compiler identification is GNU 7.5.0
– The C compiler identification is GNU 7.5.0
– The ASM compiler identification is GNU
– Found assembler: /usr/bin/cc
– Check for working CXX compiler: /usr/bin/c++
– Check for working CXX compiler: /usr/bin/c++ – works
– Detecting CXX compiler ABI info
– Detecting CXX compiler ABI info - done
– Detecting CXX compile features
– Detecting CXX compile features - done
– Check for working C compiler: /usr/bin/cc
– Check for working C compiler: /usr/bin/cc – works
– Detecting C compiler ABI info
– Detecting C compiler ABI info - done
– Detecting C compile features
– Detecting C compile features - done
– Building for code coverage
– ccache enabled (export CCACHE_DISABLE=1 to disable)
– Found PythonInterp: /usr/bin/python3 (found suitable version “3.6.9”, minimum required is “3”)
– build type is RelWithDebInfo
– PX4 ECL: Very lightweight Estimation & Control Library v1.9.0-rc1-225-g230c865
– Configuring done
– Generating done
– Build files have been written to: /home/bilal/Simulator_Gazebo/Firmware/build/px4_sitl_default
[0/731] git submodule src/drivers/gps/devices
[1/731] git submodule src/lib/ecl
[2/731] git submodule mavlink/include/mavlink/v2.0
[3/731] git submodule Tools/sitl_gazebo
[9/731] Performing configure step for ‘sitl_gazebo’
– install-prefix: /usr/local
– The C compiler identification is GNU 7.5.0
– The CXX compiler identification is GNU 7.5.0
– Check for working C compiler: /usr/bin/cc
– Check for working C compiler: /usr/bin/cc – works
– Detecting C compiler ABI info
– Detecting C compiler ABI info - done
– Detecting C compile features
– Detecting C compile features - done
– Check for working CXX compiler: /usr/bin/c++
– Check for working CXX compiler: /usr/bin/c++ – works
– Detecting CXX compiler ABI info
– Detecting CXX compiler ABI info - done
– Detecting CXX compile features
– Detecting CXX compile features - done
– Performing Test COMPILER_SUPPORTS_CXX17
– Performing Test COMPILER_SUPPORTS_CXX17 - Success
– Performing Test COMPILER_SUPPORTS_CXX14
– Performing Test COMPILER_SUPPORTS_CXX14 - Success
– Performing Test COMPILER_SUPPORTS_CXX11
– Performing Test COMPILER_SUPPORTS_CXX11 - Success
– Performing Test COMPILER_SUPPORTS_CXX0X
– Performing Test COMPILER_SUPPORTS_CXX0X - Success
– Using C++17 compiler
– Looking for pthread.h
– Looking for pthread.h - found
– Looking for pthread_create
– Looking for pthread_create - not found
– Looking for pthread_create in pthreads
– Looking for pthread_create in pthreads - not found
– Looking for pthread_create in pthread
– Looking for pthread_create in pthread - found
– Found Threads: TRUE
– Boost version: 1.65.1
– Found the following Boost libraries:
– system
– thread
– filesystem
– chrono
– date_time
– atomic
– Found PkgConfig: /usr/bin/pkg-config (found version “0.29.1”)
– Checking for module ‘bullet>=2.82’
– Found bullet, version 2.87
– Found Simbody: /usr/include/simbody
– Boost version: 1.65.1
– Found the following Boost libraries:
– thread
– system
– filesystem
– program_options
– regex
– iostreams
– date_time
– chrono
– atomic
– Found Protobuf: /usr/lib/x86_64-linux-gnu/libprotobuf.so;-lpthread (found version “3.0.0”)
– Boost version: 1.65.1
– Looking for OGRE…
– OGRE_PREFIX_WATCH changed.
– Checking for module ‘OGRE’
– Found OGRE, version 1.9.0
– Found Ogre Ghadamon (1.9.0)
– Found OGRE: optimized;/usr/lib/x86_64-linux-gnu/libOgreMain.so;debug;/usr/lib/x86_64-linux-gnu/libOgreMain.so
– Looking for OGRE_Paging…
– Found OGRE_Paging: optimized;/usr/lib/x86_64-linux-gnu/libOgrePaging.so;debug;/usr/lib/x86_64-linux-gnu/libOgrePaging.so
– Looking for OGRE_Terrain…
– Found OGRE_Terrain: optimized;/usr/lib/x86_64-linux-gnu/libOgreTerrain.so;debug;/usr/lib/x86_64-linux-gnu/libOgreTerrain.so
– Looking for OGRE_Property…
– Found OGRE_Property: optimized;/usr/lib/x86_64-linux-gnu/libOgreProperty.so;debug;/usr/lib/x86_64-linux-gnu/libOgreProperty.so
– Looking for OGRE_RTShaderSystem…
– Found OGRE_RTShaderSystem: optimized;/usr/lib/x86_64-linux-gnu/libOgreRTShaderSystem.so;debug;/usr/lib/x86_64-linux-gnu/libOgreRTShaderSystem.so
– Looking for OGRE_Volume…
– Found OGRE_Volume: optimized;/usr/lib/x86_64-linux-gnu/libOgreVolume.so;debug;/usr/lib/x86_64-linux-gnu/libOgreVolume.so
– Looking for OGRE_Overlay…
– Found OGRE_Overlay: optimized;/usr/lib/x86_64-linux-gnu/libOgreOverlay.so;debug;/usr/lib/x86_64-linux-gnu/libOgreOverlay.so
– Found Protobuf: /usr/lib/x86_64-linux-gnu/libprotobuf.so;-lpthread;-lpthread (found suitable version “3.0.0”, 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
– Found ZeroMQ: TRUE (Required is at least version “4”)
– Checking for module ‘uuid’
– Found uuid, version 2.31.1
– Found UUID: TRUE
– Checking for module ‘tinyxml2’
– Found tinyxml2, version 6.0.0
– Looking for dlfcn.h - found
– Looking for libdl - found
– Found DL: TRUE
– FreeImage.pc not found, we will search for FreeImage_INCLUDE_DIRS and FreeImage_LIBRARIES
– Checking for module ‘gts’
– Found gts, version 0.7.6
– Found GTS: TRUE
– Checking for module ‘libswscale’
– Found libswscale, version 4.8.100
– Found SWSCALE: TRUE
– Checking for module ‘libavdevice >= 56.4.100’
– Found libavdevice , version 57.10.100
– Found AVDEVICE: TRUE (Required is at least version “56.4.100”)
– Checking for module ‘libavformat’
– Found libavformat, version 57.83.100
– Found AVFORMAT: TRUE
– Checking for module ‘libavcodec’
– Found libavcodec, version 57.107.100
– Found AVCODEC: TRUE
– Checking for module ‘libavutil’
– Found libavutil, version 55.78.100
– Found AVUTIL: TRUE
– Found CURL: /usr/lib/x86_64-linux-gnu/libcurl.so (found version “7.58.0”)
– Checking for module ‘jsoncpp’
– Found jsoncpp, version 1.7.4
– Found JSONCPP: TRUE
– Checking for module ‘yaml-0.1’
– Found yaml-0.1, version 0.1.7
– Found YAML: TRUE
– Checking for module ‘libzip’
– Found libzip, version 1.1.2
– Found ZIP: TRUE
– Found PythonInterp: /usr/bin/python3 (found suitable version “3.6.9”, minimum required is “3”)
– Found OpenCV: /usr (found version “3.2.0”)
– Found TinyXML: /usr/lib/x86_64-linux-gnu/libtinyxml.so
– Checking for module ‘gstreamer-1.0 >= 1.0’
– Found gstreamer-1.0 , version 1.14.5
– Checking for module ‘gstreamer-base-1.0 >= 1.0’
– Found gstreamer-base-1.0 , version 1.14.5
– Found GStreamer: GSTREAMER_INCLUDE_DIRS;GSTREAMER_LIBRARIES;GSTREAMER_VERSION;GSTREAMER_BASE_INCLUDE_DIRS;GSTREAMER_BASE_LIBRARIES (Required is at least version “1.0”)
– Checking for module ‘OGRE’
– Found OGRE, version 1.9.0
– Building klt_feature_tracker without catkin
– Building OpticalFlow with OpenCV
– Found MAVLink: /home/bilal/Simulator_Gazebo/Firmware/mavlink/include (found version “2.0”)
– catkin DISABLED
– Found Protobuf: /usr/lib/x86_64-linux-gnu/libprotobuf.so;-lpthread;-lpthread;-lpthread (found version “3.0.0”)
– Checking for module ‘protobuf’
– Found protobuf, version 3.0.0
– Gazebo version: 9.12
– Found GStreamer: adding gst_camera_plugin
– Found GStreamer: adding gst_video_stream_widget
– Configuring done
– Generating done
– Build files have been written to: /home/bilal/Simulator_Gazebo/Firmware/build/px4_sitl_default/build_gazebo
[375/731] Performing build step for ‘sitl_gazebo’
[6/100] Generating /home/bilal/Simulat…ls/mb1240-xl-ez4/mb1240-xl-ez4-gen.sdf
/home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/models/mb1240-xl-ez4/mb1240-xl-ez4.sdf.jinja → /home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/models/mb1240-xl-ez4/mb1240-xl-ez4-gen.sdf
[8/100] Generating /home/bilal/Simulat…models/matrice_100/matrice_100-gen.sdf
/home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/models/matrice_100/matrice_100.sdf.jinja → /home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/models/matrice_100/matrice_100-gen.sdf
[9/100] Generating /home/bilal/Simulat…_gazebo/models/px4flow/px4flow-gen.sdf
/home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/models/px4flow/px4flow.sdf.jinja → /home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/models/px4flow/px4flow-gen.sdf
[15/100] Generating /home/bilal/Simula…s/sitl_gazebo/models/c920/c920-gen.sdf
/home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/models/c920/c920.sdf.jinja → /home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/models/c920/c920-gen.sdf
[16/100] Generating /home/bilal/Simula…models/3DR_gps_mag/3DR_gps_mag-gen.sdf
/home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/models/3DR_gps_mag/3DR_gps_mag.sdf.jinja → /home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/models/3DR_gps_mag/3DR_gps_mag-gen.sdf
[17/100] Generating /home/bilal/Simula…_gazebo/models/pixhawk/pixhawk-gen.sdf
/home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/models/pixhawk/pixhawk.sdf.jinja → /home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/models/pixhawk/pixhawk-gen.sdf
[20/100] Generating /home/bilal/Simula…s/sitl_gazebo/models/r200/r200-gen.sdf
/home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/models/r200/r200.sdf.jinja → /home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/models/r200/r200-gen.sdf
[22/100] Generating /home/bilal/Simula…sitl_gazebo/models/sf10a/sf10a-gen.sdf
/home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/models/sf10a/sf10a.sdf.jinja → /home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/models/sf10a/sf10a-gen.sdf
[36/100] Building CXX object CMakeFile…/src/gazebo_controller_interface.cpp.o
FAILED: CMakeFiles/gazebo_controller_interface.dir/src/gazebo_controller_interface.cpp.o
/usr/bin/c++ -DLIBBULLET_VERSION=2.87 -DLIBBULLET_VERSION_GT_282 -Dgazebo_controller_interface_EXPORTS -isystem /usr/include/gazebo-9 -isystem /usr/include/bullet -isystem /usr/include/simbody -isystem /usr/include/sdformat-6.2 -isystem /usr/include/ignition/math4 -isystem /usr/include/OGRE -isystem /usr/include/OGRE/Terrain -isystem /usr/include/OGRE/Paging -isystem /usr/include/ignition/transport4 -isystem /usr/include/ignition/msgs1 -isystem /usr/include/ignition/common1 -isystem /usr/include/ignition/fuel_tools1 -isystem /usr/include/x86_64-linux-gnu/qt5 -isystem /usr/include/x86_64-linux-gnu/qt5/QtCore -isystem /usr/lib/x86_64-linux-gnu/qt5/mkspecs/linux-g++ -I/home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/include -I. -I/usr/include/eigen3 -I/usr/include/eigen3/eigen3 -I/usr/include/gazebo-9/gazebo/msgs -I/home/bilal/Simulator_Gazebo/Firmware/mavlink/include -isystem /usr/include/opencv -I/home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/external/OpticalFlow/include -I/usr/include/gstreamer-1.0 -I/usr/include/glib-2.0 -I/usr/lib/x86_64-linux-gnu/glib-2.0/include -isystem /usr/include/uuid -isystem /usr/include/x86_64-linux-gnu -Wno-deprecated-declarations -Wno-address-of-packed-member -fPIC -I/usr/include/uuid -I/usr/include/x86_64-linux-gnu -std=gnu++1z -MD -MT CMakeFiles/gazebo_controller_interface.dir/src/gazebo_controller_interface.cpp.o -MF CMakeFiles/gazebo_controller_interface.dir/src/gazebo_controller_interface.cpp.o.d -o CMakeFiles/gazebo_controller_interface.dir/src/gazebo_controller_interface.cpp.o -c /home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/src/gazebo_controller_interface.cpp
c++: internal compiler error: Killed (program cc1plus)
Please submit a full bug report,
with preprocessed source if appropriate.
See <file:///usr/share/doc/gcc-7/README.Bugs> for instructions.
[37/100] Building CXX object CMakeFile…ugin.dir/src/gazebo_sonar_plugin.cpp.o
FAILED: CMakeFiles/gazebo_sonar_plugin.dir/src/gazebo_sonar_plugin.cpp.o
/usr/bin/c++ -DLIBBULLET_VERSION=2.87 -DLIBBULLET_VERSION_GT_282 -Dgazebo_sonar_plugin_EXPORTS -isystem /usr/include/gazebo-9 -isystem /usr/include/bullet -isystem /usr/include/simbody -isystem /usr/include/sdformat-6.2 -isystem /usr/include/ignition/math4 -isystem /usr/include/OGRE -isystem /usr/include/OGRE/Terrain -isystem /usr/include/OGRE/Paging -isystem /usr/include/ignition/transport4 -isystem /usr/include/ignition/msgs1 -isystem /usr/include/ignition/common1 -isystem /usr/include/ignition/fuel_tools1 -isystem /usr/include/x86_64-linux-gnu/qt5 -isystem /usr/include/x86_64-linux-gnu/qt5/QtCore -isystem /usr/lib/x86_64-linux-gnu/qt5/mkspecs/linux-g++ -I/home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/include -I. -I/usr/include/eigen3 -I/usr/include/eigen3/eigen3 -I/usr/include/gazebo-9/gazebo/msgs -I/home/bilal/Simulator_Gazebo/Firmware/mavlink/include -isystem /usr/include/opencv -I/home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/external/OpticalFlow/include -I/usr/include/gstreamer-1.0 -I/usr/include/glib-2.0 -I/usr/lib/x86_64-linux-gnu/glib-2.0/include -isystem /usr/include/uuid -isystem /usr/include/x86_64-linux-gnu -Wno-deprecated-declarations -Wno-address-of-packed-member -fPIC -I/usr/include/uuid -I/usr/include/x86_64-linux-gnu -std=gnu++1z -MD -MT CMakeFiles/gazebo_sonar_plugin.dir/src/gazebo_sonar_plugin.cpp.o -MF CMakeFiles/gazebo_sonar_plugin.dir/src/gazebo_sonar_plugin.cpp.o.d -o CMakeFiles/gazebo_sonar_plugin.dir/src/gazebo_sonar_plugin.cpp.o -c /home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/src/gazebo_sonar_plugin.cpp
c++: internal compiler error: Killed (program cc1plus)
Please submit a full bug report,
with preprocessed source if appropriate.
See <file:///usr/share/doc/gcc-7/README.Bugs> for instructions.
[39/100] Building CXX object CMakeFile…gin.dir/src/gazebo_vision_plugin.cpp.o
FAILED: CMakeFiles/gazebo_vision_plugin.dir/src/gazebo_vision_plugin.cpp.o
/usr/bin/c++ -DLIBBULLET_VERSION=2.87 -DLIBBULLET_VERSION_GT_282 -Dgazebo_vision_plugin_EXPORTS -isystem /usr/include/gazebo-9 -isystem /usr/include/bullet -isystem /usr/include/simbody -isystem /usr/include/sdformat-6.2 -isystem /usr/include/ignition/math4 -isystem /usr/include/OGRE -isystem /usr/include/OGRE/Terrain -isystem /usr/include/OGRE/Paging -isystem /usr/include/ignition/transport4 -isystem /usr/include/ignition/msgs1 -isystem /usr/include/ignition/common1 -isystem /usr/include/ignition/fuel_tools1 -isystem /usr/include/x86_64-linux-gnu/qt5 -isystem /usr/include/x86_64-linux-gnu/qt5/QtCore -isystem /usr/lib/x86_64-linux-gnu/qt5/mkspecs/linux-g++ -I/home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/include -I. -I/usr/include/eigen3 -I/usr/include/eigen3/eigen3 -I/usr/include/gazebo-9/gazebo/msgs -I/home/bilal/Simulator_Gazebo/Firmware/mavlink/include -isystem /usr/include/opencv -I/home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/external/OpticalFlow/include -I/usr/include/gstreamer-1.0 -I/usr/include/glib-2.0 -I/usr/lib/x86_64-linux-gnu/glib-2.0/include -isystem /usr/include/uuid -isystem /usr/include/x86_64-linux-gnu -Wno-deprecated-declarations -Wno-address-of-packed-member -fPIC -I/usr/include/uuid -I/usr/include/x86_64-linux-gnu -std=gnu++1z -MD -MT CMakeFiles/gazebo_vision_plugin.dir/src/gazebo_vision_plugin.cpp.o -MF CMakeFiles/gazebo_vision_plugin.dir/src/gazebo_vision_plugin.cpp.o.d -o CMakeFiles/gazebo_vision_plugin.dir/src/gazebo_vision_plugin.cpp.o -c /home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/src/gazebo_vision_plugin.cpp
c++: internal compiler error: Killed (program cc1plus)
Please submit a full bug report,
with preprocessed source if appropriate.
See <file:///usr/share/doc/gcc-7/README.Bugs> for instructions.
[40/100] Building CXX object CMakeFile…c/gazebo_geotagged_images_plugin.cpp.o
FAILED: CMakeFiles/gazebo_geotagged_images_plugin.dir/src/gazebo_geotagged_images_plugin.cpp.o
/usr/bin/c++ -DLIBBULLET_VERSION=2.87 -DLIBBULLET_VERSION_GT_282 -Dgazebo_geotagged_images_plugin_EXPORTS -isystem /usr/include/gazebo-9 -isystem /usr/include/bullet -isystem /usr/include/simbody -isystem /usr/include/sdformat-6.2 -isystem /usr/include/ignition/math4 -isystem /usr/include/OGRE -isystem /usr/include/OGRE/Terrain -isystem /usr/include/OGRE/Paging -isystem /usr/include/ignition/transport4 -isystem /usr/include/ignition/msgs1 -isystem /usr/include/ignition/common1 -isystem /usr/include/ignition/fuel_tools1 -isystem /usr/include/x86_64-linux-gnu/qt5 -isystem /usr/include/x86_64-linux-gnu/qt5/QtCore -isystem /usr/lib/x86_64-linux-gnu/qt5/mkspecs/linux-g++ -I/home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/include -I. -I/usr/include/eigen3 -I/usr/include/eigen3/eigen3 -I/usr/include/gazebo-9/gazebo/msgs -I/home/bilal/Simulator_Gazebo/Firmware/mavlink/include -isystem /usr/include/opencv -I/home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/external/OpticalFlow/include -I/usr/include/gstreamer-1.0 -I/usr/include/glib-2.0 -I/usr/lib/x86_64-linux-gnu/glib-2.0/include -isystem /usr/include/uuid -isystem /usr/include/x86_64-linux-gnu -Wno-deprecated-declarations -Wno-address-of-packed-member -fPIC -I/usr/include/uuid -I/usr/include/x86_64-linux-gnu -std=gnu++1z -MD -MT CMakeFiles/gazebo_geotagged_images_plugin.dir/src/gazebo_geotagged_images_plugin.cpp.o -MF CMakeFiles/gazebo_geotagged_images_plugin.dir/src/gazebo_geotagged_images_plugin.cpp.o.d -o CMakeFiles/gazebo_geotagged_images_plugin.dir/src/gazebo_geotagged_images_plugin.cpp.o -c /home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/src/gazebo_geotagged_images_plugin.cpp
c++: internal compiler error: Killed (program cc1plus)
Please submit a full bug report,
with preprocessed source if appropriate.
See <file:///usr/share/doc/gcc-7/README.Bugs> for instructions.
[41/100] Generating /home/bilal/Simula…Tools/sitl_gazebo/models/iris/iris.sdf

[42/100] Building CXX object CMakeFile…ugin.dir/src/gazebo_lidar_plugin.cpp.o
FAILED: CMakeFiles/gazebo_lidar_plugin.dir/src/gazebo_lidar_plugin.cpp.o
/usr/bin/c++ -DLIBBULLET_VERSION=2.87 -DLIBBULLET_VERSION_GT_282 -Dgazebo_lidar_plugin_EXPORTS -isystem /usr/include/gazebo-9 -isystem /usr/include/bullet -isystem /usr/include/simbody -isystem /usr/include/sdformat-6.2 -isystem /usr/include/ignition/math4 -isystem /usr/include/OGRE -isystem /usr/include/OGRE/Terrain -isystem /usr/include/OGRE/Paging -isystem /usr/include/ignition/transport4 -isystem /usr/include/ignition/msgs1 -isystem /usr/include/ignition/common1 -isystem /usr/include/ignition/fuel_tools1 -isystem /usr/include/x86_64-linux-gnu/qt5 -isystem /usr/include/x86_64-linux-gnu/qt5/QtCore -isystem /usr/lib/x86_64-linux-gnu/qt5/mkspecs/linux-g++ -I/home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/include -I. -I/usr/include/eigen3 -I/usr/include/eigen3/eigen3 -I/usr/include/gazebo-9/gazebo/msgs -I/home/bilal/Simulator_Gazebo/Firmware/mavlink/include -isystem /usr/include/opencv -I/home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/external/OpticalFlow/include -I/usr/include/gstreamer-1.0 -I/usr/include/glib-2.0 -I/usr/lib/x86_64-linux-gnu/glib-2.0/include -isystem /usr/include/uuid -isystem /usr/include/x86_64-linux-gnu -Wno-deprecated-declarations -Wno-address-of-packed-member -fPIC -I/usr/include/uuid -I/usr/include/x86_64-linux-gnu -std=gnu++1z -MD -MT CMakeFiles/gazebo_lidar_plugin.dir/src/gazebo_lidar_plugin.cpp.o -MF CMakeFiles/gazebo_lidar_plugin.dir/src/gazebo_lidar_plugin.cpp.o.d -o CMakeFiles/gazebo_lidar_plugin.dir/src/gazebo_lidar_plugin.cpp.o -c /home/bilal/Simulator_Gazebo/Firmware/Tools/sitl_gazebo/src/gazebo_lidar_plugin.cpp
c++: internal compiler error: Killed (program cc1plus)
Please submit a full bug report,
with preprocessed source if appropriate.
See <file:///usr/share/doc/gcc-7/README.Bugs> for instructions.
[45/100] Building CXX object CMakeFile…ir/src/gazebo_opticalflow_plugin.cpp.o
ninja: build stopped: subcommand failed.
[727/731] Linking CXX executable bin/px4
FAILED: external/Stamp/sitl_gazebo/sitl_gazebo-build
cd /home/bilal/Simulator_Gazebo/Firmware/build/px4_sitl_default/build_gazebo && /usr/bin/cmake --build .
ninja: build stopped: subcommand failed.
Makefile:205: recipe for target ‘px4_sitl’ failed
make: *** [px4_sitl] Error 1