moveit / moveit_visual_tools

Helper functions for displaying and debugging MoveIt! data in Rviz via published markers
BSD 3-Clause "New" or "Revised" License
151 stars 102 forks source link

latest release of moveit_visual_tools incorrect versions? #81

Closed PeterMitrano closed 1 year ago

PeterMitrano commented 3 years ago

The latest version on ros-testing is linked to old versions of libraries (rviz, moveit, tf2_ros, etc)

ldd /opt/ros/noetic/lib/libmoveit_visual_tools.so
    linux-vdso.so.1 (0x00007ffc54dcc000)
    librviz_visual_tools.so.3.9.1 => not found
    librviz_visual_tools_gui.so.3.9.1 => not found
    libinteractive_markers.so => not found
    libmoveit_planning_scene_monitor.so.1.1.0 => not found
    libmoveit_robot_model.so.1.1.0 => not found
    libmoveit_transforms.so.1.1.0 => not found
    libmoveit_robot_state.so.1.1.0 => not found
    libmoveit_robot_trajectory.so.1.1.0 => not found
    libmoveit_collision_detection.so.1.1.0 => not found
    libmoveit_planning_scene.so.1.1.0 => not found
    libgeometric_shapes.so.0.7.2 => not found
    libtf2_ros.so => not found
    libroscpp.so => not found
    libpthread.so.0 => /lib/x86_64-linux-gnu/libpthread.so.0 (0x00007f6fc5688000)
    libboost_filesystem.so.1.71.0 => /lib/x86_64-linux-gnu/libboost_filesystem.so.1.71.0 (0x00007f6fc566a000)
    librosconsole.so => not found
    libroscpp_serialization.so => not found
    librostime.so => not found
    libstdc++.so.6 => /lib/x86_64-linux-gnu/libstdc++.so.6 (0x00007f6fc5487000)
    libm.so.6 => /lib/x86_64-linux-gnu/libm.so.6 (0x00007f6fc5338000)
    libgcc_s.so.1 => /lib/x86_64-linux-gnu/libgcc_s.so.1 (0x00007f6fc531d000)
    libc.so.6 => /lib/x86_64-linux-gnu/libc.so.6 (0x00007f6fc512b000)
    /lib64/ld-linux-x86-64.so.2 (0x00007f6fc576c000)

Here's what's on apt

apt-cache policy ros-noetic-moveit-visual-tools
ros-noetic-moveit-visual-tools:
  Installed: 3.6.0-1focal.20201123.182117
  Candidate: 3.6.0-1focal.20201123.182117
  Version table:
 *** 3.6.0-1focal.20201123.182117 500
        500 http://packages.ros.org/ros/ubuntu focal/main amd64 Packages
        500 http://packages.ros.org/ros-testing/ubuntu focal/main amd64 Packages
        100 /var/lib/dpkg/status

The previous build worked fine. Apt says the upgrade that broke things was from 3.6.0-1focal.20201117.015803 to 3.6.0-1focal.20201123.182117

ros-noetic-moveit-visual-tools:amd64 (3.6.0-1focal.20201117.015803, 3.6.0-1focal.20201123.182117)