ctu-mrs / px4_sitl_gazebo

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

Unable to compile on Ubuntu 20.04 / ROS Noetic. #1

Closed ViktorWalter closed 3 years ago

ViktorWalter commented 3 years ago

The package does not compile on Ubuntu 20.04 / ROS Noetic. It appears to be missing a python package called empy, even though it is installed for me.

simulation/ros_packages/mavlink_sitl_gazebo [viktor@viktor-desktop][17:30]
>catkin bt                                                                                                                                                                                            ==============
==> Expanding alias 'bt' from 'catkin bt' to 'catkin b --this'
==> Expanding alias 'b' from 'catkin b --this' to 'catkin build --this'
---------------------------------------------------------------
Profile:                     default
Extending:          [cached] /opt/ros/noetic
Workspace:                   /home/viktor/mrs_workspace
---------------------------------------------------------------
Build Space:        [exists] /home/viktor/mrs_workspace/build
Devel Space:        [exists] /home/viktor/mrs_workspace/devel
Install Space:      [unused] /home/viktor/mrs_workspace/install
Log Space:          [exists] /home/viktor/mrs_workspace/logs
Source Space:       [exists] /home/viktor/mrs_workspace/src
DESTDIR:            [unused] None
---------------------------------------------------------------
Devel Space Layout:          linked
Install Space Layout:        None
---------------------------------------------------------------
Additional CMake Args:       None
Additional Make Args:        None
Additional catkin Make Args: None
Internal Make Job Server:    True
Cache Job Environments:      False
---------------------------------------------------------------
Whitelisted Packages:        None
Blacklisted Packages:        None
---------------------------------------------------------------
Workspace configuration appears valid.
---------------------------------------------------------------
[build] Found '64' packages in 0.0 seconds.
[build] Package table is up to date.
Starting  >>> libmavconn
Starting  >>> mavros_msgs
Finished  <<< libmavconn                         [ 0.1 seconds ]
Finished  <<< mavros_msgs                        [ 0.7 seconds ]
Starting  >>> mavros
Finished  <<< mavros                             [ 0.4 seconds ]
Starting  >>> mavlink_sitl_gazebo
____________________________________________________________________________________________________________________________________________________________________________________________________________________
Errors     << mavlink_sitl_gazebo:cmake /home/viktor/mrs_workspace/logs/mavlink_sitl_gazebo/build.cmake.013.log
CMake Error at /opt/ros/noetic/share/catkin/cmake/empy.cmake:30 (message):
  Unable to find either executable 'empy' or Python module 'em'...  try
  installing the package 'python3-empy'
Call Stack (most recent call first):
  /opt/ros/noetic/share/catkin/cmake/all.cmake:164 (include)
  /opt/ros/noetic/share/catkin/cmake/catkinConfig.cmake:20 (include)
  external/OpticalFlow/external/klt_feature_tracker/CMakeLists.txt:19 (find_package)

cd /home/viktor/mrs_workspace/build/mavlink_sitl_gazebo; catkin build --get-env mavlink_sitl_gazebo | catkin env -si  /usr/bin/cmake /home/viktor/mrs_workspace/src/simulation/ros_packages/mavlink_sitl_gazebo --no-warn-unused-cli -DCATKIN_DEVEL_PREFIX=/home/viktor/mrs_workspace/devel/.private/mavlink_sitl_gazebo -DCMAKE_INSTALL_PREFIX=/home/viktor/mrs_workspace/install; cd -
....................................................................................................................................................................................................................
Failed     << mavlink_sitl_gazebo:cmake          [ Exited with code 1 ]
Failed    <<< mavlink_sitl_gazebo                [ 0.7 seconds ]
[build] Summary: 3 of 4 packages succeeded.
[build]   Ignored:   60 packages were skipped or are blacklisted.
[build]   Warnings:  None.
[build]   Abandoned: None.
[build]   Failed:    1 packages failed.
[build] Runtime: 2.0 seconds total.
ViktorWalter commented 3 years ago

Ok, this seems to be an issue with my system setup.

O2KAN commented 2 years ago

Hi/ how did you solve this error?

ViktorWalter commented 2 years ago

Uninstalling, purging and reinstalling the entire ros-noetic-desktop-full package did the trick.