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

Problem with catkin_make after installed moveit_tutorials, moveit_visual_tools, rviz_visual_tools and graph_msgs #19

Closed bellonetom closed 6 years ago

bellonetom commented 6 years ago

bellone@bellone-Inspiron-5537:~/ws_moveit$ catkin_make Base path: /home/bellone/ws_moveit Source space: /home/bellone/ws_moveit/src Build space: /home/bellone/ws_moveit/build Devel space: /home/bellone/ws_moveit/devel Install space: /home/bellone/ws_moveit/install

Running command: "make cmake_check_build_system" in "/home/bellone/ws_moveit/build"

Running command: "make -j4 -l4" in "/home/bellone/ws_moveit/build"

[ 0%] [ 0%] Built target geometry_msgs_generate_messages_lisp Built target std_msgs_generate_messages_lisp [ 0%] Built target std_msgs_generate_messages_py [ 0%] Built target geometry_msgs_generate_messages_py [ 0%] Built target _graph_msgs_generate_messages_check_deps_GeometryGraph [ 0%] Built target _graph_msgs_generate_messages_check_deps_Edges [ 0%] Built target geometry_msgs_generate_messages_cpp [ 0%] Built target std_msgs_generate_messages_cpp [ 2%] [ 4%] [ 6%] Automoc for target rviz_visual_tools_remote_control Automoc for target rviz_visual_tools [ 8%] Automoc for target rviz_visual_tools_demo Automoc for target rviz_visual_tools_gui [ 8%] Built target rviz_visual_tools_remote_control_automoc [ 8%] Built target rviz_visual_tools_automoc [ 8%] [ 8%] Built target rviz_visual_tools_demo_automoc Built target rviz_visual_tools_gui_automoc [ 10%] Automoc for target rviz_visual_tools_imarker_simple [ 14%] Built target graph_msgs_generate_messages_lisp [ 20%] Built target graph_msgs_generate_messages_py [ 24%] Built target graph_msgs_generate_messages_cpp [ 24%] Built target rviz_visual_tools_imarker_simple_automoc [ 26%] [ 28%] Built target graph_msgs_generate_messages Built target rviz_visual_tools_remote_control [ 36%] Built target rviz_visual_tools_gui [ 42%] Built target rviz_visual_tools [ 50%] [ 50%] Built target rviz_visual_tools_demo Built target rviz_visual_tools_imarker_simple [ 52%] Building CXX object moveit_visual_tools/CMakeFiles/moveit_visual_tools.dir/src/imarker_robot_state.cpp.o /home/bellone/ws_moveit/src/moveit_visual_tools/src/imarker_robot_state.cpp: In constructor ‘moveit_visual_tools::IMarkerRobotState::IMarkerRobotState(planning_scene_monitor::PlanningSceneMonitorPtr, const string&, std::vector, rviz_visual_tools::colors, const string&)’: /home/bellone/ws_moveit/src/moveit_visual_tools/src/imarker_robot_state.cpp:66:18: error: no match for ‘operator=’ (operand types are ‘moveit::core::RobotStatePtr {aka boost::shared_ptr}’ and ‘std::shared_ptr’) imarkerstate = std::makeshared(psm->getRobotModel()); ^ /home/bellone/ws_moveit/src/moveit_visual_tools/src/imarker_robot_state.cpp:66:18: note: candidates are: In file included from /usr/include/boost/shared_ptr.hpp:17:0, from /opt/ros/indigo/include/moveit/macros/declare_ptr.h:38, from /opt/ros/indigo/include/moveit/macros/class_forward.h:40, from /opt/ros/indigo/include/moveit/robot_model/robot_model.h:41, from /opt/ros/indigo/include/moveit/robot_state/robot_state.h:41, from /opt/ros/indigo/include/moveit/robot_state/conversions.h:40, from /home/bellone/ws_moveit/src/moveit_visual_tools/src/imarker_robot_state.cpp:40: /usr/include/boost/smart_ptr/shared_ptr.hpp:505:18: note: boost::shared_ptr& boost::shared_ptr::operator=(const boost::shared_ptr&) [with T = moveit::core::RobotState] shared_ptr & operator=( shared_ptr const & r ) BOOST_NOEXCEPT ^ /usr/include/boost/smart_ptr/shared_ptr.hpp:505:18: note: no known conversion for argument 1 from ‘std::shared_ptr’ to ‘const boost::shared_ptr&’ /usr/include/boost/smart_ptr/shared_ptr.hpp:514:18: note: template boost::shared_ptr& boost::shared_ptr::operator=(const boost::shared_ptr&) [with Y = Y; T = moveit::core::RobotState] shared_ptr & operator=(shared_ptr const & r) BOOST_NOEXCEPT ^ /usr/include/boost/smart_ptr/shared_ptr.hpp:514:18: note: template argument deduction/substitution failed: /home/bellone/ws_moveit/src/moveit_visual_tools/src/imarker_robot_state.cpp:66:18: note: ‘std::shared_ptr’ is not derived from ‘const boost::shared_ptr’ imarkerstate = std::makeshared(psm->getRobotModel()); ^ In file included from /usr/include/boost/shared_ptr.hpp:17:0, from /opt/ros/indigo/include/moveit/macros/declare_ptr.h:38, from /opt/ros/indigo/include/moveit/macros/class_forward.h:40, from /opt/ros/indigo/include/moveit/robot_model/robot_model.h:41, from /opt/ros/indigo/include/moveit/robot_state/robot_state.h:41, from /opt/ros/indigo/include/moveit/robot_state/conversions.h:40, from /home/bellone/ws_moveit/src/moveit_visual_tools/src/imarker_robot_state.cpp:40: /usr/include/boost/smart_ptr/shared_ptr.hpp:525:18: note: template boost::shared_ptr& boost::shared_ptr::operator=(std::auto_ptr<_Up>&) [with Y = Y; T = moveit::core::RobotState] shared_ptr & operator=( std::auto_ptr & r ) ^ /usr/include/boost/smart_ptr/shared_ptr.hpp:525:18: note: template argument deduction/substitution failed: /home/bellone/ws_moveit/src/moveit_visual_tools/src/imarker_robot_state.cpp:66:18: note: ‘std::shared_ptr’ is not derived from ‘std::auto_ptr’ imarkerstate = std::makeshared(psm->getRobotModel()); ^ In file included from /usr/include/boost/shared_ptr.hpp:17:0, from /opt/ros/indigo/include/moveit/macros/declare_ptr.h:38, from /opt/ros/indigo/include/moveit/macros/class_forward.h:40, from /opt/ros/indigo/include/moveit/robot_model/robot_model.h:41, from /opt/ros/indigo/include/moveit/robot_state/robot_state.h:41, from /opt/ros/indigo/include/moveit/robot_state/conversions.h:40, from /home/bellone/ws_moveit/src/moveit_visual_tools/src/imarker_robot_state.cpp:40: /usr/include/boost/smart_ptr/shared_ptr.hpp:534:18: note: template boost::shared_ptr& boost::shared_ptr::operator=(std::auto_ptr<_Up>&&) [with Y = Y; T = moveit::core::RobotState] shared_ptr & operator=( std::auto_ptr && r ) ^ /usr/include/boost/smart_ptr/shared_ptr.hpp:534:18: note: template argument deduction/substitution failed: /home/bellone/ws_moveit/src/moveit_visual_tools/src/imarker_robot_state.cpp:66:18: note: ‘std::shared_ptr’ is not derived from ‘std::auto_ptr’ imarkerstate = std::makeshared(psm->getRobotModel()); ^ In file included from /usr/include/boost/shared_ptr.hpp:17:0, from /opt/ros/indigo/include/moveit/macros/declare_ptr.h:38, from /opt/ros/indigo/include/moveit/macros/class_forward.h:40, from /opt/ros/indigo/include/moveit/robot_model/robot_model.h:41, from /opt/ros/indigo/include/moveit/robot_state/robot_state.h:41, from /opt/ros/indigo/include/moveit/robot_state/conversions.h:40, from /home/bellone/ws_moveit/src/moveit_visual_tools/src/imarker_robot_state.cpp:40: /usr/include/boost/smart_ptr/shared_ptr.hpp:556:18: note: template<class Y, class D> boost::shared_ptr& boost::shared_ptr::operator=(std::unique_ptr<_Up, _Ep>&&) [with Y = Y; D = D; T = moveit::core::RobotState] shared_ptr & operator=( std::unique_ptr<Y, D> && r ) ^ /usr/include/boost/smart_ptr/shared_ptr.hpp:556:18: note: template argument deduction/substitution failed: /home/bellone/ws_moveit/src/moveit_visual_tools/src/imarker_robot_state.cpp:66:18: note: ‘std::shared_ptr’ is not derived from ‘std::unique_ptr<_Tp, _Dp>’ imarkerstate = std::makeshared(psm->getRobotModel()); ^ In file included from /usr/include/boost/shared_ptr.hpp:17:0, from /opt/ros/indigo/include/moveit/macros/declare_ptr.h:38, from /opt/ros/indigo/include/moveit/macros/class_forward.h:40, from /opt/ros/indigo/include/moveit/robot_model/robot_model.h:41, from /opt/ros/indigo/include/moveit/robot_state/robot_state.h:41, from /opt/ros/indigo/include/moveit/robot_state/conversions.h:40, from /home/bellone/ws_moveit/src/moveit_visual_tools/src/imarker_robot_state.cpp:40: /usr/include/boost/smart_ptr/shared_ptr.hpp:592:18: note: boost::shared_ptr& boost::shared_ptr::operator=(boost::shared_ptr&&) [with T = moveit::core::RobotState] shared_ptr & operator=( shared_ptr && r ) BOOST_NOEXCEPT ^ /usr/include/boost/smart_ptr/shared_ptr.hpp:592:18: note: no known conversion for argument 1 from ‘std::shared_ptr’ to ‘boost::shared_ptr&&’ /usr/include/boost/smart_ptr/shared_ptr.hpp:599:18: note: template boost::shared_ptr& boost::shared_ptr::operator=(boost::shared_ptr&&) [with Y = Y; T = moveit::core::RobotState] shared_ptr & operator=( shared_ptr && r ) BOOST_NOEXCEPT ^ /usr/include/boost/smart_ptr/shared_ptr.hpp:599:18: note: template argument deduction/substitution failed: /home/bellone/ws_moveit/src/moveit_visual_tools/src/imarker_robot_state.cpp:66:18: note: ‘std::shared_ptr’ is not derived from ‘boost::shared_ptr’ imarkerstate = std::makeshared(psm->getRobotModel()); ^ In file included from /usr/include/boost/shared_ptr.hpp:17:0, from /opt/ros/indigo/include/moveit/macros/declare_ptr.h:38, from /opt/ros/indigo/include/moveit/macros/class_forward.h:40, from /opt/ros/indigo/include/moveit/robot_model/robot_model.h:41, from /opt/ros/indigo/include/moveit/robot_state/robot_state.h:41, from /opt/ros/indigo/include/moveit/robot_state/conversions.h:40, from /home/bellone/ws_moveit/src/moveit_visual_tools/src/imarker_robot_state.cpp:40: /usr/include/boost/smart_ptr/shared_ptr.hpp:609:18: note: boost::shared_ptr& boost::shared_ptr::operator=(boost::detail::sp_nullptr_t) [with T = moveit::core::RobotState; boost::detail::sp_nullptr_t = std::nullptr_t] shared_ptr & operator=( boost::detail::sp_nullptr_t ) BOOST_NOEXCEPT // never throws ^ /usr/include/boost/smart_ptr/shared_ptr.hpp:609:18: note: no known conversion for argument 1 from ‘std::shared_ptr’ to ‘boost::detail::sp_nullptr_t {aka std::nullptr_t}’ make[2]: [moveit_visual_tools/CMakeFiles/moveit_visual_tools.dir/src/imarker_robot_state.cpp.o] Erro 1 make[1]: [moveit_visual_tools/CMakeFiles/moveit_visual_tools.dir/all] Erro 2 make: ** [all] Erro 2 Invoking "make -j4 -l4" failed

davetcoleman commented 6 years ago

You are mixing ROS Indigo with Kinetic source code

bellonetom commented 6 years ago

Thanks!

bellonetom commented 6 years ago

Many thanks for your help.

2017-12-27 12:52 GMT-02:00 Dave Coleman notifications@github.com:

You are mixing ROS Indigo with Kinetic source code

— You are receiving this because you authored the thread. Reply to this email directly, view it on GitHub https://github.com/ros-planning/moveit_visual_tools/issues/19#issuecomment-354124772, or mute the thread https://github.com/notifications/unsubscribe-auth/AOe9JxQegRgcBJ07ERlrh6C6OYLqY82Uks5tElm1gaJpZM4RNgrs .

-- Tommaso Bellone Consultor de Engenharia em Sistemas de Despoeiramento Professor de Língua Italiana no Centro de Idiomas da Universidade Federal dos Vales do Jequitinhonha e Mucuri Graduado em Química Industrial Graduand ​​ o em Sistemas de Informação Faculdade de Ciências Exatas e Tecnológicas - FACET Universidade Federal dos Vales do Jequitinhonha e Mucuri - UFVJM Campus JK - Rodovia MGT 367 - Km 583, nº 5000 - Alto da Jacuba CEP:39100-000 Diamantina-MG (38) 999336744 VIVO