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

MoveIt error while integrating with Python

asked 2022-09-12 13:15:58 -0500

akumar3.1428 gravatar image

updated 2022-09-13 00:43:29 -0500

ravijoshi gravatar image

I am trying to make my package that can use the MoveIt package. I created the code from ros-planning/moveit_tutorials. Below are the steps I followed:

  1. Created a MoveIt package from the panda robot description urdf
  2. Created a ROS package and added a launch file and a python script

However, I am encountering the following error upon running it:

[ WARN] [1663005829.657244307]: Link panda_rightfinger has visual geometry but no collision geometry. Collision geometry will be left empty. Fix your URDF file by explicitly specifying collision geometry.
[ERROR] [1663005829.974605130]: Client [/move_group] wants topic /move_group/goal to have datatype/md5sum [moveit_msgs/MoveGroupActionGoal/b7138704cefd43a8dd9758d697350b85], but our version has [moveit_msgs/MoveGroupActionGoal/152e336e337dce7cbe639f1bd9c65def]. Dropping connection.
Traceback (most recent call last):
  File "move_group_python_interface_tutorial.py", line 538, in <module>
    main()
  File "move_group_python_interface_tutorial.py", line 489, in main
    tutorial = MoveGroupPythonInterfaceTutorial()
  File "move_group_python_interface_tutorial.py", line 130, in __init__
    move_group = moveit_commander.MoveGroupCommander(group_name)
  File "/opt/ros/noetic/lib/python3/dist-packages/moveit_commander/move_group.py", line 66, in __init__
    self._g = _moveit_move_group_interface.MoveGroupInterface(
RuntimeError: Unable to connect to move_group action server 'move_group' within allotted time (5s)

I am having kind of an idea of what it means but don't know how to fix it.

edit retag flag offensive close merge delete

1 Answer

Sort by ยป oldest newest most voted
0

answered 2022-09-13 06:47:20 -0500

ravijoshi gravatar image

updated 2022-09-13 06:47:53 -0500

Please see the following error:

RuntimeError: Unable to connect to move_group action server 'move_group' within allotted time (5s)

This error is coming either because move_group.launch is not invoked or it is crashed somehow. I actually suspect that you are missing many files, such as move_group.launch, *.launch.xml files, etc., required by MoveIt.

I advise going through a simple yet powerful MoveIt Setup Assistant tool. Quoting from the documentation below:

The MoveIt Setup Assistant is a graphical user interface for configuring any robot for use with MoveIt.

edit flag offensive delete link more

Comments

Hello, thank you for your response. I tried to follow the exact tutorial fro the link you provided but was not able to run it. I used the Noetic version.

akumar3.1428 gravatar image akumar3.1428  ( 2022-09-13 10:08:28 -0500 )edit

Previously, I used the MoveIt Setup Assistant tool in ROS Melodic without any issues. It should work well in Noetic as well. Never mind, you can do your task in ROS Melodic using the MoveIt Setup Assistant tool to debug further. By the way, are you sure you are invoking the move_group.launch file? A minimal example of using MoveIt can be found at ravijo/baxter_moveit_tutorial.

ravijoshi gravatar image ravijoshi  ( 2022-09-14 05:16:04 -0500 )edit

Question Tools

1 follower

Stats

Asked: 2022-09-12 13:15:58 -0500

Seen: 286 times

Last updated: Sep 13 '22