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

Cmake error after moveit_visual_tools installed #15

Closed Instassa closed 6 years ago

Instassa commented 7 years ago

"What am I doing wrong" type of question: I've installed the moveit_visual_tools from source and once I call catkin_make it throws the following error:

Scanning dependencies of target moveit_visual_tools
[ 84%] Building CXX object moveit_visual_tools/CMakeFiles/moveit_visual_tools.dir/src/moveit_visual_tools.cpp.o
/home/marija/ros_ws/src/moveit_visual_tools/src/moveit_visual_tools.cpp: In member function ‘bool moveit_visual_tools::MoveItVisualTools::publishTrajectoryLine(const robot_trajectory::RobotTrajectory&, const moveit::core::LinkModel*, const rviz_visual_tools::colors&)’:
/home/marija/ros_ws/src/moveit_visual_tools/src/moveit_visual_tools.cpp:1205:36: error: ‘MEDIUM’ is not a member of ‘rviz_visual_tools’
     publishSphere(tip_pose, color, rviz_visual_tools::MEDIUM);
                                    ^
/home/marija/ros_ws/src/moveit_visual_tools/src/moveit_visual_tools.cpp:1209:34: error: no matching function for call to ‘moveit_visual_tools::MoveItVisualTools::publishPath(EigenSTL::vector_Vector3d&, const rviz_visual_tools::colors&, const double&)’
   publishPath(path, color, radius);
                                  ^
/home/marija/ros_ws/src/moveit_visual_tools/src/moveit_visual_tools.cpp:1209:34: note: candidates are:
In file included from /home/marija/ros_ws/src/moveit_visual_tools/include/moveit_visual_tools/moveit_visual_tools.h:44:0,
                 from /home/marija/ros_ws/src/moveit_visual_tools/src/moveit_visual_tools.cpp:38:
/opt/ros/indigo/include/rviz_visual_tools/rviz_visual_tools.h:581:8: note: bool rviz_visual_tools::RvizVisualTools::publishPath(const std::vector<geometry_msgs::Point_<std::allocator<void> > >&, const rviz_visual_tools::colors&, const rviz_visual_tools::scales&, const string&)
   bool publishPath(const std::vector<geometry_msgs::Point> &path, const colors &color = RED,
        ^
/opt/ros/indigo/include/rviz_visual_tools/rviz_visual_tools.h:581:8: note:   no known conversion for argument 1 from ‘EigenSTL::vector_Vector3d {aka std::vector<Eigen::Matrix<double, 3, 1>, Eigen::aligned_allocator<Eigen::Matrix<double, 3, 1> > >}’ to ‘const std::vector<geometry_msgs::Point_<std::allocator<void> > >&’
/opt/ros/indigo/include/rviz_visual_tools/rviz_visual_tools.h:584:8: note: bool rviz_visual_tools::RvizVisualTools::publishPath(const std::vector<Eigen::Matrix<double, 3, 1> >&, const rviz_visual_tools::colors&, double, const string&)
   bool publishPath(const std::vector<Eigen::Vector3d> &path, const colors &color = RED,
        ^
/opt/ros/indigo/include/rviz_visual_tools/rviz_visual_tools.h:584:8: note:   no known conversion for argument 1 from ‘EigenSTL::vector_Vector3d {aka std::vector<Eigen::Matrix<double, 3, 1>, Eigen::aligned_allocator<Eigen::Matrix<double, 3, 1> > >}’ to ‘const std::vector<Eigen::Matrix<double, 3, 1> >&’
make[2]: *** [moveit_visual_tools/CMakeFiles/moveit_visual_tools.dir/src/moveit_visual_tools.cpp.o] Error 1
make[1]: *** [moveit_visual_tools/CMakeFiles/moveit_visual_tools.dir/all] Error 2
make: *** [all] Error 2
Invoking "make -j1 -l1" failed

I have indigo version of ros and I might have called rosdep install --from-paths src --ignore-src --rosdistro kinetic in the begining, and the download was made from this link: https://github.com/ros-planning/moveit_visual_tools.

But to fix this I replaced the kinetic version of the downloaded folder with moveit_visual_tools-3.2.1 (I don't know a good place to take non-kinetic version, so that was a guess) and I've re-run rosdep command for indigo, so I hope it would mean I am not using the kinetic branch.

I would be very grateful for any ideas on where I've made an error.

davetcoleman commented 6 years ago

you have mismatched versions of moveit_visual_tools and rviz_visual_tools