moveit / moveit2

:robot: MoveIt for ROS 2
https://moveit.ai/
BSD 3-Clause "New" or "Revised" License
1.03k stars 508 forks source link

Getting error with MoveItPy on shutdown -- cannot publish data -- Fail in delete datareader #2693

Open dsandber opened 6 months ago

dsandber commented 6 months ago

Description

A simple program like this:

    rclpy.init()
    panda = MoveItPy(node_name="moveit_py")
    panda.shutdown()
    rclpy.shutdown()

Gives this error on shut-down:

[motion_planning_python_api_tutorial.py-1] cannot publish data, at ./src/rmw_publish.cpp:62 during '__function__'
[motion_planning_python_api_tutorial.py-1] Fail in delete datareader, at ./src/rmw_service.cpp:100 during '__function__'
[ERROR] [motion_planning_python_api_tutorial.py-1]: process has died [pid 987728, exit code -11, cmd '/home/dan/yorc/arm-ros/install/moveit2_tutorials/lib/moveit2_tutorials/motion_planning_python_api_tutorial.py --ros-args -r __node:=moveit_py --params-file /tmp/launch_params_w2kpnvnn']

MoveItPy created node not shutting down properly? I've tried adding sleeps in between the statements to check for a race condition but it didn't help.

Your environment

eProsima Fast DDS (the default for the Ubuntu packages for Iron)

github-actions[bot] commented 4 months ago

This issue is being labeled as stale because it has been open 45 days with no activity. It will be automatically closed after another 45 days without follow-ups.

github-actions[bot] commented 3 months ago

This issue was closed because it has been stalled for 45 days with no activity.

rhaschke commented 3 months ago

This is still an issue and I'm curious for a solution.

github-actions[bot] commented 1 month ago

This issue is being labeled as stale because it has been open 45 days with no activity. It will be automatically closed after another 45 days without follow-ups.