ros / meta-ros

OpenEmbedded Layers for ROS 1 and ROS 2
MIT License
374 stars 249 forks source link

configure error when for mrpt2 in meta-ros foxy #730

Closed willofdiamond closed 3 years ago

willofdiamond commented 3 years ago

Hi I am trying to integrate Meta-ros foxy with my yocto build using CORE_IMAGE_EXTRA_INSTALL += " ros-core packagegroup-ros-world-foxy" in my local.conf for raspberry pi 3. By adding packagegroup-ros-world-foxy to CORE_IMAGE_EXTRA_INSTALL I am receiving a configure error with mrpt2 . Not sure how to fix this issue

ERROR: mrpt2-2.0.4-1-r0 do_configure: Execution of '/home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0/temp/run.do_configure.6120' failed with exit code 1:
-- The C compiler identification is GNU 10.1.0
-- The CXX compiler identification is GNU 10.1.0
-- Check for working C compiler: /home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0/recipe-sysroot-native/usr/bin/aarch64-oe-linux/aarch64-oe-linux-gcc
-- Check for working C compiler: /home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0/recipe-sysroot-native/usr/bin/aarch64-oe-linux/aarch64-oe-linux-gcc - 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: /home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0/recipe-sysroot-native/usr/bin/aarch64-oe-linux/aarch64-oe-linux-g++
-- Check for working CXX compiler: /home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0/recipe-sysroot-native/usr/bin/aarch64-oe-linux/aarch64-oe-linux-g++ - works
-- Detecting CXX compiler ABI info
-- Detecting CXX compiler ABI info - done
-- Detecting CXX compile features
-- Detecting CXX compile features - done
-- Found PkgConfig: /home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0/recipe-sysroot-native/usr/bin/pkg-config (found version "0.29.2")
-- Looking for timegm
-- Looking for timegm - found
-- Looking for _mkgmtime
-- Looking for _mkgmtime - not found
-- Looking for alloca
-- Looking for alloca - not found
-- Looking for gettid
-- Looking for gettid - found
-- Looking for sincos
-- Looking for sincos - found
-- Looking for strtok_r
-- Looking for strtok_r - found
-- Looking for _aligned_malloc
-- Looking for _aligned_malloc - not found
-- Looking for alloca.h
-- Looking for alloca.h - found
-- Looking for linux/serial.h
-- Looking for linux/serial.h - found
-- Looking for linux/input.h
-- Looking for linux/input.h - found
-- Looking for malloc.h
-- Looking for malloc.h - found
-- Looking for malloc/malloc.h
-- Looking for malloc/malloc.h - not found
-- Looking for stdint.h
-- Looking for stdint.h - found
-- Looking for inttypes.h
-- Looking for inttypes.h - found
-- Looking for winsock2.h
-- Looking for winsock2.h - not found
-- Looking for windows.h>
#include <winusb.h
-- Looking for windows.h>
#include <winusb.h - not found
-- Looking for sys/types.h
-- Looking for sys/types.h - found
-- Looking for stddef.h
-- Looking for stddef.h - found
-- Check size of long double
-- Check size of long double - done
-- Check if the system is big endian
-- Searching 16 bit integer
-- Check size of unsigned short
-- Check size of unsigned short - done
-- Searching 16 bit integer - Using unsigned short
-- Check if the system is big endian - little endian
-- Looking for pthread.h
-- Looking for pthread.h - found
-- Performing Test CMAKE_HAVE_LIBC_PTHREAD
-- Performing Test CMAKE_HAVE_LIBC_PTHREAD - Failed
-- Check if compiler accepts -pthread
-- Check if compiler accepts -pthread - yes
-- Found Threads: TRUE
-- Found OpenGL: /home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0/recipe-sysroot/usr/lib/libGL.so
-- Found GLUT: /home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0/recipe-sysroot/usr/lib/libglut.so
-- Found JPEG: /home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0/recipe-sysroot/usr/lib/libjpeg.so (found version "62")
-- Checking for one of the modules 'glfw3'
-- Setting build type to 'Release' as none was specified.
-- GLFW: System library found.
-- Performing Test HAS_CPP14_FLAG
-- Performing Test HAS_CPP14_FLAG - Success
-- Performing Test HAS_CPP11_FLAG
-- Performing Test HAS_CPP11_FLAG - Success
CMake Error: TRY_RUN() invoked in cross-compiling mode, please set the following cache variables appropriately:
   HAS_LTO_EXITCODE (advanced)
   HAS_LTO_EXITCODE__TRYRUN_OUTPUT (advanced)
For details see /home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0/build/TryRunResults.cmake
-- NanoGUI: LTO support enabled.
-- Performing Test PCAP_LINKS_SOLO
-- Performing Test PCAP_LINKS_SOLO - Success
-- Looking for pcap_get_pfring_id
-- Looking for pcap_get_pfring_id - not found
CMake Warning at cmakemodules/script_qt.cmake:10 (find_package):
  By not providing "FindQt5.cmake" in CMAKE_MODULE_PATH this project has
  asked CMake to find a package configuration file provided by "Qt5", but
  CMake did not find one.

  Could not find a package configuration file provided by "Qt5" with any of
  the following names:

    Qt5Config.cmake
    qt5-config.cmake

  Add the installation prefix of "Qt5" to CMAKE_PREFIX_PATH or set "Qt5_DIR"
  to a directory containing one of the above files.  If "Qt5" provides a
  separate development package or SDK, be sure it has been installed.
Call Stack (most recent call first):
  CMakeLists.txt:262 (include)

-- wxWidgets: No gtk3 version found, falling back to default (likely gtk2)
-- Could NOT find wxWidgets (missing: wxWidgets_LIBRARIES wxWidgets_INCLUDE_DIRS)
-- Found ZLIB: /home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0/recipe-sysroot/usr/lib/libz.so (found version "1.2.11")
-- mrpt-ros1bridge: Skipping due to missing dependencies
-- No wxWidgets: Skipping target `2d-slam-demo`
-- wxWidgets and/or GL/GLUT not found!: **This target will not be included in the Makefiles**
-- No wxWidgets: Skipping target `RawLogViewer`
-- No wxWidgets: Skipping target `ReactiveNavigationDemo`
-- wxWidgets and/or GL/GLUT not found!: **This target will not be included in the Makefiles**
-- No wxWidgets: Skipping target `camera-calib`
-- wxWidgets and/or GL/GLUT not found!: **This target will not be included in the Makefiles**
-- wxWidgets and/or GL/GLUT not found!: **This target will not be included in the Makefiles**
-- No wxWidgets: Skipping target `holonomic-navigator-demo`
-- No wxWidgets: Skipping target `kinect-stereo-calib`
-- No wxWidgets: Skipping target `ptg-configurator`
-- No wxWidgets: Skipping target `robotic-arm-kinematics`
-- Could NOT find Doxygen (missing: DOXYGEN_EXECUTABLE)
--
-- List of MRPT libs/modules to be built (and dependencies):
-- -----------------------------------------------------------------
--  Modules: apps;bayes;comms;config;containers;core;detectors;expr;graphs;graphslam;gui;hmtslam;hwdrivers;img;io;kinematics;maps;math;nanoflann;nav;obs;opengl;poses;random;rtti;serialization;slam;system;tclap;tfest;topography;typemeta;vision
--
-- +===========================================================================+
-- |         Resulting configuration for MRPT 2.0.4                            |
-- +===========================================================================+
--  _________________________ PLATFORM _____________________________
--  Host                        : Linux4.15.0-96-genericx86_64
--  Target                      : Linuxaarch64
--  Architecture (uname -m)     : aarch64
--  CMAKE_INSTALL_FULL_LIBDIR   : /usr/lib
--  Is the system big endian?   :  No
--  Word size (32/64 bit)       : 64
--  CMake version               : 3.17.3
--  CMake generator             : Ninja
--  CMake build tool            : ninja
--  MRPT SOURCE_DATE_EPOCH      : 1592725367 (2020-06-21)
--  Compiler                    : /home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0/recipe-sysroot-native/usr/bin/aarch64-oe-linux/aarch64-oe-linux-g++ Version: 10.1.0
--  Configuration               : Release
--  C++ flags                   :  -mcpu=cortex-a53+crc  --sysroot=/home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0/recipe-sysroot  -O2 -pipe -g -feliminate-unused-debug-types -fmacro-prefix-map=/home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0=/usr/src/debug/mrpt2/2.0.4-1-r0                      -fdebug-prefix-map=/home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0=/usr/src/debug/mrpt2/2.0.4-1-r0                      -fdebug-prefix-map=/home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0/recipe-sysroot=                      -fdebug-prefix-map=/home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0/recipe-sysroot-native=  -fvisibility-inlines-hidden  -mcpu=cortex-a53+crc  --sysroot=/home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0/recipe-sysroot
--  clang-tidy checks           :
--
--  __________________________ OPTIONS _____________________________
--  Build MRPT as a shared library?   : Yes
--  Use SIMD optimizations?           : SSE2=0 SSE3=0 SSE4.1=0 SSE4.2=0 SSE4a=0 AVX=0 AVX2=0 NEON=0 [Manually set]
--  Install prefix                    : /usr
--  C++ config header                 : /home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0/build/include/mrpt-configuration
--
--  _____________________ MANDATORY LIBRARIES ______________________
--  eigen3                               : Yes (System) [Version: 3.3.7]
--  - Assumed max. EIGEN_MAX_ALIGN_BYTES         : 32
--  - Assumed max. EIGEN_MAX_STATIC_ALIGN_BYTES  : 32
--  zlib (compression)                   : Yes (System)
--
--  ______________________ OPTIONAL LIBRARIES ______________________
--  Assimp (3D models)                   : Yes (System) [Version: 5.0.0]
--  ffmpeg libs (Video streaming)        : Yes (System) [avcodec 58.91.100, avutil 56.51.100, avformat 58.45.100]
--  gtest (Google unit testing library)  : Yes (Built-in)
--  jsoncpp (JSON format serialization)  :  No [Version: ]
--  libjpeg (jpeg)                       : Yes (System)
--  liblas (ASPRS LAS LiDAR format)      :  No
--  mexplus                              :  No
--  Octomap                              : Yes (Built-in) [Version: ]
--  OpenCV (Image manipulation)          : Yes (System) [Version: 4.3.0]
--  OpenGL                               : Yes (System)
--  GLUT                                 : Yes (System)
--  PCAP (Wireshark logs for Velodyne)   : Yes (System)
--  SuiteSparse                          :  No
--  tinyxml2                             :  No
--  wxWidgets                            :  No [Version:  ]
--  yamlcpp (YAML file format)           :  No [Version: ]
--
--  ______________________ GUI LIBRARIES ______________________
--  nanogui (OpenGL GUI)                 : Yes
--  Qt5                                  :  No
--  wxWidgets                            :  No
--
--  _______________________ WRAPPERS/BINDINGS ______________________
--  Matlab / mex files         :  No [Version: ]
--  Python3 bindings (pymrpt)   :  No [Version: 3.8.5]
--   - dep: Boost found?       :  No
--   - dep: Python3 found?     : Yes
--  ROS1:
--   cv_bridge (0)  geometry_msgs (0) nav_msgs (0)
--   pcl_conversions (Optional) (0)  rosbag_storage (0) roscpp (0)
--   sensor_msgs (0)  std_msgs (0) stereo_msgs (0)
--   tf2 (0)  tf2_msgs (0)
--
--  _____________________ HARDWARE & SENSORS _______________________
--  libdc1394-2 (FireWire capture)       :  No
--  DUO3D Camera libs                    :  No
--  Flir FlyCapture2                     :  No
--  Flir Triclops                        :  No
--  libftdi (USB)                        :  No [Version: ]
--  National Instruments...
--  MYNTEYE-D SDK                        :  No
--  ...NIDAQmx?                          :  No
--  ...NIDAQmx Base?                     :  No
--  NITE2 library                        :  No
--  OpenKinect libfreenect               : Yes (Built-in)
--  OpenNI2                              :  No
--  Phidgets                             :  No
--  RoboPeak LIDAR                       : Yes
--  SwissRanger 3/4000 3D camera         :  No
--  Videre SVS stereo camera             :  No
--  libudev (requisite for XSensMT)      : Yes (System)
--  xSENS MT                             : Yes (Built-in)
--  Intersense sensors                   :  No
--
-- Configuring incomplete, errors occurred!
See also "/home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0/build/CMakeFiles/CMakeOutput.log".
See also "/home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0/build/CMakeFiles/CMakeError.log".
WARNING: /home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0/temp/run.do_configure.6120:1 exit 1 from 'cmake -G 'Ninja' -DCMAKE_MAKE_PROGRAM=ninja $oecmake_sitefile /home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0/git -DCMAKE_INSTALL_PREFIX:PATH=/usr -DCMAKE_INSTALL_BINDIR:PATH=bin -DCMAKE_INSTALL_SBINDIR:PATH=sbin -DCMAKE_INSTALL_LIBEXECDIR:PATH=libexec -DCMAKE_INSTALL_SYSCONFDIR:PATH=/etc -DCMAKE_INSTALL_SHAREDSTATEDIR:PATH=../com -DCMAKE_INSTALL_LOCALSTATEDIR:PATH=/var -DCMAKE_INSTALL_LIBDIR:PATH=lib -DCMAKE_INSTALL_INCLUDEDIR:PATH=include -DCMAKE_INSTALL_DATAROOTDIR:PATH=share -DPYTHON_EXECUTABLE:PATH=/usr/bin/python3 -DPython_EXECUTABLE:PATH=/usr/bin/python3 -DPython3_EXECUTABLE:PATH=/usr/bin/python3 -DLIB_SUFFIX= -DCMAKE_INSTALL_SO_NO_EXE=0 -DCMAKE_TOOLCHAIN_FILE=/home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0/toolchain.cmake -DCMAKE_NO_SYSTEM_FROM_IMPORTED=1 -Wno-dev'

ERROR: Logfile of failure stored in: /home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0/temp/log.do_configure.6120
 WARNING: /home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0/temp/run.do_configure.6120:1 exit 1 from 'cmake -G 'Ninja' -DCMAKE_MAKE_PROGRAM=ninja $oecmake_sitefile /home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0/git -DCMAKE_INSTALL_PREFIX:PATH=/usr -DCMAKE_INSTALL_BINDIR:PATH=bin -DCMAKE_INSTALL_SBINDIR:PATH=sbin -DCMAKE_INSTALL_LIBEXECDIR:PATH=libexec -DCMAKE_INSTALL_SYSCONFDIR:PATH=/etc -DCMAKE_INSTALL_SHAREDSTATEDIR:PATH=../com -DCMAKE_INSTALL_LOCALSTATEDIR:PATH=/var -DCMAKE_INSTALL_LIBDIR:PATH=lib -DCMAKE_INSTALL_INCLUDEDIR:PATH=include -DCMAKE_INSTALL_DATAROOTDIR:PATH=share -DPYTHON_EXECUTABLE:PATH=/usr/bin/python3 -DPython_EXECUTABLE:PATH=/usr/bin/python3 -DPython3_EXECUTABLE:PATH=/usr/bin/python3 -DLIB_SUFFIX= -DCMAKE_INSTALL_SO_NO_EXE=0 -DCMAKE_TOOLCHAIN_FILE=/home/haradhyu/poky/noRosbuild/tmp/work/cortexa53-oe-linux/mrpt2/2.0.4-1-r0/toolchain.cmake -DCMAKE_NO_SYSTEM_FROM_IMPORTED=1 -Wno-dev'
|
ERROR: Task (/home/haradhyu/poky/meta-ros/meta-ros2-foxy/generated-recipes/mrpt2/mrpt2_2.0.4-1.bb:do_configure) failed with exit code '1'
NOTE: Tasks Summary: Attempted 11037 tasks of which 10438 didn't need to be rerun and 2 failed.

Summary: 2 tasks failed:
  /home/haradhyu/poky/meta-ros/meta-ros2-foxy/generated-recipes/libg2o/libg2o_2020.5.29-1.bb:do_configure
  /home/haradhyu/poky/meta-ros/meta-ros2-foxy/generated-recipes/mrpt2/mrpt2_2.0.4-1.bb:do_configure
Summary: There were 2 ERROR messages shown, returning a non-zero exit code.
shr-project commented 3 years ago

Please always include at least "Build Configuration:" section shown at the beginning of the build and better describe the build configuration you've used.

mrpt2 isn't included in the default builds we're regularly testing (as defined by .mcf files and described in documentation). After adding commercial to LICENSE_FLAGS_WHITELIST I was able to reproduce this issue and will add a fix for it, but there are some other issues in mrpt2 as well, so you need mrpt2 (and all of packagegroup-ros-world-foxy) in your image?

shr-project commented 3 years ago

Fixed in milestone 14.