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

Lack of dependency #71

Closed ssr-yuki closed 4 years ago

ssr-yuki commented 4 years ago

Hi, I tried to build this package (melodic-devel branch) on Ubuntu 18.04 & Melodic environment, however, I failed with the following error:

Errors     << moveit_visual_tools:make {CATKIN_WS}/logs/moveit_visual_tools/build.make.010.log                                                                                           
{CATKIN_WS}/devel/.private/moveit_visual_tools/lib/libmoveit_visual_tools.so: undefined reference to `tf::poseEigenToMsg(Eigen::Transform<double, 3, 1, 0> const&, geometry_msgs::Pose_<std::allocator<void> >&)'
{CATKIN_WS}/devel/.private/moveit_visual_tools/lib/libmoveit_visual_tools.so: undefined reference to `tf::poseMsgToEigen(geometry_msgs::Pose_<std::allocator<void> > const&, Eigen::Transform<double, 3, 1, 0>&)'
collect2: error: ld returned 1 exit status
make[2]: *** [{CATKIN_WS}/devel/.private/moveit_visual_tools/lib/moveit_visual_tools/moveit_visual_tools_demo] Error 1
make[1]: *** [CMakeFiles/moveit_visual_tools_demo.dir/all] Error 2
make: *** [all] Error 2

From this ROS answers page, I guess this package should explicitly depend on eigen_conversions and tf_conversions.

Actually, this package includes headers of them. https://github.com/ros-planning/moveit_visual_tools/blob/f6388bbf181ebe1d25a7f32d9d506e7a307d2bef/src/imarker_end_effector.cpp#L46-L47

ssr-yuki commented 4 years ago

This issue is solved by #73 . Thank you for the quick response.