moveit / moveit2

:robot: MoveIt for ROS 2
https://moveit.ai/
BSD 3-Clause "New" or "Revised" License
1.06k stars 516 forks source link

compile/link error: unreferenced boost dependencies (libmoveit_distance_field.so.2.5.4: undefined reference to `boost::iostreams::zlib::sync_flush') #2294

Closed SirTobias closed 8 months ago

SirTobias commented 1 year ago

Description

Overview of your issue here.

Your environment

Steps to reproduce

mkdir -p ~/ros2_moveit/src cd ~/ros2_moveit/src pip3 install colcon-mixin sudo apt install librange-v3-dev

Checkout MoveIt2 for Humble:

git clone https://github.com/ros-planning/moveit2_tutorials -b humble --depth 1 vcs import < moveit2_tutorials/moveit2_tutorials.repos sudo apt update && rosdep install -r --from-paths . --ignore-src --rosdistro $ROS_DISTRO -y cd ~/ros2_moveit colcon build --mixin release Missing repos for MoveIt2, I do not know, why they are not included in moveit2_tutorials.repos` :

git clone git@github.com:ros-planning/moveit_msgs.git -b ros2 git clone git@github.com:ros-planning/moveit_resources.git -b humble git clone git@github.com:wg-perception/object_recognition_msgs.git -b ros2 git clone git@github.com:OctoMap/octomap_msgs.git -b ros2 git clone git@github.com:PickNikRobotics/generate_parameter_library.git git clone git@github.com:PickNikRobotics/RSL.git git clone git@github.com:PickNikRobotics/cpp_polyfills.git git clone git@github.com:pantor/ruckig.git

colcon build --mixin release

Expected behaviour

MoveIt2 should be compiled

Actual behaviour

Undefined reference to boost::iostreams::zlib::sync_flush apt search libboost-all-dev gives Sorting... Done Full Text Search... Done libboost-all-dev/jammy,now 1.74.0.3ubuntu7 amd64 [installed,automatic] Boost C++ Libraries development files (ALL) (default version)

Backtrace or Console output

Console Output

Thank you very much for your help in advance.

github-actions[bot] commented 1 year ago

This issue is being labeled as stale because it has been open 45 days with no activity. It will be automatically closed after another 45 days without follow-ups.

tmayoff commented 1 year ago

I'm also getting this error, on Debian 12, when compiling moveit from source

tmayoff commented 1 year ago

This seems to be an issue with clang, @SirTobias, not sure if you're still encountering this, but any chance you're using clang to compile it. When I switched to gcc it no longer failed at that point. It now fails elsewhere but still progress

github-actions[bot] commented 10 months ago

This issue is being labeled as stale because it has been open 45 days with no activity. It will be automatically closed after another 45 days without follow-ups.

moriarty commented 8 months ago

Missing repos for MoveIt2, I do not know, why they are not included in moveit2_tutorials.repos` :

This looks like a problem with the instructions.

How we recommend building MoveIt 2 from source for old ros releases from the main branch of MoveIt, but you're building the humble branch on humble... this is confusing but explained here: https://github.com/orgs/ros-planning/discussions/2190

The humble branch is where the humble binary releases are created from. These binary releases from humble do not contain breaking changes or all the latest features which might cause API breaking changes... the main branch has the repos file which you required...

I'm unable to reproduce this so I will close this issue but maybe we should open an issue to update our documentation to be more clear or I will at least discuss at the next MoveIt Maintainers meeting.

Meguenani commented 7 months ago

I am actually still facing the same issue. I followed the same steps described by @SirTobias . Is there any solution ? @SirTobias where You able to build Moveit2 from source ? Thanks