You signed in with another tab or window. Reload to refresh your session.You signed out in another tab or window. Reload to refresh your session.You switched accounts on another tab or window. Reload to refresh your session.Dismiss alert
import os
from launch import LaunchDescription
from launch.actions import DeclareLaunchArgument
from launch.substitutions import LaunchConfiguration, PathJoinSubstitution
from launch_ros.actions import Node
from launch_ros.substitutions import FindPackageShare
from ament_index_python.packages import get_package_share_directory
from moveit_configs_utils import MoveItConfigsBuilder
Then I build it , then run it, then errors comes out:
[spawner-6] [INFO] [1706863336.316555922] [spawner_joint_state_broadcaster]: Waiting for '/controller_manager' services to be available
[spawner-8] [INFO] [1706863336.755889541] [spawner_panda_hand_controller]: Waiting for '/controller_manager' services to be available
[spawner-7] [INFO] [1706863336.771893800] [spawner_panda_arm_controller]: Waiting for '/controller_manager' services to be available
[spawner-6] [ERROR] [1706863338.328291305] [spawner_joint_state_broadcaster]: Controller manager not available
[ERROR] [spawner-6]: process has died [pid 3495, exit code 1, cmd '/opt/ros/iron/lib/controller_manager/spawner joint_state_broadcaster --controller-manager /controller_manager --ros-args'].
[spawner-8] [ERROR] [1706863338.767587140] [spawner_panda_hand_controller]: Controller manager not available
[spawner-7] [ERROR] [1706863338.783745145] [spawner_panda_arm_controller]: Controller manager not available
[ERROR] [spawner-8]: process has died [pid 3505, exit code 1, cmd '/opt/ros/iron/lib/controller_manager/spawner panda_hand_controller -c /controller_manager --ros-args'].
[ERROR] [spawner-7]: process has died [pid 3497, exit code 1, cmd '/opt/ros/iron/lib/controller_manager/spawner panda_arm_controller -c /controller_manager --ros-args'].
Expected behaviour
I can do motion planning with rviz to simulate the panda robot
Backtrace or Console output
The text was updated successfully, but these errors were encountered:
Description
Overview of your issue here.
Your environment
Steps to reproduce
succeed running the demo.launch.py with this tutorial :
https://github.com/ros-planning/moveit2_tutorials/blob/main/doc/tutorials/quickstart_in_rviz/quickstart_in_rviz_tutorial.rst
but I wan to try the panda robot , so I install the moveit_resources_panda_moveit_config binary package by:
sudo apt-get install ros-iron-moveit-resources-panda-moveit-config
sudo apt-get install ros-iron-moveit-resources-panda-description
Then I modify the demo.launch.py with:
import os
from launch import LaunchDescription
from launch.actions import DeclareLaunchArgument
from launch.substitutions import LaunchConfiguration, PathJoinSubstitution
from launch_ros.actions import Node
from launch_ros.substitutions import FindPackageShare
from ament_index_python.packages import get_package_share_directory
from moveit_configs_utils import MoveItConfigsBuilder
def generate_launch_description():
Then I build it , then run it, then errors comes out:
[spawner-6] [INFO] [1706863336.316555922] [spawner_joint_state_broadcaster]: Waiting for '/controller_manager' services to be available
[spawner-8] [INFO] [1706863336.755889541] [spawner_panda_hand_controller]: Waiting for '/controller_manager' services to be available
[spawner-7] [INFO] [1706863336.771893800] [spawner_panda_arm_controller]: Waiting for '/controller_manager' services to be available
[spawner-6] [ERROR] [1706863338.328291305] [spawner_joint_state_broadcaster]: Controller manager not available
[ERROR] [spawner-6]: process has died [pid 3495, exit code 1, cmd '/opt/ros/iron/lib/controller_manager/spawner joint_state_broadcaster --controller-manager /controller_manager --ros-args'].
[spawner-8] [ERROR] [1706863338.767587140] [spawner_panda_hand_controller]: Controller manager not available
[spawner-7] [ERROR] [1706863338.783745145] [spawner_panda_arm_controller]: Controller manager not available
[ERROR] [spawner-8]: process has died [pid 3505, exit code 1, cmd '/opt/ros/iron/lib/controller_manager/spawner panda_hand_controller -c /controller_manager --ros-args'].
[ERROR] [spawner-7]: process has died [pid 3497, exit code 1, cmd '/opt/ros/iron/lib/controller_manager/spawner panda_arm_controller -c /controller_manager --ros-args'].
Expected behaviour
I can do motion planning with rviz to simulate the panda robot
Backtrace or Console output
The text was updated successfully, but these errors were encountered: