Problem after create setup with moveit assistant

I took example from what is done by ROS2 Manipulation Basics, on my pc and after I run moveit assistant, and try to open the demo, the model does not connect on RVIZ2
error:

[rviz2-4] [ERROR] [1740047147.188913918] [rviz]: Could not find parameter robot_description_semantic and did not receive robot_description_semantic via std_msgs::msg::String subscription within 10.000000 seconds.
[rviz2-4] Error: Could not parse the SRDF XML File. Error=XML_ERROR_EMPTY_DOCUMENT ErrorID=13 (0xd) Line number=0.
[rviz2-4] at line 732 in ./src/model.cpp.
[rviz2-4] [ERROR] [1740047147.214971531] [moveit_rdf_loader.rdf_loader]: Unable to parse SRDF
[rviz2-4] [ERROR] [1740047147.248856214] [moveit_ros.planning_scene_monitor.planning_scene_monitor]: Robot model not loaded

In performing the steps I don’t see anything doing:
ros2 action list
I should see:
/gripper_controller/gripper_cmd
/joint_trajectory_controller/follow_joint_trajectory

how can i solve, mine is the same robot that is in the course simulation, only in my pc, and trying also on the course simulation it gives me the same problem
please, I’ve been trying for two days and I don’t know what to do anymore

Unfortunately, we do not support local PCs at this time. We recommend gaining considerable mastery before toying with local installations.

Regarding the problem on the platform, could you please point to a specific exercise or example that is not working?

This topic was automatically closed 5 days after the last reply. New replies are no longer allowed.