Closed ClaBirk closed 1 year ago
The last line of your log is showing you the reason why the robot model couldn't be loaded: an invalid parameter. Please review your kinematics.yaml and fix the value type of kinematics_solver_timeout
.
Seems like this is a consequential error. I checked it it is of type float.
@ClaBirk I hope that your problem is resolved. In case you run into further problems, you can also check out the Troubleshooting issue and if that does not help, re-open this issue or a new one
I'm having the similar problem. On my server, Rviz opens well and I can see robots, but the No Planning Library loaded. Especially, I think the problem is the log of this issue I have in common. It is as follows.
[moveit.ros_planning.planning_pipeline]: Exception while loading planner 'chomp_interface/CHOMPPlanner': According to the loaded plugin descriptions the class chomp_interface/CHOMPPlanner with base class type planning_interface::PlannerManager does not exist. Declared types are ompl_interface/OMPLPlanner pilz_industrial_motion_planner/CommandPlanner stomp_moveit/StompPlannerAvailable plugins: ompl_interface/OMPLPlanner, pilz_industrial_motion_planner/CommandPlanner, stomp_moveit/StompPlanner
i'm having similar problem, in my case the robot model is not loaded.
[rviz2-3] [ERROR] [1711174126.096524814] [moveit_ros_visualization.motion_planning_frame]: Action server: /recognize_objects not available [rviz2-3] [INFO] [1711174126.125103229] [moveit_ros_visualization.motion_planning_frame]: MoveGroup namespace changed: / -> . Reloading params. [rviz2-3] [ERROR] [1711174136.286465461] [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-3] Error: Could not parse the SRDF XML File. Error=XML_ERROR_EMPTY_DOCUMENT ErrorID=13 (0xd) Line number=0 [rviz2-3] at line 732 in /home/mustafa/ws_moveit2/src/srdfdom/src/model.cpp [rviz2-3] [ERROR] [1711174136.292062514] [moveit_rdf_loader.rdf_loader]: Unable to parse SRDF [rviz2-3] [ERROR] [1711174136.321760382] [moveit_ros.planning_scene_monitor.planning_scene_monitor]: Robot model not loaded
This is what my terminal gives. Any help would be appreciated.
Thanks
俺也一样
Hello,
i am trying to use Moveit2 on ROS2 Humble for a Project at university. First goal: get a 6DOF Robot running in RVIZ and Moveit2 Installation of ROS2 and Moveit went fine as far as i can tell. But i can´t see the robot in Rviz:
ros2 launch moveit2_tutorials demo.launch.py rviz_tutorial:=true From the moveit_ros_visualization folder, choose “MotionPlanning” as the DisplayType. Press “Ok”.
-> No Robot visible
I tried: https://github.com/ros-planning/moveit2/issues/1596 I changed this: LC_NUMERIC=en_US.UTF-8 but still no Robot visible sudo apt install ros-rolling-rmw-cyclonedds-cpp export RMW_IMPLEMENTATION=rmw_cyclonedds_cpp
This is the Terminal output: