moveit / moveit2_tutorials

A sphinx-based centralized documentation repo for MoveIt 2
https://moveit.picknik.ai
BSD 3-Clause "New" or "Revised" License
155 stars 195 forks source link

Colcon Build Error #924

Closed OmniLearner closed 3 months ago

OmniLearner commented 3 months ago

Description

Description

Not able to build the Colcon workspace, even if i'm following the tutorial at Getting started tutorial

Overview of your issue here. Your environment

ROS Distro: Humble
OS Version: Ubuntu 22.04
Source build, (I've tried both main and humble)

Steps to reproduce

Follow the tutorial Getting started tutorial Expected behaviour

Build colcon workspace without error. Actual behaviour

Summary: Summary: 16 packages finished [29.7s] 1 package failed: kortex_driver 3 packages aborted: moveit_msgs robotiq_driver rviz_visual_tools 2 packages had stderr output: kortex_driver robotiq_driver 55 packages not processed

[0.280s] WARNING:colcon.colcon_core.package_selection:Some selected packages are already built in one or more underlay workspaces: 'generate_parameter_library' is in: /home/mraju42@tntech.edu/ws_moveit/install/generate_parameter_library, /opt/ros/humble If a package in a merged underlay workspace is overridden and it installs headers, then all packages in the overlay must sort their include directories by workspace order. Failure to do so may result in build failures or undefined behavior at run time. If the overridden package is used by another package in any underlay, then the overriding package in the overlay must be API and ABI compatible or undefined behavior at run time may occur.

If you understand the risks and want to override a package anyways, add the following to the command line: --allow-overriding generate_parameter_library

This may be promoted to an error in a future release of colcon-override-check. Starting >>> generate_parameter_library_py Starting >>> parameter_traits Starting >>> moveit_resources_panda_description Starting >>> moveit_common Finished <<< moveit_common [0.38s]
Starting >>> moveit_msgs Finished <<< moveit_resources_panda_description [0.39s]
Starting >>> moveit_resources_pr2_description Finished <<< moveit_resources_pr2_description [0.23s]
Starting >>> moveit_resources_panda_moveit_config Finished <<< moveit_resources_panda_moveit_config [0.08s]
Starting >>> moveit_configs_utils Finished <<< generate_parameter_library_py [1.03s]
Starting >>> moveit_resources_fanuc_description Finished <<< parameter_traits [1.22s]
Starting >>> generate_parameter_library Finished <<< moveit_resources_fanuc_description [0.23s] Starting >>> moveit_resources_fanuc_moveit_config Finished <<< generate_parameter_library [0.24s]
Starting >>> moveit_resources_prbt_support Finished <<< moveit_resources_prbt_support [0.22s]
Starting >>> robotiq_description Finished <<< moveit_configs_utils [1.01s]
Starting >>> rviz_marker_tools Finished <<< moveit_resources_fanuc_moveit_config [0.65s]
Starting >>> kortex_api Finished <<< robotiq_description [0.24s] Starting >>> kortex_description Finished <<< kortex_api [0.31s]
Starting >>> rviz_visual_tools Finished <<< kortex_description [0.68s]
Starting >>> serial Finished <<< serial [0.83s]
Starting >>> kortex_driver Finished <<< rviz_marker_tools [3.64s]
Starting >>> robotiq_driver --- stderr: kortex_driver
CMake Error at CMakeLists.txt:26 (find_package): By not providing "Findhardware_interface.cmake" in CMAKE_MODULE_PATH this project has asked CMake to find a package configuration file provided by "hardware_interface", but CMake did not find one.

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

hardware_interfaceConfig.cmake
hardware_interface-config.cmake

Add the installation prefix of "hardware_interface" to CMAKE_PREFIX_PATH or set "hardware_interface_DIR" to a directory containing one of the above files. If "hardware_interface" provides a separate development package or SDK, be sure it has been installed.


Failed <<< kortex_driver [2.01s, exited with code 1] Aborted <<< robotiq_driver [0.49s]
Aborted <<< rviz_visual_tools [27.0s]
Aborted <<< moveit_msgs [29.0s]

Summary: 16 packages finished [29.7s] 1 package failed: kortex_driver 3 packages aborted: moveit_msgs robotiq_driver rviz_visual_tools 2 packages had stderr output: kortex_driver robotiq_driver 55 packages not processed

Thanks in advance.

sea-bass commented 3 months ago

Looks to me like you've missed the step to run rosdep install as shown here

sudo apt update && rosdep install -r --from-paths . --ignore-src --rosdistro $ROS_DISTRO -y