moveit-visual-tools error when catkin_make
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
did you try installing
ros-melodic-moveit-visual-tools
instead ? or is there a specific reason you need to build it from source?thanks @marguedas , I removed the cloned folder in
catkin_ws
, and everything worked ...