Make posix_sitl_default gazebo error with v1.8.0

Firmwave: v1.8.0
Ubuntu: 18.04
I need to use firmware v1.8.0 to follow the GASS source code: Hello Sky - GAAS
make posix_sitl_default gazebo gives error
Glad someone has the solution

ninja: Entering directory `/home/huytd/Project/Drone/GAAS_ws/src/Firmware/build/posix_sitl_default'
[3/7] Performing configure step for 'sitl_gazebo'
FAILED: external/Stamp/sitl_gazebo/sitl_gazebo-configure /home/huytd/Project/Drone/GAAS_ws/src/Firmware/build/posix_sitl_default/external/Stamp/sitl_gazebo/sitl_gazebo-configure 
cd /home/huytd/Project/Drone/GAAS_ws/src/Firmware/build/posix_sitl_default/build_gazebo && /home/huytd/.local/lib/python3.6/site-packages/cmake/data/bin/cmake -DCMAKE_INSTALL_PREFIX=/usr/local -GNinja /home/huytd/Project/Drone/GAAS_ws/src/Firmware/Tools/sitl_gazebo && /home/huytd/.local/lib/python3.6/site-packages/cmake/data/bin/cmake -E touch /home/huytd/Project/Drone/GAAS_ws/src/Firmware/build/posix_sitl_default/external/Stamp/sitl_gazebo/sitl_gazebo-configure
-- install-prefix: /usr/local
-- Found Boost: /usr/include (found suitable version "1.65.1", minimum required is "1.58") found components: system thread timer chrono date_time atomic 
CMake Warning (dev) at /home/huytd/.local/lib/python3.6/site-packages/cmake/data/share/cmake-3.22/Modules/FindPackageHandleStandardArgs.cmake:438 (message):
  The package name passed to `find_package_handle_standard_args` (PkgConfig)
  does not match the name of the calling package (gazebo).  This can lead to
  problems in calling code that expects `find_package` result variables
  (e.g., `_FOUND`) to follow a certain pattern.
Call Stack (most recent call first):
  /home/huytd/.local/lib/python3.6/site-packages/cmake/data/share/cmake-3.22/Modules/FindPkgConfig.cmake:99 (find_package_handle_standard_args)
  /usr/lib/x86_64-linux-gnu/cmake/gazebo/gazebo-config.cmake:30 (include)
  CMakeLists.txt:29 (find_package)
This warning is for project developers.  Use -Wno-dev to suppress it.

-- Found Boost: /usr/include (found suitable version "1.65.1", minimum required is "1.40.0") found components: 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") 
-- Found Boost: /usr/include (found version "1.65.1")  
-- Looking for OGRE...
-- 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 (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
-- 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
-- FreeImage.pc not found, we will search for FreeImage_INCLUDE_DIRS and FreeImage_LIBRARIES
-- Found UUID: TRUE  
-- Checking for module 'gts'
--   Found gts, version 0.7.6
-- Checking for module 'libswscale'
--   Found libswscale, version 4.8.100
-- Checking for module 'libavdevice >= 56.4.100'
--   Found libavdevice , version 57.10.100
-- Checking for module 'libavformat'
--   Found libavformat, version 57.83.100
-- Checking for module 'libavcodec'
--   Found libavcodec, version 57.107.100
-- Checking for module 'libavutil'
--   Found libavutil, version 55.78.100
-- Checking for module 'jsoncpp'
--   Found jsoncpp, version 1.7.4
-- Checking for module 'yaml-0.1'
--   Found yaml-0.1, version 0.1.7
-- Checking for module 'libzip'
--   Found libzip, version 1.1.2
CMake Error at CMakeLists.txt:31 (find_program):
  Could not find px4 using the following names:


-- Configuring incomplete, errors occurred!
See also "/home/huytd/Project/Drone/GAAS_ws/src/Firmware/build/posix_sitl_default/build_gazebo/CMakeFiles/CMakeOutput.log".
See also "/home/huytd/Project/Drone/GAAS_ws/src/Firmware/build/posix_sitl_default/build_gazebo/CMakeFiles/CMakeError.log".
ninja: build stopped: subcommand failed.
Makefile:148: recipe for target 'posix_sitl_default' failed
make: *** [posix_sitl_default] Error 1