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

Undefined refs in rviz_visual_tools #11

Closed mcevoyandy closed 7 years ago

mcevoyandy commented 7 years ago

Getting linking errors when using the Jade debians and when using rviz/moveit_visual_tools from source on kinetic_devel.

Errors     << learning-moveit:make /home/andy/ros/ws_sandbox/logs/learning-moveit/build.make.029.log                  
/opt/ros/jade/lib/libmoveit_visual_tools.so: undefined reference to `rviz_visual_tools::RvizVisualTools::publishMarkers(visualization_msgs::MarkerArray_<std::allocator<void> >&)'
/opt/ros/jade/lib/libmoveit_visual_tools.so: undefined reference to `rviz_visual_tools::RvizVisualTools::publishCuboid(geometry_msgs::Point_<std::allocator<void> > const&, geometry_msgs::Point_<std::allocator<void> > const&, rviz_visual_tools::colors const&, std::string const&, unsigned long const&)'
/opt/ros/jade/lib/libmoveit_visual_tools.so: undefined reference to `rviz_visual_tools::RvizVisualTools::publishPath(std::vector<Eigen::Matrix<double, 3, 1, 0, 3, 1>, std::allocator<Eigen::Matrix<double, 3, 1, 0, 3, 1> > > const&, rviz_visual_tools::colors const&, double, std::string const&)'
collect2: error: ld returned 1 exit status
make[2]: *** [/home/andy/ros/ws_sandbox/devel/.private/learning-moveit/lib/learning-moveit/move_group_tutorial] Error 1
make[1]: *** [CMakeFiles/move_group_tutorial.dir/all] Error 2
make: *** [all] Error 2
cd /home/andy/ros/ws_sandbox/build/learning-moveit; catkin build --get-env learning-moveit | catkin env -si  /usr/bin/make --jobserver-fds=6,7 -j; cd -
davetcoleman commented 7 years ago

Don't mix the kinetic-devel branches of rviz/moveit_visual_tools with Jade debians... there is a jade branch for that