小鱼 ROS 2 新书上线!点击链接查看, 新书配套视频点击链接查看。
提问前必看的发帖注意事项—— 提问前必看!不符合要求的问题拒绝回答!!
社区使用指南—如何添加标签修改密码
gazebo无法导入urdf模型,貌似是spawn_entity.py的问题,求解答
-
luo-ub22@Nitro-AN515-57:~$ ros2 launch turtlebot3_gazebo turtlebot3_world.launch.py
[INFO] [launch]: All log files can be found below /home/luo-ub22/.ros/log/2023-12-01-21-59-33-404812-Nitro-AN515-57-26296
[INFO] [launch]: Default logging verbosity is set to INFO
urdf_file_name : turtlebot3_burger.urdf
urdf_file_name : turtlebot3_burger.urdf
[INFO] [gzserver-1]: process started with pid [26297]
[INFO] [gzclient-2]: process started with pid [26299]
[INFO] [robot_state_publisher-3]: process started with pid [26301]
[INFO] [spawn_entity.py-4]: process started with pid [26303]
[robot_state_publisher-3] [INFO] [1701439174.185340046] [robot_state_publisher]: got segment base_footprint
[robot_state_publisher-3] [INFO] [1701439174.185437440] [robot_state_publisher]: got segment base_link
[robot_state_publisher-3] [INFO] [1701439174.185442406] [robot_state_publisher]: got segment base_scan
[robot_state_publisher-3] [INFO] [1701439174.185446789] [robot_state_publisher]: got segment caster_back_link
[robot_state_publisher-3] [INFO] [1701439174.185468371] [robot_state_publisher]: got segment imu_link
[robot_state_publisher-3] [INFO] [1701439174.185471157] [robot_state_publisher]: got segment wheel_left_link
[robot_state_publisher-3] [INFO] [1701439174.185473939] [robot_state_publisher]: got segment wheel_right_link
[spawn_entity.py-4] Traceback (most recent call last):
[spawn_entity.py-4] File "/opt/ros/humble/lib/gazebo_ros/spawn_entity.py", line 30, in <module>
[spawn_entity.py-4] from geometry_msgs.msg import Pose
[spawn_entity.py-4] File "/opt/ros/humble/local/lib/python3.10/dist-packages/geometry_msgs/msg/init.py", line 3, in <module>
[spawn_entity.py-4] from geometry_msgs.msg._accel_with_covariance import AccelWithCovariance # noqa: F401
[spawn_entity.py-4] ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
[spawn_entity.py-4] File "/opt/ros/humble/local/lib/python3.10/dist-packages/geometry_msgs/msg/_accel_with_covariance.py", line 13, in <module>
[spawn_entity.py-4] import numpy # noqa: E402, I100
[spawn_entity.py-4] ^^^^^^^^^^^^
[spawn_entity.py-4] ModuleNotFoundError: No module named 'numpy'
[ERROR] [spawn_entity.py-4]: process has died [pid 26303, exit code 1, cmd '/opt/ros/humble/lib/gazebo_ros/spawn_entity.py -entity burger -file /opt/ros/humble/share/turtlebot3_gazebo/models/turtlebot3_burger/model.sdf -x -2.0 -y -0.5 -z 0.01 --ros-args'].
-
查看以前的贴,不确定是conda问题,也不确定是numpy的问题,之前照着教程案例做出现同类错误,直接使用turtlebot3也是一样,急求解答。
-
-
-
gazebo需要导入的是SDF模型,rviz才是urdf
-
没有设置模型名称吧,如果用turtlebot3的话