PX4 / PX4-SITL_gazebo-classic

Set of plugins, models and worlds to use with OSRF Gazebo Simulator in SITL and HITL.
http://dev.px4.io/simulation-gazebo.html
368 stars 787 forks source link

'make px4_sitl_default gazebo' gives 'ninja: build stopped: subcommand failed. make: *** [Makefile:225: px4_sitl_default] Error 1' #829

Closed joelfinnigan closed 2 years ago

joelfinnigan commented 2 years ago

I am very inexperienced with the Linux console, and SITL simulation in general. I am running Ubuntu Linux 20.04 on Parallels, attempting to build a PX4 SITL simulation. I began with a fresh virtual machine and installed ROS Noetic using the following instructions: https://wiki.ros.org/noetic/Installation/Ubuntu

Running 'roscore & rosrun gazebo_ros gazebo' launches both the server and the client correctly, and the proper ROS connections and Gazebo services are set up as described here: http://gazebosim.org/tutorials?tut=ros_installing&cat=connect_ros

parallels@ubuntu-linux-20-04-desktop:~/PX4-Autopilot$ rostopic list /clock /gazebo/link_states /gazebo/model_states /gazebo/parameter_descriptions /gazebo/parameter_updates /gazebo/performance_metrics /gazebo/set_link_state /gazebo/set_model_state /rosout /rosout_agg parallels@ubuntu-linux-20-04-desktop:~/PX4-Autopilot$ rosservice list /gazebo/apply_body_wrench /gazebo/apply_joint_effort /gazebo/clear_body_wrenches /gazebo/clear_joint_forces /gazebo/delete_light /gazebo/delete_model /gazebo/get_joint_properties /gazebo/get_light_properties /gazebo/get_link_properties /gazebo/get_link_state /gazebo/get_loggers /gazebo/get_model_properties /gazebo/get_model_state /gazebo/get_physics_properties /gazebo/get_world_properties /gazebo/pause_physics /gazebo/reset_simulation /gazebo/reset_world /gazebo/set_joint_properties /gazebo/set_light_properties /gazebo/set_link_properties /gazebo/set_link_state /gazebo/set_logger_level /gazebo/set_model_configuration /gazebo/set_model_state /gazebo/set_parameters /gazebo/set_physics_properties /gazebo/spawn_sdf_model /gazebo/spawn_urdf_model /gazebo/unpause_physics /rosout/get_loggers /rosout/set_logger_level

I then installed the PX4 autopilot by running 'git clone https://github.com/PX4/PX4-Autopilot.git --recursive' and then 'bash ./PX4-Autopilot/Tools/setup/ubuntu.sh'

This completed but with an error and some warnings:

parallels@ubuntu-linux-20-04-desktop:~$ bash ./PX4-Autopilot/Tools/setup/ubuntu.sh Ubuntu 20.04

Installing PX4 general dependencies [sudo] password for parallels: Hit:1 http://ports.ubuntu.com/ubuntu-ports focal InRelease Hit:2 http://ports.ubuntu.com/ubuntu-ports focal-updates InRelease Hit:3 http://ports.ubuntu.com/ubuntu-ports focal-backports InRelease Hit:4 http://ports.ubuntu.com/ubuntu-ports focal-security InRelease Hit:5 http://packages.ros.org/ros/ubuntu focal InRelease Reading package lists... Reading package lists... Building dependency tree... Reading state information... cmake is already the newest version (3.16.3-1ubuntu1). cmake set to manually installed. file is already the newest version (1:5.38-4). file set to manually installed. g++ is already the newest version (4:9.3.0-1ubuntu2). g++ set to manually installed. gcc is already the newest version (4:9.3.0-1ubuntu2). make is already the newest version (4.2.1-1.2). python3 is already the newest version (3.8.2-0ubuntu2). python3 set to manually installed. python3-dev is already the newest version (3.8.2-0ubuntu2). python3-dev set to manually installed. python3-setuptools is already the newest version (45.2.0-1). python3-setuptools set to manually installed. unzip is already the newest version (6.0-25ubuntu1). zip is already the newest version (3.0-11build1). build-essential is already the newest version (12.8ubuntu1.1). gdb is already the newest version (9.2-0ubuntu1~20.04). git is already the newest version (1:2.25.1-1ubuntu3.2). git set to manually installed. libxml2-dev is already the newest version (2.9.10+dfsg-5ubuntu0.20.04.1). libxml2-dev set to manually installed. libxml2-utils is already the newest version (2.9.10+dfsg-5ubuntu0.20.04.1). libxml2-utils set to manually installed. rsync is already the newest version (3.1.3-8ubuntu0.1). rsync set to manually installed. The following package was automatically installed and is no longer required: libllvm11 Use 'sudo apt autoremove' to remove it. The following additional packages will be installed: libjson-perl libperlio-gzip-perl python-pip-whl Suggested packages: distcc | icecc cppcheck-gui Recommended packages: libgd-gd2-perl libjson-xs-perl The following NEW packages will be installed: astyle ccache cppcheck lcov libjson-perl libperlio-gzip-perl ninja-build python-pip-whl python3-pip python3-wheel shellcheck 0 upgraded, 11 newly installed, 0 to remove and 2 not upgraded. Need to get 7,306 kB of archives. After this operation, 38.5 MB of additional disk space will be used. Get:1 http://ports.ubuntu.com/ubuntu-ports focal/universe arm64 astyle arm64 3.1-2build1 [187 kB] Get:2 http://ports.ubuntu.com/ubuntu-ports focal/main arm64 ccache arm64 3.7.7-1 [117 kB] Get:3 http://ports.ubuntu.com/ubuntu-ports focal/universe arm64 cppcheck arm64 1.90-4build1 [1,461 kB] Get:4 http://ports.ubuntu.com/ubuntu-ports focal/main arm64 libjson-perl all 4.02000-2 [80.9 kB] Get:5 http://ports.ubuntu.com/ubuntu-ports focal/main arm64 libperlio-gzip-perl arm64 0.19-1build5 [14.1 kB] Get:6 http://ports.ubuntu.com/ubuntu-ports focal/universe arm64 lcov all 1.14-2 [97.1 kB] Get:7 http://ports.ubuntu.com/ubuntu-ports focal/universe arm64 ninja-build arm64 1.10.0-1build1 [101 kB] Get:8 http://ports.ubuntu.com/ubuntu-ports focal-updates/universe arm64 python-pip-whl all 20.0.2-5ubuntu1.6 [1,805 kB] Get:9 http://ports.ubuntu.com/ubuntu-ports focal/universe arm64 python3-wheel all 0.34.2-1 [23.8 kB] Get:10 http://ports.ubuntu.com/ubuntu-ports focal-updates/universe arm64 python3-pip all 20.0.2-5ubuntu1.6 [231 kB] Get:11 http://ports.ubuntu.com/ubuntu-ports focal/universe arm64 shellcheck arm64 0.7.0-2build2 [3,189 kB] Fetched 7,306 kB in 2s (4,339 kB/s) Selecting previously unselected package astyle. (Reading database ... 264858 files and directories currently installed.) Preparing to unpack .../00-astyle_3.1-2build1_arm64.deb ... Unpacking astyle (3.1-2build1) ... Selecting previously unselected package ccache. Preparing to unpack .../01-ccache_3.7.7-1_arm64.deb ... Unpacking ccache (3.7.7-1) ... Selecting previously unselected package cppcheck. Preparing to unpack .../02-cppcheck_1.90-4build1_arm64.deb ... Unpacking cppcheck (1.90-4build1) ... Selecting previously unselected package libjson-perl. Preparing to unpack .../03-libjson-perl_4.02000-2_all.deb ... Unpacking libjson-perl (4.02000-2) ... Selecting previously unselected package libperlio-gzip-perl. Preparing to unpack .../04-libperlio-gzip-perl_0.19-1build5_arm64.deb ... Unpacking libperlio-gzip-perl (0.19-1build5) ... Selecting previously unselected package lcov. Preparing to unpack .../05-lcov_1.14-2_all.deb ... Unpacking lcov (1.14-2) ... Selecting previously unselected package ninja-build. Preparing to unpack .../06-ninja-build_1.10.0-1build1_arm64.deb ... Unpacking ninja-build (1.10.0-1build1) ... Selecting previously unselected package python-pip-whl. Preparing to unpack .../07-python-pip-whl_20.0.2-5ubuntu1.6_all.deb ... Unpacking python-pip-whl (20.0.2-5ubuntu1.6) ... Selecting previously unselected package python3-wheel. Preparing to unpack .../08-python3-wheel_0.34.2-1_all.deb ... Unpacking python3-wheel (0.34.2-1) ... Selecting previously unselected package python3-pip. Preparing to unpack .../09-python3-pip_20.0.2-5ubuntu1.6_all.deb ... Unpacking python3-pip (20.0.2-5ubuntu1.6) ... Selecting previously unselected package shellcheck. Preparing to unpack .../10-shellcheck_0.7.0-2build2_arm64.deb ... Unpacking shellcheck (0.7.0-2build2) ... Setting up ccache (3.7.7-1) ... Updating symlinks in /usr/lib/ccache ... Setting up python3-wheel (0.34.2-1) ... Setting up shellcheck (0.7.0-2build2) ... Setting up ninja-build (1.10.0-1build1) ... Setting up cppcheck (1.90-4build1) ... Setting up astyle (3.1-2build1) ... Setting up libjson-perl (4.02000-2) ... Setting up python-pip-whl (20.0.2-5ubuntu1.6) ... Setting up libperlio-gzip-perl (0.19-1build5) ... Setting up lcov (1.14-2) ... Setting up python3-pip (20.0.2-5ubuntu1.6) ... Processing triggers for man-db (2.9.1-1) ...

Installing PX4 Python3 dependencies Collecting argcomplete Downloading argcomplete-1.12.3-py2.py3-none-any.whl (38 kB) Collecting argparse>=1.2 Downloading argparse-1.4.0-py2.py3-none-any.whl (23 kB) Collecting cerberus Downloading Cerberus-1.3.4.tar.gz (63 kB) |████████████████████████████████| 63 kB 3.4 MB/s Installing build dependencies ... done Getting requirements to build wheel ... done Preparing wheel metadata ... done Collecting coverage Downloading coverage-6.1.2-cp38-cp38-manylinux_2_17_aarch64.manylinux2014_aarch64.whl (208 kB) |████████████████████████████████| 208 kB 2.4 MB/s Requirement already satisfied: empy>=3.3 in /usr/lib/python3/dist-packages (from -r /home/parallels/PX4-Autopilot/Tools/setup/requirements.txt (line 5)) (3.3.2) Requirement already satisfied: future in /usr/lib/python3/dist-packages (from -r /home/parallels/PX4-Autopilot/Tools/setup/requirements.txt (line 6)) (0.18.2) Collecting jinja2>=2.8 Downloading Jinja2-3.0.3-py3-none-any.whl (133 kB) |████████████████████████████████| 133 kB 4.1 MB/s Collecting jsonschema Downloading jsonschema-4.2.1-py3-none-any.whl (69 kB) |████████████████████████████████| 69 kB 5.5 MB/s Collecting kconfiglib Downloading kconfiglib-14.1.0-py2.py3-none-any.whl (145 kB) |████████████████████████████████| 145 kB 4.0 MB/s Collecting lxml Downloading lxml-4.6.4-cp38-cp38-manylinux_2_17_aarch64.manylinux2014_aarch64.manylinux_2_24_aarch64.whl (6.5 MB) |████████████████████████████████| 6.5 MB 2.6 MB/s Requirement already satisfied: matplotlib>=3.0.* in /usr/lib/python3/dist-packages (from -r /home/parallels/PX4-Autopilot/Tools/setup/requirements.txt (line 11)) (3.1.2) Requirement already satisfied: numpy>=1.13 in /usr/lib/python3/dist-packages (from -r /home/parallels/PX4-Autopilot/Tools/setup/requirements.txt (line 12)) (1.17.4) Collecting nunavut>=1.1.0 Downloading nunavut-1.5.1-72-py3-none-any.whl (305 kB) |████████████████████████████████| 305 kB 5.7 MB/s Collecting packaging Downloading packaging-21.3-py3-none-any.whl (40 kB) |████████████████████████████████| 40 kB 1.8 MB/s Collecting pandas>=0.21 Downloading pandas-1.3.4-cp38-cp38-manylinux_2_17_aarch64.manylinux2014_aarch64.whl (10.9 MB) |████████████████████████████████| 10.9 MB 3.7 MB/s Collecting pkgconfig Downloading pkgconfig-1.5.5-py3-none-any.whl (6.7 kB) Requirement already satisfied: psutil in /usr/lib/python3/dist-packages (from -r /home/parallels/PX4-Autopilot/Tools/setup/requirements.txt (line 17)) (5.5.1) Requirement already satisfied: pygments in /usr/lib/python3/dist-packages (from -r /home/parallels/PX4-Autopilot/Tools/setup/requirements.txt (line 18)) (2.3.1) Requirement already satisfied: wheel>=0.31.1 in /usr/lib/python3/dist-packages (from -r /home/parallels/PX4-Autopilot/Tools/setup/requirements.txt (line 19)) (0.34.2) Collecting pymavlink Downloading pymavlink-2.4.17.tar.gz (4.9 MB) |████████████████████████████████| 4.9 MB 3.5 MB/s Collecting pyros-genmsg Downloading pyros_genmsg-0.5.8-py2.py3-none-any.whl (25 kB) Collecting pyserial Downloading pyserial-3.5-py2.py3-none-any.whl (90 kB) |████████████████████████████████| 90 kB 5.4 MB/s Collecting pyulog>=0.5.0 Downloading pyulog-0.9.0-py3-none-any.whl (23 kB) Requirement already satisfied: pyyaml in /usr/lib/python3/dist-packages (from -r /home/parallels/PX4-Autopilot/Tools/setup/requirements.txt (line 24)) (5.3.1) Requirement already satisfied: requests in /usr/lib/python3/dist-packages (from -r /home/parallels/PX4-Autopilot/Tools/setup/requirements.txt (line 25)) (2.22.0) Requirement already satisfied: setuptools>=39.2.0 in /usr/lib/python3/dist-packages (from -r /home/parallels/PX4-Autopilot/Tools/setup/requirements.txt (line 26)) (45.2.0) Requirement already satisfied: six>=1.12.0 in /usr/lib/python3/dist-packages (from -r /home/parallels/PX4-Autopilot/Tools/setup/requirements.txt (line 27)) (1.14.0) Collecting toml>=0.9 Downloading toml-0.10.2-py2.py3-none-any.whl (16 kB) Collecting MarkupSafe>=2.0 Downloading MarkupSafe-2.0.1-cp38-cp38-manylinux2014_aarch64.whl (31 kB) Collecting pyrsistent!=0.17.0,!=0.17.1,!=0.17.2,>=0.14.0 Downloading pyrsistent-0.18.0.tar.gz (104 kB) |████████████████████████████████| 104 kB 5.6 MB/s Installing build dependencies ... done Getting requirements to build wheel ... done Preparing wheel metadata ... done Collecting importlib-resources>=1.4.0; python_version < "3.9" Downloading importlib_resources-5.4.0-py3-none-any.whl (28 kB) Requirement already satisfied: attrs>=17.4.0 in /usr/lib/python3/dist-packages (from jsonschema->-r /home/parallels/PX4-Autopilot/Tools/setup/requirements.txt (line 8)) (19.3.0) Collecting pydsdl~=1.12 Downloading pydsdl-1.12.1-py3-none-any.whl (110 kB) |████████████████████████████████| 110 kB 4.5 MB/s Requirement already satisfied: pyparsing!=3.0.5,>=2.0.2 in /usr/lib/python3/dist-packages (from packaging->-r /home/parallels/PX4-Autopilot/Tools/setup/requirements.txt (line 14)) (2.4.6) Requirement already satisfied: python-dateutil>=2.7.3 in /usr/lib/python3/dist-packages (from pandas>=0.21->-r /home/parallels/PX4-Autopilot/Tools/setup/requirements.txt (line 15)) (2.7.3) Requirement already satisfied: pytz>=2017.3 in /usr/lib/python3/dist-packages (from pandas>=0.21->-r /home/parallels/PX4-Autopilot/Tools/setup/requirements.txt (line 15)) (2019.3) Collecting zipp>=3.1.0; python_version < "3.10" Downloading zipp-3.6.0-py3-none-any.whl (5.3 kB) Building wheels for collected packages: cerberus, pymavlink, pyrsistent Building wheel for cerberus (PEP 517) ... done Created wheel for cerberus: filename=Cerberus-1.3.4-py3-none-any.whl size=58196 sha256=6e0d148d76a8b1f280ceb58b9abf83da034e610336be3c6f03ce02c964a217c5 Stored in directory: /home/parallels/.cache/pip/wheels/92/1e/40/307520b5eb38ceae17d32d7d7920e3e5eee6f4cd78cfd75ac7 Building wheel for pymavlink (setup.py) ... done Created wheel for pymavlink: filename=pymavlink-2.4.17-cp38-cp38-linux_aarch64.whl size=5052547 sha256=3b71385b9077f39d3a0cf4b0fc436b733b5115c3e36409cc314dc53ea4ad1afe Stored in directory: /home/parallels/.cache/pip/wheels/29/2b/f6/9913bdacc5dde8fe441f8605ca41bf2d9a12872a28d037a026 Building wheel for pyrsistent (PEP 517) ... done Created wheel for pyrsistent: filename=pyrsistent-0.18.0-cp38-cp38-linux_aarch64.whl size=107298 sha256=5ec0057c313f5814337c3f2bbfed1305a9a8cab4ff4ff1cdea4fd3fd74fc3e49 Stored in directory: /home/parallels/.cache/pip/wheels/04/e7/67/3e9f8de898496b93972f549f1fa67fb424c49fcad3e28c2cf2 Successfully built cerberus pymavlink pyrsistent ERROR: pandas 1.3.4 has requirement numpy>=1.19.2; platform_machine == "aarch64" and python_version < "3.10", but you'll have numpy 1.17.4 which is incompatible. Installing collected packages: argcomplete, argparse, cerberus, coverage, MarkupSafe, jinja2, pyrsistent, zipp, importlib-resources, jsonschema, kconfiglib, lxml, pydsdl, nunavut, packaging, pandas, pkgconfig, pymavlink, pyros-genmsg, pyserial, pyulog, toml WARNING: The scripts coverage, coverage-3.8 and coverage3 are installed in '/home/parallels/.local/bin' which is not on PATH. Consider adding this directory to PATH or, if you prefer to suppress this warning, use --no-warn-script-location. WARNING: The script jsonschema is installed in '/home/parallels/.local/bin' which is not on PATH. Consider adding this directory to PATH or, if you prefer to suppress this warning, use --no-warn-script-location. WARNING: The scripts alldefconfig, allmodconfig, allnoconfig, allyesconfig, defconfig, genconfig, guiconfig, listnewconfig, menuconfig, oldconfig, olddefconfig, savedefconfig and setconfig are installed in '/home/parallels/.local/bin' which is not on PATH. Consider adding this directory to PATH or, if you prefer to suppress this warning, use --no-warn-script-location. WARNING: The script nnvg is installed in '/home/parallels/.local/bin' which is not on PATH. Consider adding this directory to PATH or, if you prefer to suppress this warning, use --no-warn-script-location. WARNING: The scripts pyserial-miniterm and pyserial-ports are installed in '/home/parallels/.local/bin' which is not on PATH. Consider adding this directory to PATH or, if you prefer to suppress this warning, use --no-warn-script-location. WARNING: The scripts ulog2csv, ulog2kml, ulog_extract_gps_dump, ulog_info, ulog_messages and ulog_params are installed in '/home/parallels/.local/bin' which is not on PATH. Consider adding this directory to PATH or, if you prefer to suppress this warning, use --no-warn-script-location. Successfully installed MarkupSafe-2.0.1 argcomplete-1.12.3 argparse-1.4.0 cerberus-1.3.4 coverage-6.1.2 importlib-resources-5.4.0 jinja2-3.0.3 jsonschema-4.2.1 kconfiglib-14.1.0 lxml-4.6.4 nunavut-1.5.1 packaging-21.3 pandas-1.3.4 pkgconfig-1.5.5 pydsdl-1.12.1 pymavlink-2.4.17 pyros-genmsg-0.5.8 pyrsistent-0.18.0 pyserial-3.5 pyulog-0.9.0 toml-0.10.2 zipp-3.6.0

Installing NuttX dependencies Reading package lists... Building dependency tree... Reading state information... Package gcc-multilib is not available, but is referred to by another package. This may mean that the package is missing, has been obsoleted, or is only available from another source

E: Unable to locate package g++-multilib E: Couldn't find any package by regex 'g++-multilib' E: Package 'gcc-multilib' has no installation candidate

I added ~/.local/bin to path in the .bashrc file then restarted the machine and ran 'cd ~/PX4-Autopilot' then 'make clean' then 'make px4_sitl_default gazebo'

The build did not work, giving the following output:

parallels@ubuntu-linux-20-04-desktop:~/PX4-Autopilot$ make px4_sitl_default gazebo -- PX4 version: v1.13.0-alpha1-3017-g17ad7071c3 -- Found PythonInterp: /usr/bin/python3 (found suitable version "3.8.10", minimum required is "3") -- PX4 config file: /home/parallels/PX4-Autopilot/boards/px4/sitl/default.px4board -- PLATFORM posix -- ROMFSROOT px4fmu_common -- TESTING y -- ETHERNET y -- PX4 config: px4_sitl_default -- PX4 platform: posix -- PX4 lockstep: enabled -- cmake build type: RelWithDebInfo -- The CXX compiler identification is GNU 9.3.0 -- The C compiler identification is GNU 9.3.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) -- ROMFS: ROMFS/px4fmu_common -- Configuring done -- Generating done -- Build files have been written to: /home/parallels/PX4-Autopilot/build/px4_sitl_default [8/833] git submodule src/drivers/gps/devices [10/833] git submodule src/modules/mavlink/mavlink [17/833] git submodule Tools/sitl_gazebo [233/833] Generating Mavlink developme...ssage_definitions/v1.0/development.xml Validating /home/parallels/PX4-Autopilot/src/modules/mavlink/mavlink/message_definitions/v1.0/development.xml Parsing /home/parallels/PX4-Autopilot/src/modules/mavlink/mavlink/message_definitions/v1.0/development.xml Validating /home/parallels/PX4-Autopilot/src/modules/mavlink/mavlink/message_definitions/v1.0/standard.xml Parsing /home/parallels/PX4-Autopilot/src/modules/mavlink/mavlink/message_definitions/v1.0/standard.xml Validating /home/parallels/PX4-Autopilot/src/modules/mavlink/mavlink/message_definitions/v1.0/common.xml Parsing /home/parallels/PX4-Autopilot/src/modules/mavlink/mavlink/message_definitions/v1.0/common.xml Validating /home/parallels/PX4-Autopilot/src/modules/mavlink/mavlink/message_definitions/v1.0/minimal.xml Parsing /home/parallels/PX4-Autopilot/src/modules/mavlink/mavlink/message_definitions/v1.0/minimal.xml Merged enum MAV_CMD Merged enum MAV_CMD Found 222 MAVLink message types in 4 XML files Generating C implementation in directory /home/parallels/PX4-Autopilot/build/px4_sitl_default/mavlink/development Generating C implementation in directory /home/parallels/PX4-Autopilot/build/px4_sitl_default/mavlink/standard Generating C implementation in directory /home/parallels/PX4-Autopilot/build/px4_sitl_default/mavlink/common Generating C implementation in directory /home/parallels/PX4-Autopilot/build/px4_sitl_default/mavlink/minimal Copying fixed headers for protocol 2.0 to /home/parallels/PX4-Autopilot/build/px4_sitl_default/mavlink [802/833] Performing configure step for 'sitl_gazebo' -- install-prefix: /usr/local -- cmake build type: RelWithDebInfo -- The C compiler identification is GNU 9.3.0 -- The CXX compiler identification is GNU 9.3.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 standard -- ccache enabled (export CCACHE_DISABLE=1 to disable) -- Found Boost: /usr/lib/aarch64-linux-gnu/cmake/Boost-1.71.0/BoostConfig.cmake (found suitable version "1.71.0", minimum required is "1.58") found components: system thread filesystem -- Found PkgConfig: /usr/bin/pkg-config (found version "0.29.1") -- Checking for module 'bullet>=2.82' -- Found bullet, version 2.88 -- Found ccd: /usr/include (found suitable version "2.0", minimum required is "2.0") -- Found fcl: /usr/include (found suitable version "0.5.0", minimum required is "0.3.2") -- Found assimp: /usr/include (found version "5.0.0") -- Found DART: /usr/include (Required is at least version "6.6") found components: dart -- Found Boost: /usr/lib/aarch64-linux-gnu/cmake/Boost-1.71.0/BoostConfig.cmake (found suitable version "1.71.0", minimum required is "1.40.0") found components: thread system filesystem program_options regex iostreams date_time -- Found Protobuf: /usr/lib/aarch64-linux-gnu/libprotobuf.so;-lpthread (found version "3.6.1") -- Looking for ignition-math6 -- found version 6.8.0 -- Searching for dependencies of ignition-math6 -- 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/aarch64-linux-gnu/libOgreMain.so;debug;/usr/lib/aarch64-linux-gnu/libOgreMain.so -- Looking for OGRE_Paging... -- Found OGRE_Paging: optimized;/usr/lib/aarch64-linux-gnu/libOgrePaging.so;debug;/usr/lib/aarch64-linux-gnu/libOgrePaging.so -- Looking for OGRE_Terrain... -- Found OGRE_Terrain: optimized;/usr/lib/aarch64-linux-gnu/libOgreTerrain.so;debug;/usr/lib/aarch64-linux-gnu/libOgreTerrain.so -- Looking for OGRE_Property... -- Found OGRE_Property: optimized;/usr/lib/aarch64-linux-gnu/libOgreProperty.so;debug;/usr/lib/aarch64-linux-gnu/libOgreProperty.so -- Looking for OGRE_RTShaderSystem... -- Found OGRE_RTShaderSystem: optimized;/usr/lib/aarch64-linux-gnu/libOgreRTShaderSystem.so;debug;/usr/lib/aarch64-linux-gnu/libOgreRTShaderSystem.so -- Looking for OGRE_Volume... -- Found OGRE_Volume: optimized;/usr/lib/aarch64-linux-gnu/libOgreVolume.so;debug;/usr/lib/aarch64-linux-gnu/libOgreVolume.so -- Looking for OGRE_Overlay... -- Found OGRE_Overlay: optimized;/usr/lib/aarch64-linux-gnu/libOgreOverlay.so;debug;/usr/lib/aarch64-linux-gnu/libOgreOverlay.so -- Looking for ignition-math6 -- found version 6.8.0 -- Looking for ignition-transport8 -- found version 8.2.0 -- Searching for dependencies of ignition-transport8 -- Found Protobuf: /usr/lib/aarch64-linux-gnu/libprotobuf.so;-lpthread (found suitable version "3.6.1", minimum required is "3") -- Config-file not installed for ZeroMQ -- checking for pkg-config -- Checking for module 'libzmq >= 4' -- Found libzmq , version 4.3.2 -- Found ZeroMQ: TRUE (Required is at least version "4") -- Checking for module 'uuid' -- Found uuid, version 2.34.0 -- Found UUID: TRUE
-- Looking for ignition-msgs5 -- found version 5.7.0 -- Searching for dependencies of ignition-msgs5 -- Looking for ignition-math6 -- found version 6.8.0 -- Checking for module 'tinyxml2' -- Found tinyxml2, version 6.2.0 -- Looking for ignition-msgs5 -- found version 5.7.0 -- Looking for ignition-common3 -- found version 3.13.1 -- Searching for dependencies of ignition-common3 -- Looking for dlfcn.h - found -- Looking for libdl - found -- Found DL: TRUE
-- Searching for component [graphics] -- Looking for ignition-common3-graphics -- found version 3.13.1 -- Searching for dependencies of ignition-common3-graphics -- Looking for ignition-math6 -- found version 6.8.0 -- Looking for ignition-fuel_tools4 -- found version 4.3.0 -- Searching for dependencies of ignition-fuel_tools4 -- Found CURL: /usr/lib/aarch64-linux-gnu/libcurl.so (found version "7.68.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.2.2 -- Found YAML: TRUE
-- Checking for module 'libzip' -- Found libzip, version 1.5.1 -- Found ZIP: TRUE
-- Looking for ignition-common3 -- found version 3.13.1 -- Looking for ignition-msgs5 -- found version 5.7.0 -- Checking for one of the modules 'glib-2.0' -- Found PythonInterp: /usr/bin/python3 (found suitable version "3.8.10", minimum required is "3") -- Found OpenCV: /usr (found version "4.2.0") -- Found TinyXML: /usr/lib/aarch64-linux-gnu/libtinyxml.so
-- Checking for module 'gstreamer-1.0 >= 1.0' -- No package 'gstreamer-1.0' found -- Checking for module 'gstreamer-base-1.0 >= 1.0' -- No package 'gstreamer-base-1.0' found -- Checking for module 'gstreamer-app-1.0 >= 1.0' -- No package 'gstreamer-app-1.0' found -- 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/parallels/PX4-Autopilot/build/px4_sitl_default/mavlink (found version "2.0") -- catkin DISABLED -- Found Protobuf: /usr/lib/aarch64-linux-gnu/libprotobuf.so;-lpthread (found version "3.6.1") -- Checking for module 'protobuf' -- Found protobuf, version 3.6.1 -- Gazebo version: 11.5 -- Found GStreamer: adding gst_camera_plugin -- Found GStreamer: adding gst_video_stream_widget CMake Error: The following variables are used in this project, but they are set to NOTFOUND. Please set them or make sure they are set and tested correctly in the CMake files: GSTREAMER_APP_LIBRARIES (ADVANCED) linked by target "ForceVisual" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_airship_dynamics_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "sensor_msgs" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_airspeed_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_groundtruth_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "physics_msgs" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "std_msgs" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_usv_dynamics_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_video_stream_widget" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_gps_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_opticalflow_mockup_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_irlock_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_parachute_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_lidar_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_multirotor_base_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_wind_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_opticalflow_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_uuv_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_drop_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "nav_msgs" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_sonar_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_vision_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_user_camera_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_gst_camera_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "mav_msgs" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_controller_interface" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_gimbal_controller_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_imu_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_mavlink_interface" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_motor_model" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_camera_manager_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_magnetometer_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_barometer_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "LiftDragPlugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_catapult_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo GSTREAMER_LIBRARIES (ADVANCED) linked by target "ForceVisual" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_airship_dynamics_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "sensor_msgs" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_airspeed_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_groundtruth_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "physics_msgs" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "std_msgs" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_usv_dynamics_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_video_stream_widget" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_gps_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_opticalflow_mockup_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_irlock_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_parachute_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_lidar_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_multirotor_base_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_wind_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_opticalflow_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_uuv_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_drop_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "nav_msgs" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_sonar_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_vision_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_user_camera_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_gst_camera_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "mav_msgs" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_controller_interface" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_gimbal_controller_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_imu_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_mavlink_interface" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_motor_model" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_camera_manager_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_magnetometer_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_barometer_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "LiftDragPlugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_catapult_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo

-- Configuring incomplete, errors occurred! See also "/home/parallels/PX4-Autopilot/build/px4_sitl_default/build_gazebo/CMakeFiles/CMakeOutput.log". See also "/home/parallels/PX4-Autopilot/build/px4_sitl_default/build_gazebo/CMakeFiles/CMakeError.log". [825/833] Building CXX object platforms/posix/CMakeFiles/px4.dir/apps.cpp.o FAILED: external/Stamp/sitl_gazebo/sitl_gazebo-configure cd /home/parallels/PX4-Autopilot/build/px4_sitl_default/build_gazebo && /usr/bin/cmake -DCMAKE_INSTALL_PREFIX=/usr/local -DSEND_ODOMETRY_DATA=ON -DGENERATE_ROS_MODELS=ON -GNinja /home/parallels/PX4-Autopilot/Tools/sitl_gazebo && /usr/bin/cmake -E touch /home/parallels/PX4-Autopilot/build/px4_sitl_default/external/Stamp/sitl_gazebo/sitl_gazebo-configure [827/833] Building CXX object src/modu...es__mavlink.dir/mavlink_messages.cpp.o ninja: build stopped: subcommand failed. make: *** [Makefile:225: px4_sitl_default] Error 1

Please help!!

Jaeyoung-Lim commented 2 years ago

@joelfinnigan You can see the error in the log:

1.0'
-- No package 'gstreamer-app-1.0' found
joelfinnigan commented 2 years ago

Hi, I tried to install gstreamer using instructions from this post: https://github.com/PX4/PX4-Autopilot/issues/13416#issuecomment-552136098

I restarted and attempted to build again however I unfortunately still got an error related to gstreamer:

parallels@ubuntu-linux-20-04-desktop:~/PX4-Autopilot$ make px4_sitl_default gazebo -- PX4 version: v1.13.0-alpha1-3455-g43fb076828 -- Found PythonInterp: /usr/bin/python3 (found suitable version "3.8.10", minimum required is "3") -- PX4 config file: /home/parallels/PX4-Autopilot/boards/px4/sitl/default.px4board -- PLATFORM posix -- ROMFSROOT px4fmu_common -- TESTING y -- ETHERNET y -- PX4 config: px4_sitl_default -- PX4 platform: posix -- PX4 lockstep: enabled -- cmake build type: RelWithDebInfo -- The CXX compiler identification is GNU 9.3.0 -- The C compiler identification is GNU 9.3.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) -- ROMFS: ROMFS/px4fmu_common -- Configuring done -- Generating done -- Build files have been written to: /home/parallels/PX4-Autopilot/build/px4_sitl_default [7/828] git submodule src/drivers/gps/devices [9/828] git submodule src/modules/mavlink/mavlink [235/828] git submodule Tools/sitl_gazebo [501/828] Generating Mavlink developme...ssage_definitions/v1.0/development.xml Validating /home/parallels/PX4-Autopilot/src/modules/mavlink/mavlink/message_definitions/v1.0/development.xml Parsing /home/parallels/PX4-Autopilot/src/modules/mavlink/mavlink/message_definitions/v1.0/development.xml Validating /home/parallels/PX4-Autopilot/src/modules/mavlink/mavlink/message_definitions/v1.0/standard.xml Parsing /home/parallels/PX4-Autopilot/src/modules/mavlink/mavlink/message_definitions/v1.0/standard.xml Validating /home/parallels/PX4-Autopilot/src/modules/mavlink/mavlink/message_definitions/v1.0/common.xml Parsing /home/parallels/PX4-Autopilot/src/modules/mavlink/mavlink/message_definitions/v1.0/common.xml Validating /home/parallels/PX4-Autopilot/src/modules/mavlink/mavlink/message_definitions/v1.0/minimal.xml Parsing /home/parallels/PX4-Autopilot/src/modules/mavlink/mavlink/message_definitions/v1.0/minimal.xml Merged enum MAV_CMD Merged enum MAV_CMD Found 222 MAVLink message types in 4 XML files Generating C implementation in directory /home/parallels/PX4-Autopilot/build/px4_sitl_default/mavlink/development Generating C implementation in directory /home/parallels/PX4-Autopilot/build/px4_sitl_default/mavlink/standard Generating C implementation in directory /home/parallels/PX4-Autopilot/build/px4_sitl_default/mavlink/common Generating C implementation in directory /home/parallels/PX4-Autopilot/build/px4_sitl_default/mavlink/minimal Copying fixed headers for protocol 2.0 to /home/parallels/PX4-Autopilot/build/px4_sitl_default/mavlink [667/828] Performing configure step for 'sitl_gazebo' -- install-prefix: /usr/local -- cmake build type: RelWithDebInfo -- The C compiler identification is GNU 9.3.0 -- The CXX compiler identification is GNU 9.3.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 standard -- ccache enabled (export CCACHE_DISABLE=1 to disable) -- Found Boost: /usr/lib/aarch64-linux-gnu/cmake/Boost-1.71.0/BoostConfig.cmake (found suitable version "1.71.0", minimum required is "1.58") found components: system thread filesystem -- Found PkgConfig: /usr/bin/pkg-config (found version "0.29.1") -- Checking for module 'bullet>=2.82' -- Found bullet, version 2.88 -- Found ccd: /usr/include (found suitable version "2.0", minimum required is "2.0") -- Found fcl: /usr/include (found suitable version "0.5.0", minimum required is "0.3.2") -- Found assimp: /usr/include (found version "5.0.0") -- Found DART: /usr/include (Required is at least version "6.6") found components: dart -- Found Boost: /usr/lib/aarch64-linux-gnu/cmake/Boost-1.71.0/BoostConfig.cmake (found suitable version "1.71.0", minimum required is "1.40.0") found components: thread system filesystem program_options regex iostreams date_time -- Found Protobuf: /usr/lib/aarch64-linux-gnu/libprotobuf.so;-lpthread (found version "3.6.1") -- Looking for ignition-math6 -- found version 6.9.2 -- Searching for dependencies of ignition-math6 -- 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/aarch64-linux-gnu/libOgreMain.so;debug;/usr/lib/aarch64-linux-gnu/libOgreMain.so -- Looking for OGRE_Paging... -- Found OGRE_Paging: optimized;/usr/lib/aarch64-linux-gnu/libOgrePaging.so;debug;/usr/lib/aarch64-linux-gnu/libOgrePaging.so -- Looking for OGRE_Terrain... -- Found OGRE_Terrain: optimized;/usr/lib/aarch64-linux-gnu/libOgreTerrain.so;debug;/usr/lib/aarch64-linux-gnu/libOgreTerrain.so -- Looking for OGRE_Property... -- Found OGRE_Property: optimized;/usr/lib/aarch64-linux-gnu/libOgreProperty.so;debug;/usr/lib/aarch64-linux-gnu/libOgreProperty.so -- Looking for OGRE_RTShaderSystem... -- Found OGRE_RTShaderSystem: optimized;/usr/lib/aarch64-linux-gnu/libOgreRTShaderSystem.so;debug;/usr/lib/aarch64-linux-gnu/libOgreRTShaderSystem.so -- Looking for OGRE_Volume... -- Found OGRE_Volume: optimized;/usr/lib/aarch64-linux-gnu/libOgreVolume.so;debug;/usr/lib/aarch64-linux-gnu/libOgreVolume.so -- Looking for OGRE_Overlay... -- Found OGRE_Overlay: optimized;/usr/lib/aarch64-linux-gnu/libOgreOverlay.so;debug;/usr/lib/aarch64-linux-gnu/libOgreOverlay.so -- Looking for ignition-math6 -- found version 6.9.2 -- Looking for ignition-transport8 -- found version 8.2.1 -- Searching for dependencies of ignition-transport8 -- Found Protobuf: /usr/lib/aarch64-linux-gnu/libprotobuf.so;-lpthread (found suitable version "3.6.1", minimum required is "3") -- Config-file not installed for ZeroMQ -- checking for pkg-config -- Checking for module 'libzmq >= 4' -- Found libzmq , version 4.3.2 -- Found ZeroMQ: TRUE (Required is at least version "4") -- Checking for module 'uuid' -- Found uuid, version 2.34.0 -- Found UUID: TRUE
-- Looking for ignition-msgs5 -- found version 5.8.1 -- Searching for dependencies of ignition-msgs5 -- Looking for ignition-math6 -- found version 6.9.2 -- Checking for module 'tinyxml2' -- Found tinyxml2, version 6.2.0 -- Looking for ignition-msgs5 -- found version 5.8.1 -- Looking for ignition-common3 -- found version 3.14.0 -- Searching for dependencies of ignition-common3 -- Looking for dlfcn.h - found -- Looking for libdl - found -- Found DL: TRUE
-- Searching for component [graphics] -- Looking for ignition-common3-graphics -- found version 3.14.0 -- Searching for dependencies of ignition-common3-graphics -- Looking for ignition-math6 -- found version 6.9.2 -- Looking for ignition-fuel_tools4 -- found version 4.4.0 -- Searching for dependencies of ignition-fuel_tools4 -- Found CURL: /usr/lib/aarch64-linux-gnu/libcurl.so (found version "7.68.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.2.2 -- Found YAML: TRUE
-- Checking for module 'libzip' -- Found libzip, version 1.5.1 -- Found ZIP: TRUE
-- Looking for ignition-common3 -- found version 3.14.0 -- Looking for ignition-math6 -- found version 6.9.2 -- Looking for ignition-msgs5 -- found version 5.8.1 -- Checking for one of the modules 'glib-2.0' -- Found PythonInterp: /usr/bin/python3 (found suitable version "3.8.10", minimum required is "3") -- Found OpenCV: /usr (found version "4.2.0") -- Found TinyXML: /usr/lib/aarch64-linux-gnu/libtinyxml.so
-- Checking for module 'gstreamer-1.0 >= 1.0' -- Found gstreamer-1.0 , version 1.16.2 -- Checking for module 'gstreamer-base-1.0 >= 1.0' -- Found gstreamer-base-1.0 , version 1.16.2 -- Checking for module 'gstreamer-app-1.0 >= 1.0' -- No package 'gstreamer-app-1.0' found -- 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/parallels/PX4-Autopilot/build/px4_sitl_default/mavlink (found version "2.0") -- catkin DISABLED -- Found Protobuf: /usr/lib/aarch64-linux-gnu/libprotobuf.so;-lpthread (found version "3.6.1") -- Checking for module 'protobuf' -- Found protobuf, version 3.6.1 -- Gazebo version: 11.9 -- Found GStreamer: adding gst_camera_plugin -- Found GStreamer: adding gst_video_stream_widget CMake Error: The following variables are used in this project, but they are set to NOTFOUND. Please set them or make sure they are set and tested correctly in the CMake files: GSTREAMER_APP_LIBRARIES (ADVANCED) linked by target "ForceVisual" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_airship_dynamics_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "sensor_msgs" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_airspeed_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_groundtruth_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "physics_msgs" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "std_msgs" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_usv_dynamics_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_video_stream_widget" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_gps_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_opticalflow_mockup_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_irlock_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_parachute_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_lidar_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_multirotor_base_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_wind_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_opticalflow_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_uuv_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_drop_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "nav_msgs" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_sonar_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_vision_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_user_camera_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_gst_camera_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "mav_msgs" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_controller_interface" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_gimbal_controller_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_imu_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_mavlink_interface" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_motor_model" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_camera_manager_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_magnetometer_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_barometer_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "LiftDragPlugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo linked by target "gazebo_catapult_plugin" in directory /home/parallels/PX4-Autopilot/Tools/sitl_gazebo

-- Configuring incomplete, errors occurred! See also "/home/parallels/PX4-Autopilot/build/px4_sitl_default/build_gazebo/CMakeFiles/CMakeOutput.log". See also "/home/parallels/PX4-Autopilot/build/px4_sitl_default/build_gazebo/CMakeFiles/CMakeError.log". [822/828] Linking CXX executable bin/px4 FAILED: external/Stamp/sitl_gazebo/sitl_gazebo-configure cd /home/parallels/PX4-Autopilot/build/px4_sitl_default/build_gazebo && /usr/bin/cmake -DCMAKE_INSTALL_PREFIX=/usr/local -DSEND_ODOMETRY_DATA=ON -DGENERATE_ROS_MODELS=ON -GNinja /home/parallels/PX4-Autopilot/Tools/sitl_gazebo && /usr/bin/cmake -E touch /home/parallels/PX4-Autopilot/build/px4_sitl_default/external/Stamp/sitl_gazebo/sitl_gazebo-configure [824/828] Linking CXX executable bin/px4 ninja: build stopped: subcommand failed. make: *** [Makefile:225: px4_sitl_default] Error 1

I then tried 'sudo apt-get install libgstreamer1.0-dev libgstreamer-plugins-base1.0-dev' before attempting to build again, however this now causes terminal to crash:

image

Any ideas?

joelfinnigan commented 2 years ago

Have tried reinstalling streamer with:

sudo apt-get install --reinstall gstreamer1.0-alsa gstreamer1.0-libav gstreamer1.0-plugins-bad gstreamer1.0-plugins-base gstreamer1.0-plugins-good gstreamer1.0-plugins-ugly gstreamer1.0-pulseaudio libgstreamer-plugins-bad1.0-0 libgstreamer-plugins-base1.0-0 libgstreamer-plugins-good1.0-0 libgstreamer1.0-0

However building still causes terminal crash - seems to crash on the same step each time (39/130 whilst generating typhoon_h480)

Jaeyoung-Lim commented 2 years ago

@joelfinnigan Did the error change after installing thr gstreamer plugins?

joelfinnigan commented 2 years ago

@Jaeyoung-Lim yes, before I was just getting the error message but now it causes terminal to freeze and crash?

Jaeyoung-Lim commented 2 years ago

@joelfinnigan How much memory do you have on your system? if it is less than 8GB, you are probably running out of memory

joelfinnigan commented 2 years ago

@Jaeyoung-Lim thanks you were right! Increased the memory allocation of the VM and build is now working and the GUI opens! Am now getting a new error message when I try to initiate takeoff however:


| \ \ \ / / / | | |/ / \ V / / /| | | / / \ / /_| | | | / /^\ \ __ | _| \/ \/ |/

px4 starting.

INFO [px4] Calling startup script: /bin/sh etc/init.d-posix/rcS 0 INFO [init] found model autostart file as SYS_AUTOSTART=10016 INFO [param] selected parameter default file eeprom/parameters_10016 [param] parameter file not found, creating eeprom/parameters_10016 SYS_AUTOCONFIG: curr: 0 -> new: 1 SYS_AUTOSTART: curr: 0 -> new: 10016 CAL_ACC0_ID: curr: 0 -> new: 1310988 CAL_GYRO0_ID: curr: 0 -> new: 1310988 CAL_ACC1_ID: curr: 0 -> new: 1310996 CAL_GYRO1_ID: curr: 0 -> new: 1310996 CAL_ACC2_ID: curr: 0 -> new: 1311004 CAL_GYRO2_ID: curr: 0 -> new: 1311004 CAL_MAG0_ID: curr: 0 -> new: 197388 CAL_MAG1_ID: curr: 0 -> new: 197644 SENS_BOARD_X_OFF: curr: 0.0000 -> new: 0.0000 SENS_DPRES_OFF: curr: 0.0000 -> new: 0.0010

  • SYS_AUTOCONFIG: curr: 1 -> new: 0 IMU_INTEG_RATE: curr: 200 -> new: 250 INFO [dataman] data manager file './dataman' size is 11798680 bytes PX4 SIM HOST: localhost INFO [simulator] Waiting for simulator to accept connection on TCP port 4560 INFO [simulator] Simulator connected on TCP port 4560. INFO [commander] LED: open /dev/led0 failed (22) Gazebo multi-robot simulator, version 11.9.0 Copyright (C) 2012 Open Source Robotics Foundation. Released under the Apache 2 License. http://gazebosim.org

[Msg] Waiting for master. PWM_AUX_OUT: curr: 0 -> new: 1234 PWM_MAIN_OUT: curr: 0 -> new: 1234 [Msg] Connected to gazebo master @ http://127.0.0.1:11345 [Msg] Publicized address: 10.211.55.9 INFO [init] Mixer: etc/mixers/quad_w.main.mix on /dev/pwm_output0 INFO [init] setting PWM_AUX_OUT none INFO [mavlink] mode: Normal, data rate: 4000000 B/s on udp port 18570 remote port 14550 INFO [mavlink] mode: Onboard, data rate: 4000000 B/s on udp port 14580 remote port 14540 INFO [mavlink] mode: Onboard, data rate: 4000 B/s on udp port 14280 remote port 14030 INFO [mavlink] mode: Gimbal, data rate: 400000 B/s on udp port 13030 remote port 13280 INFO [logger] logger started (mode=all) INFO [logger] Start file log (type: full) INFO [logger] [logger] ./log/2021-11-20/13_02_52.ulg INFO [logger] Opened full log file: ./log/2021-11-20/13_0252.ulg INFO [mavlink] MAVLink only on localhost (set param MAV{i}BROADCAST = 1 to enable network) INFO [mavlink] MAVLink only on localhost (set param MAV{i}_BROADCAST = 1 to enable network) INFO [px4] Startup script returned successfully pxh> INFO [tone_alarm] home set INFO [tone_alarm] notify negative pxh> commander takeoff pxh> INFO [commander] Armed by internal command
INFO [navigator] Using minimum takeoff altitude: 2.50 m
INFO [commander] Takeoff detected
WARN [commander] Failsafe enabled: no datalink
INFO [commander] Failsafe mode activated INFO [tone_alarm] battery warning (fast) INFO [navigator] RTL HOME activated
INFO [navigator] RTL: landing at home position.
INFO [navigator] RTL: climb to 489 m (1 m above destination) INFO [commander] Failsafe mode deactivated
INFO [navigator] RTL: return at 489 m (1 m above destination)
INFO [navigator] RTL: land at destination
INFO [commander] Landing detected
INFO [commander] Disarmed by landing INFO [logger] closed logfile, bytes written: 1364578

I think this may be because I don't have QGroundControl installed? I have tried installing using the instructions given here: https://docs.qgroundcontrol.com/master/en/getting_started/download_and_install.html

However I get this error:

parallels@ubuntu-linux-20-04-desktop:~$ ~/Downloads/QGroundControl.AppImage bash: /home/parallels/Downloads/QGroundControl.AppImage: cannot execute binary file: Exec format error

Is this because I have an ARM chipset or have I missed a step somewhere? If it is the former, what would you recommend?

Jaeyoung-Lim commented 2 years ago

@joelfinnigan It looks like it, but not sure.

joelfinnigan commented 2 years ago

@Jaeyoung-Lim what would you recommend?

Jaeyoung-Lim commented 2 years ago

@joelfinnigan I would try finding an arm image of QGC(or if there is no image available, building it from source).

In any case, closing this issueas it is not related to simulation anymore.

joelfinnigan commented 2 years ago

@Jaeyoung-Lim ok thanks

JustinHsuNctu commented 8 months ago

please execute next command: bash ./PX4-Autopilot/Tools/setup/ubuntu.sh