ROS Resources: Documentation | Support | Discussion Forum | Index | Service Status | ros @ Robotics Stack Exchange
Ask Your Question
1

moveit-visual-tools error when catkin_make

asked 2020-02-06 10:06:27 -0500

zahid990170 gravatar image

Hi,

I am using ros-melodic and MoveIt!. Recently, I am trying to use MoveIt! motion planning API. Following this tutorial, I needed to install the package moveit-visual-tools under my catkin_ws. I followed the steps mentioned:

cd ~/catkin_ws/src
git clone https://github.com/ros-planning/moveit_visual_tools
sudo apt-get install ros-melodic-moveit-visual-tools
rosdep install --from-paths src --ignore-src --rosdistro melodic

to which I receive the following message:

All required rosdeps installed successfully

When, I issue catkin_make, however, I receive this error.

/home/zahid/catkin_ws/src/moveit_visual_tools/src/moveit_visual_tools.cpp:1533:27: error: ‘moveit_msgs::DisplayRobotState {aka struct moveit_msgs::DisplayRobotState_<std::allocator<void> >}’ has no member named ‘hide’
   display_robot_state_msg.hide = true;

Hence, I cannot use this package inside my development workspace. Can someone help me to the correct sources, or files which I need to update in order to build and use this pacakage.

thanks,

Zahid

edit retag flag offensive close merge delete

Comments

did you try installing ros-melodic-moveit-visual-tools instead ? or is there a specific reason you need to build it from source?

marguedas gravatar image marguedas  ( 2020-02-06 17:16:50 -0500 )edit

thanks @marguedas , I removed the cloned folder in catkin_ws, and everything worked ...

zahid990170 gravatar image zahid990170  ( 2020-02-10 09:30:35 -0500 )edit

1 Answer

Sort by » oldest newest most voted
2

answered 2020-02-09 12:35:05 -0500

Abhishekpg gravatar image

remove the package "moveit_visual_tools" cloned under src folder and install moveit visual tools by sudo apt-get install ros-melodic-moveit-visual-tools

edit flag offensive delete link more

Comments

thanks @Abhishekpg, yes it worked ....

zahid990170 gravatar image zahid990170  ( 2020-02-10 09:29:57 -0500 )edit

Question Tools

2 followers

Stats

Asked: 2020-02-06 10:06:27 -0500

Seen: 2,005 times

Last updated: Feb 09 '20