【10天速通Navigation2】(二) :ROS2gazebo阿克曼小车模型搭建-gazebo_ackermann_drive等插件的配置和说明

前言

  • 距离上一期更新nav2的教程已经过了很久了哈哈哈,这期间忙了不少其他的项目,现在有时间开始继续nav2的教程。
  • 重新回顾一下,本教材将贯穿nav2的全部内容,使用ROS2和C++实现一些仿真乃至实车中常见的建图和路径规划算法,例如cartographer,ORB-SLAM,RRT,hybrid-astar。我们将注重与原理讲解和代码实现,去详细讲解每一步的配置过程和代码复现细节。
  • 同理本教材默认大家有一些基础的ROS2和C++的编程基础,故不对一些基础部分进行详细说明。
  • 本教程使用的环境:
    • ROS2 humble
    • ubuntu 22.04 LTS
  • 为了前期的代码验证和算法复现,我们需要配置仿真环境,如第一节所介绍的,本期我们将使用gazebo,完成一个阿克曼模型小车的仿真配置,达到以下的效果请添加图片描述
  • 仿真中的阿克曼小车将配备以下基础部件:
    • 轮式里程计和速度执行器,/odom话题发布,/cmd_vel速度接受
    • 激光雷达,/scan话题发布
    • IMU惯性测量单元,/imu话题发布
    • tf坐标变换:base_link->odom的坐标变换
    • 下一节我们会提到如何配置深度相机发布/image/image_depth
  • 同时我们使用到gazebobuilding editor,去创作一个基本的地图,为后续建图和导航算法进行实现。请添加图片描述

1 gazebo_ackermann_drive插件–轮式里程计和速度执行器

1-1 介绍
  • gazebo_ackermann_drive 是用于Gazebo环境中阿克曼转向(Ackermann steering)四轮小车模型的驱动插件。该插件名为 libgazebo_ros_ackermann_drive.so,适用于类似汽车的机器人。它通过订阅 geometry_msgs/Twist 消息来控制机器人的运动。
1-2 历程和历程问题
  • 我们可以前往官网查看他的配置说明:[# Class GazeboRosAckermannDrive](https://docs.ros.org/en/rolling/p/gazebo_plugins/generated/classgazebo__plugins_1_1GazeboRosAckermannDrive.html)请添加图片描述

  • 很明显官方提供了如何使用这个插件的使用历程

<plugin name="gazebo_ros_ackermann_drive" filename="libgazebo_ros_ackermann_drive.so">

  <ros>
    <namespace>demo</namespace>
    <remapping>cmd_vel:=cmd_demo</remapping>
    <remapping>odom:=odom_demo</remapping>
    <remapping>distance:=distance_demo</remapping>
  </ros>

  <update_rate>100.0</update_rate>

  <!-- wheels -->
  <front_left_joint>front_left_wheel_joint</front_left_joint>
  <front_right_joint>front_right_wheel_joint</front_right_joint>
  <rear_left_joint>rear_left_wheel_joint</rear_left_joint>
  <rear_right_joint>rear_right_wheel_joint</rear_right_joint>
  <left_steering_joint>front_left_steer_joint</left_steering_joint>
  <right_steering_joint>front_right_steer_joint</right_steering_joint>
  <steering_wheel_joint>steering_joint</steering_wheel_joint>

  <!-- Max absolute steer angle for tyre in radians-->
  <!-- Any cmd_vel angular z greater than this would be capped -->
  <max_steer>0.6458</max_steer>

  <!-- Max absolute steering angle of steering wheel -->
  <max_steering_angle>7.85</max_steering_angle>

  <!-- Max absolute linear speed in m/s -->
  <max_speed>20</max_speed>

  <!-- PID tuning -->
  <left_steering_pid_gain>1500 0 1</left_steering_pid_gain>
  <left_steering_i_range>0 0</left_steering_i_range>
  <right_steering_pid_gain>1500 0 1</right_steering_pid_gain>
  <right_steering_i_range>0 0</right_steering_i_range>
  <linear_velocity_pid_gain>1000 0 1</linear_velocity_pid_gain>
  <linear_velocity_i_range>0 0</linear_velocity_i_range>

  <!-- output -->
  <publish_odom>true</publish_odom>
  <publish_odom_tf>true</publish_odom_tf>
  <publish_wheel_tf>true</publish_wheel_tf>
  <publish_distance>true</publish_distance>

  <odometry_frame>odom_demo</odometry_frame>
  <robot_base_frame>chassis</robot_base_frame>

</plugin>
  • 那么问题来了,特别好笑的是,在历程中最重要的地方,官方却没有过多说明,网上的资料又特别稀少,对于这个插件各个轮子需要使用到的joint关节分别对应的什么丝毫没有多说,也就是下面的这七个joint
  <!-- wheels -->
  <front_left_joint>front_left_wheel_joint</front_left_joint>
  <front_right_joint>front_right_wheel_joint</front_right_joint>
  <rear_left_joint>rear_left_wheel_joint</rear_left_joint>
  <rear_right_joint>rear_right_wheel_joint</rear_right_joint>
  <left_steering_joint>front_left_steer_joint</left_steering_joint>
  <right_steering_joint>front_right_steer_joint</right_steering_joint>
  <steering_wheel_joint>steering_joint</steering_wheel_joint>
  • 那么其实搞清楚很简单,我们来看一看在这些joint关节分别对应着什么。

1-3 七个joint
  • 回忆以下阿克曼小车的结构定义,后轮驱动,前轮转向。那我们先来看一下这七个轮子分别代表什么:
    • front_left_joint:左前轮滚动轴
    • front_right_joint:右前轮滚动轴
    • rear_left_joint:左后轮滚动轴
    • rear_right_joint:左后轮滚动轴
    • left_steering_joint:左(前)轮转动轴
    • right_steering_joint:右(前)轮转动轴
    • steering_wheel_joint:方向盘转动轴
  • 相信大家疑惑最多的莫过于left_steering_jointright_steering_jointsteering_wheel_joint了,初次没搞明白确实很奇怪,我们一个个来看。
  • 下面我拿另一个项目的仿真阿克曼小车举例子。
1-3-1 front_left_joint等四个滚动轴
  • 大家都知道在urdf中,一个joint被用来描述两个link之间的关系,以阿克曼小车为例子,四个轮子都需要进行滚动前进,因此我们设置四个joint分别处于每个轮子的圆柱形中心用于绑定车体和四个轮子本身,我们选取continuous作为joint连接的类型,用于描述资格轮子都能独立的相对于车体本身进行滚动请添加图片描述

  • 如下我们进行绑定。

  <joint name="down_right_joint" type="continuous">
    <parent link="base_link"/>
    <child link="down_right_Link"/>
    <origin rpy="0 0 0" xyz="-0.0841 -0.0945 0.03"/>
    <axis xyz="0 -1 0"/>
  </joint>

1-3-2 left_steering_jointright_steering_joint转动轴
  • 要知道,阿克曼前轮转向轮除了能像后轮一样可以进行滚动使车体前进,更为重要的是前轮可以进行一定幅度的转动。因此我们需要额外的两个关节来对车体前轮进行转动描述。![[Pasted image 20241022213638.png]]
  • 但是这里出现了一个特别有趣的地方,在urdf中,一个joint只能控制一个link,不能存在同时有两个joint控制同一个link的情况,而且我希望前轮转向的时候前轮滚动轴前轮转向轴一起转动,但是前轮滚动轴的转动不影响前轮转向轴
  • 那怎么办,答案是设置父子级关系
  • 我们现在有三个轴
    • up_left_Link<!-- 前轮滚动轴 -->
    • front_steer_left_link<!-- 前轮转向轴 -->
    • base_link<!-- 底盘-->
  • 那么为了达成前轮转向的时候前轮滚动轴前轮转向轴一起转动,但是前轮滚动轴的转动不影响前轮转向轴且一个joint只能控制一个link,我们可以这样设置
base_link
front_steer_left_link
up_left_Link
  • 代码实现如下:
<!-- 前轮滚动轴 -->
  <link name="up_left_Link">
    <visual>
      <origin rpy="-1.5707963 0 0" xyz="0 0.0 0"/>
      <geometry>
        <cylinder length="0.025" radius="0.03"/>
      </geometry>
      <material name="">
        <color rgba="0.7450980392156863 0.12941176470588237 0.12941176470588237 1"/>
      </material>
    </visual>

    <collision>
      <origin rpy="-1.5707963 0 0" xyz="0 0.0 0"/>
      <geometry>
        <cylinder length="0.025" radius="0.03"/>
      </geometry>
    </collision>
    <inertial>
      <mass value="0.1"/>
      <inertia ixx="0.001" ixy="0.0" ixz="0.0" iyy="0.001" iyz="0.0" izz="0.001"/>
      <origin xyz="0 0 0"/>
    </inertial>
  </link>


  <joint name="up_left_joint" type="continuous">
    <parent link="front_steer_left_link"/>
    <child link="up_left_Link"/>
    <origin rpy="0 0 0" xyz="0 0 -0.03"/>
    <axis xyz="0 1 0"/>
  </joint>


<!-- 前轮转向轴 (前轮的父关节)-->

   <link name="front_steer_left_link"/>

    <joint name="front_steer_left_joint" type="revolute">
      <parent link="base_link"/>
      <child link="front_steer_left_link"/>
      <origin rpy="0 0 0" xyz="0.0841 0.0945 0.06"/>
      <axis xyz="0 0 1"/>
       <limit
      lower="-0.72"
      upper="0.72"
      effort="0"
      velocity="0" />
    </joint>
  • 如下我们可以完成前轮滚动轴的转动不影响前轮转向轴请添加图片描述

  • 转向的时候前轮滚动轴前轮转向轴一起转动请添加图片描述请添加图片描述

  • 遥遥领先遥遥领先(不是)


1-3-3 steering_wheel_joint方向盘转轴
  • 那么最后一个,也就是最抽象的地方,就是这个steering_wheel_joint方向盘转轴
  • 他描述了什么呢?答案是这个gazebo_ackermann_drive插件提供了一个方向盘joint的实现,也就是我们需要提供一个方向盘转轴,当这个方向盘转轴被旋转的时候,车体的前轮也会被旋转。
  • 值得注意的是在我们本教程乃至其他nav2的学习中,我们控制阿克曼小车进行移动转向的时候靠的是直接向底盘发送/cmd_vel话题进行转向,而不是使用这个方向盘joint
  • 但是有点抽象的是,这个插件他必须要提供这样的一个joint,否则他无法进行仿真!!!!!!(至少我实测下来是这样的)
  • 因此我们只需要进行额外的配置一个关节即可,主要这个关节需要位于两个转向轮之间。
1-4 剩余参数
  • -<ros>:定义与ROS相关的参数。
    • <remapping>cmd_vel:=cmd_vel</remapping>:速度接受器话题。
    • <remapping>odom:=odom</remapping>:里程计发布话题。
    • <remapping>distance:=distance</remapping>:里程计距离发布话题,单位m。
  • <update_rate>100.0</update_rate>: 设置插件更新频率为100Hz。也就是/cmd_vel/odom的订阅和发布频率
  • <max_steer>0.6458</max_steer>:设置轮胎的最大转向角度(弧度),任何超出此值的cmd_vel角速度将被限制。
  • <max_steering_angle>7.85</max_steering_angle>:设置转向盘的最大转向角度(弧度)。
  • <max_speed>20</max_speed>:设置车辆的最大线速度(米/秒)。
  • 然后这一部分是PID调参
  <!-- PID tuning -->
  <left_steering_pid_gain>1500 0 1</left_steering_pid_gain>
  <left_steering_i_range>0 0</left_steering_i_range>
  <right_steering_pid_gain>1500 0 1</right_steering_pid_gain>
  <right_steering_i_range>0 0</right_steering_i_range>
  <linear_velocity_pid_gain>1000 0 1</linear_velocity_pid_gain>
  <linear_velocity_i_range>0 0</linear_velocity_i_range>
  • 后面的是一些基础配置
  <!-- output -->
  <publish_odom>true</publish_odom>
  <publish_odom_tf>true</publish_odom_tf>
  <publish_wheel_tf>false</publish_wheel_tf>
  <publish_distance>true</publish_distance>

  <odometry_frame>odom_demo</odometry_frame>
  <robot_base_frame>chassis</robot_base_frame>
  • 需要注意的是 <publish_wheel_tf>false</publish_wheel_tf>是发布机器人的关节之间的tf关系的,这里我们关闭,后续我们使用libgazebo_ros_joint_state_publisherlibgazebo_ros_joint_pose_trajectory进行发布
  • <robot_base_frame>chassis</robot_base_frame>需要制定机器人的基础坐标系
1-5 完整代码实现
  • 后面我们一起上,这里先等等。

2 gazebo雷达插件

  • 讲完gazebo_ackermann_drive插件后,我们来看看雷达插件的实现,还是拿我另一个项目为例子

  • 如下图,我们把雷达插件概括为一个基础的黑色圆柱体!请添加图片描述

  • 然后我们在这个圆柱体所在的link中添加对应的插件即可,完整代码如下

<!-- 雷达 -->

<link name="laser_link">
  <visual>
    <geometry>
      <cylinder length="0.03" radius="0.025"/>
    </geometry>
    <origin rpy="0 0 0" xyz="0 0 -0.01"/>
    <material name="rgba(255,255,255,1)">
      <color rgba="1 1 1 1"/>
    </material>
  </visual>

  <collision>
    <geometry>
      <cylinder length="0.03" radius="0.025"/>
    </geometry>
    <origin rpy="0 0 0" xyz="0 0 -0.01"/>
  </collision>
  <inertial>
    <mass value="0.1"/>
    <inertia ixx="0.001" ixy="0.0" ixz="0.0" iyy="0.001" iyz="0.0" izz="0.001"/>
    <origin xyz="0 0 -0.01"/>
  </inertial>
</link>

<joint name="laser_joint" type="fixed">
  <parent link="base_link"/>
  <child link="laser_link"/>
  <origin rpy="0 0 0" xyz="0 0 0.2"/>
</joint>

  <gazebo reference="laser_link">
    <material>Gazebo/Black</material>
  </gazebo>

<!-- 雷达仿真 -->
    <gazebo reference="laser_link">
      <sensor name="laser_sensor" type="ray">
      <always_on>true</always_on>
      <visualize>true</visualize>
      <update_rate>10</update_rate>
      <pose>0 0 0.2 0 0 0</pose>
      <ray>
          <scan>
            <horizontal>
              <samples>360</samples>
              <resolution>1.000000</resolution>
              <min_angle>0.000000</min_angle>
              <max_angle>6.280000</max_angle>
            </horizontal>
          </scan>
          <range>
            <min>0.120000</min>
            <max>3.5</max>
            <resolution>0.015000</resolution>
          </range>
          <noise>
            <type>gaussian</type>
            <mean>0.0</mean>
            <stddev>0.01</stddev>
          </noise>
      </ray>

      <plugin name="laserscan" filename="libgazebo_ros_ray_sensor.so">
        <ros>
          
          <remapping>~/out:=scan</remapping>
        </ros>
        <output_type>sensor_msgs/LaserScan</output_type>
        <frame_name>laser_link</frame_name>
      </plugin>
      </sensor>
    </gazebo>
  • <gazebo reference="laser_link">
    • reference="laser_link":指定这个传感器附加到的链接(link)名称,这里是laser_link
  • <sensor name="laser_sensor" type="ray">
    • name="laser_sensor":为传感器定义一个名称
    • type="ray":指定传感器类型为射线(ray),即激光传感器。
  • <always_on>true</always_on>: 表示传感器始终处于开启状态。
  • <visualize>true</visualize>: 表示在Gazebo的图形界面中可视化传感器的输出。
  • <update_rate>10</update_rate>: 定义传感器的更新频率(好东西)
  • <pose>0 0 0.2 0 0 0</pose>:定义传感器相对于其附着链接的位姿(位置和方向)。这里的位姿是(0, 0, 0.2)的平移和(0, 0, 0)的旋转(以弧度为单位)。
  • <horizontal>:- 指定水平方向的扫描参数。
    • <samples>360</samples>:水平方向上的样本数量,这里是360,意味着覆盖360度。
    • <resolution>1.000000</resolution>:每个样本之间的分辨率,这里设置为1度。
    • <min_angle>0.000000</min_angle>:水平扫描的最小角度,这里是0度。
    • <max_angle>6.280000</max_angle>:水平扫描的最大角度,这里是6.28弧度(相当于360度)。
  • <range>:- 定义激光传感器的测量范围。
    • <min>0.120000</min>:可检测的最小距离,这里是0.12米。
    • <max>3.5</max>:可检测的最大距离,这里是3.5米(好东西)
    • <resolution>0.015000</resolution>:测量分辨率,这里是0.015米。
  • <noise>:定义传感器测量中的噪声。
    • <type>gaussian</type>:噪声类型为高斯分布。
    • <mean>0.0</mean>:噪声的均值,这里是0。
    • <stddev>0.01</stddev>:噪声的标准差,这里是0.01。
  1. <plugin name="laserscan" filename="libgazebo_ros_ray_sensor.so">
    • 定义用于发布传感器数据的插件。
    • name="laserscan":插件名称。
    • filename="libgazebo_ros_ray_sensor.so":插件文件名。
  • <ros>:- 定义ROS相关的参数。

    • <remapping>~/out:=scan</remapping>:将插件发布的主题重命名为scan
  • <output_type>sensor_msgs/LaserScan</output_type>: 定义输出消息类型为sensor_msgs/LaserScan,这是ROS中用于激光扫描的标准消息类型。

  • <frame_name>laser_link</frame_name>:- 定义输出激光扫描消息的参考坐标系名称,这里是laser_link

  • 通过上述代码,我们就可以在gazbo中仿真雷达请添加图片描述

  • 如上我们可以通过RVIZ2可视化到雷达的数据


3 IMU 惯性测量单元插件

  • 同理我们也可以配置IMU在gazbo中的插件,同样我们把IMU概括为一个黑色长方体,定使用这个link请添加图片描述


<!-- IMU 惯性导航模块 -->

  <link name="imu_link">
  	<visual>
      <origin xyz="0.08 0 0.0" rpy="0 0 0"/>
      <geometry>
		    <box size="0.02 0.02 0.02"/>
      </geometry>
    </visual>
    <collision>
      <origin xyz="0 0 0.0" rpy="0 0 0"/>
      <geometry>
		    <box size="0.02 0.02 0.02"/>
      </geometry>
    </collision>
    <inertial>
      <mass value="0.1"/>
        <inertia ixx="0.000190416666667" ixy="0" ixz="0" iyy="0.0001904" iyz="0" izz="0.00036"/>
      </inertial>
  </link>

  <!-- imu joint -->
  <joint name="imu_joint" type="fixed">
      <parent link="base_link" />
      <child link="imu_link" />
      <origin xyz="0 0 0.11" />
  </joint>

  <gazebo reference="imu_link">
    <material>Gazebo/Black</material>
  </gazebo>


<gazebo reference="imu_link">
      <sensor name="imu_sensor" type="imu">
      <plugin filename="libgazebo_ros_imu_sensor.so" name="imu_plugin">
          <ros>
            <namespace>/</namespace>
            <remapping>~/out:=imu</remapping>
          </ros>
          <initial_orientation_as_reference>false</initial_orientation_as_reference>
        </plugin>
        <always_on>true</always_on>
        <update_rate>100</update_rate>
        <visualize>true</visualize>
        <imu>
          <angular_velocity>
            <x>
              <noise type="gaussian">
                <mean>0.0</mean>
                <stddev>2e-4</stddev>
                <bias_mean>0.0000075</bias_mean>
                <bias_stddev>0.0000008</bias_stddev>
              </noise>
            </x>
            <y>
              <noise type="gaussian">
                <mean>0.0</mean>
                <stddev>2e-4</stddev>
                <bias_mean>0.0000075</bias_mean>
                <bias_stddev>0.0000008</bias_stddev>
              </noise>
            </y>
            <z>
              <noise type="gaussian">
                <mean>0.0</mean>
                <stddev>2e-4</stddev>
                <bias_mean>0.0000075</bias_mean>
                <bias_stddev>0.0000008</bias_stddev>
              </noise>
            </z>
          </angular_velocity>
          <linear_acceleration>
            <x>
              <noise type="gaussian">
                <mean>0.0</mean>
                <stddev>1.7e-2</stddev>
                <bias_mean>0.1</bias_mean>
                <bias_stddev>0.001</bias_stddev>
              </noise>
            </x>
            <y>
              <noise type="gaussian">
                <mean>0.0</mean>
                <stddev>1.7e-2</stddev>
                <bias_mean>0.1</bias_mean>
                <bias_stddev>0.001</bias_stddev>
              </noise>
            </y>
            <z>
              <noise type="gaussian">
                <mean>0.0</mean>
                <stddev>1.7e-2</stddev>
                <bias_mean>0.1</bias_mean>
                <bias_stddev>0.001</bias_stddev>
              </noise>
            </z>
          </linear_acceleration>
        </imu>
      </sensor>
    </gazebo>
  • 以下是对上述代码中IMU传感器配置的详细说明:
  • <gazebo reference="imu_link">reference="imu_link":指定这个传感器附加到的链接(link)名称,这里是imu_link。
  • <ros><remapping>~/out:=imu</remapping>:将插件输出的默认主题重映射为imu
  • <initial_orientation_as_reference>false</initial_orientation_as_reference>:设置是否将初始方向作为参考方向,这里设置为false
  • <always_on>true</always_on>:设置传感器始终开启。
  • <update_rate>100</update_rate>:设置传感器更新频率为100Hz
  • <visualize>true</visualize>:设置是否在Gazebo中可视化传感器。
  • <imu>
    • <angular_velocity>:定义角速度传感器的噪声模型。
      • <x><y><z>:分别定义x、y、z轴的角速度噪声。
        • <noise type="gaussian">:指定噪声类型为高斯噪声。
          • <mean>0.0</mean>:设置噪声的均值。
          • <stddev>2e-4</stddev>:设置噪声的标准差。
          • <bias_mean>0.0000075</bias_mean>:设置偏置的均值。
          • <bias_stddev>0.0000008</bias_stddev>:设置偏置的标准差。
  • <linear_acceleration>:定义线性加速度传感器的噪声模型。
    • <x><y><z>:分别定义x、y、z轴的线性加速度噪声。
      • <noise type="gaussian">:指定噪声类型为高斯噪声。
        • <mean>0.0</mean>:设置噪声的均值。
        • <stddev>1.7e-2</stddev>:设置噪声的标准差。
        • <bias_mean>0.1</bias_mean>:设置偏置的均值。
        • <bias_stddev>0.001</bias_stddev>:设置偏置的标准差。

4 合并汇总

  • 上述我们已经知道了如何实现几个插件的分别配置,我们下面来看看上下合并在一起的实现。
4-1 xacro介绍
  • Xacro(XML宏)是用于简化URDF(统一机器人描述格式)文件编写的一个工具。在机器人仿真和开发中,URDF是一种常用于描述机器人模型的XML格式文件。由于机器人模型可能非常复杂,直接编写URDF文件可能会非常冗长且难以维护。Xacro通过宏定义和参数化的方式,使得URDF文件的编写变得更加简洁和灵活。
4-2 分离描述和仿真文件
  • 考虑到解耦,我们将阿克曼仿真小车在gazebo的模型描述和仿真描述分离到来两个xacro分别进行实现,并使用xacro同时将二者在最终使用的时候合并起来
    • "qingzhou_base.xacro" :urdf基础模型描述
    • "qingzhou_gazebo_core.xacro" :仿真插件描述
<?xml version="1.0"?>
<robot xmlns:xacro="http://www.ros.org/wiki/xacro"  name="qingzhou">
    <xacro:include filename="qingzhou_base.xacro" />
    <xacro:include filename="qingzhou_gazebo_core.xacro" />
</robot>
4-2-1 "qingzhou_base.xacro" :urdf基础模型描述
  • 代码如下:
<?xml version="1.0"?>
<robot xmlns:xacro="http://www.ros.org/wiki/xacro">


    <xacro:property name="body_mass" value="25.0" />
    <xacro:property name="body_width" value="0.3" />
    <xacro:property name="body_length" value="0.10" />
    <xacro:property name="body_depth" value="0.75" />

    <xacro:property name="wheel_radius" value="0.14" />
    <xacro:property name="wheel_thickness" value="0.14" />
    <xacro:property name="wheel_mass" value="3.0" />
    <xacro:property name="steering_mass" value="0.01" />


    <!-- BASE -->
    <link name="base_footprint">
            <origin xyz="0 0 0" rpy="0 0 0" />
    </link>

    <link name="base_link">
    </link>
    <joint name="base_joint" type="fixed">
        <parent link="base_footprint" />
        <child link="base_link" />
        <origin xyz="0.0 0.0 0.0" rpy="0 0 0" />
    </joint>

    <link name="chassis_link">
        <inertial>
            <origin xyz="0.0374140021041951 -0.000373005187591258 -0.0771282894414029" rpy="0 0 0" />
            <mass value="24.73" />
            <inertia ixx="${body_mass/12 * (body_width*body_width + body_length*body_length)}"
                ixy="0" ixz="0"
                iyy="${body_mass/12 * (body_length*body_length + body_depth*body_depth)}" iyz="0"
                izz="${body_mass/12 * (body_width*body_width + body_depth*body_depth)}" />
        </inertial>
        <visual>
            <origin xyz="0 0 0" rpy="0 0 0" />
            <geometry>
                <box size="0.75 0.3 0.10" />
            </geometry>
        </visual>
        <collision>
            <origin xyz="0.07 0 -0.05" rpy="0 0 0" />
            <geometry>
                <box size="0.75 0.3 0.10" />
            </geometry>
        </collision>
    </link>
    <joint name="chassis_joint" type="fixed">
        <parent link="base_link" />
        <child link="chassis_link" />
        <origin xyz="0.2078 0.0 0.1555" rpy="0 0 0" />
    </joint>


    <!-- FRONT LEFT WHEEL -->
    <link name="fr_left_steer_link">
        <inertial>
            <origin xyz="-0.0002776492198312 0.0163539773588368 4.97346169803237E-09" rpy="0 0 0" />
            <mass value="${steering_mass}" />
            <inertia
                ixx="${steering_mass/12*(3*wheel_radius*wheel_radius + wheel_thickness*wheel_thickness)}"
                ixy="0" ixz="0"
                iyy="${steering_mass/12*(3*wheel_radius*wheel_radius + wheel_thickness*wheel_thickness)}"
                iyz="0" izz="${steering_mass/2 * wheel_radius*wheel_radius}" />
        </inertial>
    </link>
    <joint name="fr_left_steer_joint" type="revolute">
        <origin xyz="0.34058 0.24619 -0.1535" rpy="0 0 0" />
        <parent link="chassis_link" />
        <child link="fr_left_steer_link" />
        <axis xyz="0 0 1" />
        <limit upper="0.6" lower="-0.6" effort="-1.0" velocity="-1.0" />
    </joint>
    <link name="fr_left_wheel_link">
        <inertial>
            <origin xyz="-3.5837499634539E-10 4.97346158701006E-09 -0.016356334080185" rpy="0 0 0" />
            <mass value="${wheel_mass}" />
            <inertia
                ixx="${wheel_mass/12*(3*wheel_radius*wheel_radius + wheel_thickness*wheel_thickness)}"
                ixy="0" ixz="0"
                iyy="${wheel_mass/12*(3*wheel_radius*wheel_radius + wheel_thickness*wheel_thickness)}"
                iyz="0" izz="${wheel_mass/2 * wheel_radius*wheel_radius}" />
        </inertial>
        <visual>
            <origin xyz="0 0 0" rpy="0 0 0" />
            <geometry>
                <cylinder radius="${wheel_radius}" length="${wheel_thickness}" />
            </geometry>
            <material name="">
                <color rgba="0.223529411764706 0.223529411764706 0.223529411764706 1" />
            </material>
        </visual>
        <collision>
            <origin xyz="0 0 0" rpy="0 0 0" />
            <geometry>
                <cylinder radius="${wheel_radius}" length="${wheel_thickness}" />
            </geometry>
        </collision>
    </link>
    <joint name="fr_left_wheel_joint" type="continuous">
        <origin xyz="0 0 0" rpy="1.5708 0 0.016976" />
        <parent link="fr_left_steer_link" />
        <child link="fr_left_wheel_link" />
        <axis xyz="0 0 -1" />
        <dynamics friction="0.8" damping="0.5" />
        <limit lower="-3.14159" upper="3.14159" effort="200" velocity="-1" />


    </joint>


    <!-- FRONT RIGHT WHEEL -->
    <link name="fr_right_steer_link">
        <inertial>
            <origin xyz="0.000274981985673328 -0.0163540222836661 -3.24802407192237E-11" rpy="0 0 0" />
            <mass value="${steering_mass}" />
            <inertia
                ixx="${steering_mass/12*(3*wheel_radius*wheel_radius + wheel_thickness*wheel_thickness)}"
                ixy="0" ixz="0"
                iyy="${steering_mass/12*(3*wheel_radius*wheel_radius + wheel_thickness*wheel_thickness)}"
                iyz="0" izz="${steering_mass/2 * wheel_radius*wheel_radius}" />
        </inertial>
    </link>
    <joint name="fr_right_steer_joint" type="revolute">
        <origin xyz="0.34219 -0.24619 -0.1535" rpy="0 0 0" />
        <parent link="chassis_link" />
        <child link="fr_right_steer_link" />
        <axis xyz="0 0 1" />
        <limit upper="0.6" lower="-0.6" effort="-1.0" velocity="-1.0" />
    </joint>
    <link name="fr_right_wheel_link">
        <inertial>
            <origin xyz="0.00027498198567355 3.24801296969213E-11 -0.0163540222836661" rpy="0 0 0" />
            <mass value="${wheel_mass}" />
            <inertia
                ixx="${wheel_mass/12*(3*wheel_radius*wheel_radius + wheel_thickness*wheel_thickness)}"
                ixy="0" ixz="0"
                iyy="${wheel_mass/12*(3*wheel_radius*wheel_radius + wheel_thickness*wheel_thickness)}"
                iyz="0" izz="${wheel_mass/2 * wheel_radius*wheel_radius}" />
        </inertial>
        <visual>
            <origin xyz="0 0 0" rpy="0 0 0" />
            <geometry>
                <cylinder radius="${wheel_radius}" length="${wheel_thickness}" />
            </geometry>
            <material name="">
                <color rgba="0.223529411764706 0.223529411764706 0.223529411764706 1" />
            </material>
        </visual>
        <collision>
            <origin xyz="0 0 0" rpy="0 0 0" />
            <geometry>
                <cylinder radius="${wheel_radius}" length="${wheel_thickness}" />
            </geometry>
        </collision>
    </link>
    <joint name="fr_right_wheel_joint" type="continuous">
        <origin xyz="0 0 0" rpy="-1.5708 0 0.016976" />
        <parent link="fr_right_steer_link" />
        <child link="fr_right_wheel_link" />
        <axis xyz="0 0 1" />
        <dynamics friction="0.8" damping="0.5" />
        <limit lower="-3.14159" upper="3.14159" effort="200" velocity="-1" />


    </joint>


    <!-- REAR LEFT WHEEL -->
    <link name="re_left_wheel_link">
        <inertial>
            <origin xyz="1.245E-09 1.7252E-06 -0.010284" rpy="0 0 0" />
            <mass value="${wheel_mass}" />
            <inertia
                ixx="${wheel_mass/12*(3*wheel_radius*wheel_radius + wheel_thickness*wheel_thickness)}"
                ixy="0" ixz="0"
                iyy="${wheel_mass/12*(3*wheel_radius*wheel_radius + wheel_thickness*wheel_thickness)}"
                iyz="0" izz="${wheel_mass/2 * wheel_radius*wheel_radius}" />
        </inertial>
        <visual>
            <origin xyz="0 0 0" rpy="0 0 0" />
            <geometry>
                <cylinder radius="${wheel_radius}" length="${wheel_thickness}" />
            </geometry>
            <material name="">
                <color rgba="0.37647 0.37647 0.37647 1" />
            </material>
        </visual>
        <collision>
            <origin xyz="0 0 0" rpy="0 0 0" />
            <geometry>
                <cylinder radius="${wheel_radius}" length="${wheel_thickness}" />
            </geometry>
        </collision>
    </link>
    <joint name="re_left_wheel_joint" type="continuous">
        <origin xyz="-0.2078 0.252 -0.158" rpy="1.5708 0 0" />
        <parent link="chassis_link" />
        <child link="re_left_wheel_link" />
        <axis xyz="0 0 -1" />
        <dynamics friction="0.8" damping="0.5" />
        <limit lower="-3.14159" upper="3.14159" effort="70" velocity="-1" />


    </joint>


    <!-- REAR RIGHT WHEEL -->
    <link name="re_right_wheel_link">
        <inertial>
            <origin xyz="0 0 0" rpy="0 0 0" />
            <mass value="${wheel_mass}" />
            <inertia
                ixx="${wheel_mass/12*(3*wheel_radius*wheel_radius + wheel_thickness*wheel_thickness)}"
                ixy="0" ixz="0"
                iyy="${wheel_mass/12*(3*wheel_radius*wheel_radius + wheel_thickness*wheel_thickness)}"
                iyz="0" izz="${wheel_mass/2 * wheel_radius*wheel_radius}" />
        </inertial>
        <visual>
            <origin xyz="0 0 0" rpy="0 0 0" />
            <geometry>
                <cylinder radius="${wheel_radius}" length="${wheel_thickness}" />
            </geometry>
            <material name="">
                <color rgba="0.37647 0.37647 0.37647 1" />
            </material>
        </visual>
        <collision>
            <origin xyz="0 0 0" rpy="0 0 0" />
            <geometry>
                <cylinder radius="${wheel_radius}" length="${wheel_thickness}" />
            </geometry>
        </collision>
    </link>
    <joint name="re_right_wheel_joint" type="continuous">
        <origin xyz="-0.2078 -0.252 -0.158" rpy="-1.5708 0 0" />
        <parent link="chassis_link" />
        <child link="re_right_wheel_link" />
        <axis xyz="0 0 1" />

        <dynamics friction="0.8" damping="0.5" />
        <limit lower="-3.14159" upper="3.14159" effort="70" velocity="-1" />
    </joint>



<!-- LASER -->
    <link name="laser_link">
    <visual>
        <geometry>
        <cylinder length="0.03" radius="0.075"/>
        </geometry>
        <origin rpy="0 0 0" xyz="0 0 -0.01"/>
        <material name="rgba(255,255,255,1)">
        <color rgba="1 1 1 1"/>
        </material>
    </visual>
    </link>

    <joint name="laser_joint" type="fixed">
        <parent link="chassis_link"/>
        <child link="laser_link"/>
        <origin rpy="0 0 0" xyz="0.25 0 0.075"/>
    </joint>

<!-- IMU -->
    <link name="imu_link">
        <visual>
            <geometry>
        <box size="0.02 0.02 0.02"/>
            </geometry>
            <origin rpy="0 0 0" xyz="0 0 -0.01"/>
            <material name="rgba(255,255,255,1)">
            <color rgba="1 1 1 1"/>
            </material>
        </visual>
    </link>

    <joint name="imu_joint" type="fixed">
        <parent link="chassis_link"/>
        <child link="imu_link"/>
        <origin rpy="0 0 0" xyz="0 0 0.065"/>
    </joint>



</robot>
  • 上述代码描述了这样一个阿克曼小车模型结构请添加图片描述

  • 一辆能跑就行的故车(哈哈哈哈),分别是四个轮子,一个长方体车体,黑色圆柱激光雷达,黑色正方体IMU


4-2-2 "qingzhou_gazebo_core.xacro" :仿真插件描述
  • 代码如下:
<?xml version="1.0"?>
<robot xmlns:xacro="http://www.ros.org/wiki/xacro">
    <!-- GAZEBO COLOUR -->
    <!-- Gazebo is unable to use the same <material> tags that are already in the URDF (that RViz
    uses). -->
    <!-- Instead, we need to add gazebo tags for our links that refer to Gazebo materials -->
    <gazebo reference="chassis_link">
        <material>Gazebo/White</material>
        <mu1>0.5</mu1>
        <mu2>0.5</mu2>
    </gazebo>
    <gazebo reference="fr_left_wheel_link">
        <material>Gazebo/Grey</material>
        <mu1>150.0</mu1>
        <mu2>10.0</mu2>
    </gazebo>
    <gazebo reference="fr_right_wheel_link">
        <material>Gazebo/Grey</material>
        <mu1>150.0</mu1>
        <mu2>10.0</mu2>
    </gazebo>
    <gazebo reference="re_left_wheel_link">
        <material>Gazebo/Grey</material>
        <mu1>150.0</mu1>
        <mu2>10.0</mu2>
    </gazebo>
    <gazebo reference="re_right_wheel_link">
        <material>Gazebo/Grey</material>
        <mu1>150.0</mu1>
        <mu2>10.0</mu2>
    </gazebo>
    <gazebo reference="virtual_steer_link">
        <material>Gazebo/Yellow</material>
    </gazebo>

    <!-- LASER -->
    <gazebo reference="laser_link">
        <material>Gazebo/Black</material>
        <mu1>1.0</mu1>
        <mu2>1.0</mu2>
    </gazebo>

    <gazebo reference="laser_link">
      <sensor name="laser_sensor" type="ray">
      <always_on>true</always_on>
      <visualize>true</visualize>
      <update_rate>50</update_rate>
      <pose>0 0 0.2 0 0 0</pose>
      <ray>
          <scan>
            <horizontal>
              <samples>360</samples>
              <resolution>1.000000</resolution>
              <min_angle>0.000000</min_angle>
              <max_angle>6.280000</max_angle>
            </horizontal>
          </scan>
          <range>
            <min>0.120000</min>
            <max>10.5</max>
            <resolution>0.015000</resolution>
          </range>
          <noise>
            <type>gaussian</type>
            <mean>0.0</mean>
            <stddev>0.01</stddev>
          </noise>
      </ray>

      <plugin name="laserscan" filename="libgazebo_ros_ray_sensor.so">
        <ros>
          
          <remapping>~/out:=scan</remapping>
        </ros>
        <output_type>sensor_msgs/LaserScan</output_type>
        <frame_name>laser_link</frame_name>
      </plugin>
      </sensor>
    </gazebo>



    <gazebo reference="imu_link">
        <material>Gazebo/Black</material>
        <mu1>1.0</mu1>
        <mu2>1.0</mu2>
    </gazebo>

    <gazebo reference="imu_link">
      <sensor name="imu_sensor" type="imu">
      <plugin filename="libgazebo_ros_imu_sensor.so" name="imu_plugin">
          <ros>
            <namespace>/</namespace>
            <remapping>~/out:=imu</remapping>
          </ros>
          <initial_orientation_as_reference>false</initial_orientation_as_reference>
        </plugin>
        <always_on>true</always_on>
        <update_rate>100</update_rate>
        <visualize>true</visualize>
        <imu>
          <angular_velocity>
            <x>
              <noise type="gaussian">
                <mean>0.0</mean>
                <stddev>2e-4</stddev>
                <bias_mean>0.0000075</bias_mean>
                <bias_stddev>0.0000008</bias_stddev>
              </noise>
            </x>
            <y>
              <noise type="gaussian">
                <mean>0.0</mean>
                <stddev>2e-4</stddev>
                <bias_mean>0.0000075</bias_mean>
                <bias_stddev>0.0000008</bias_stddev>
              </noise>
            </y>
            <z>
              <noise type="gaussian">
                <mean>0.0</mean>
                <stddev>2e-4</stddev>
                <bias_mean>0.0000075</bias_mean>
                <bias_stddev>0.0000008</bias_stddev>
              </noise>
            </z>
          </angular_velocity>
          <linear_acceleration>
            <x>
              <noise type="gaussian">
                <mean>0.0</mean>
                <stddev>1.7e-2</stddev>
                <bias_mean>0.1</bias_mean>
                <bias_stddev>0.001</bias_stddev>
              </noise>
            </x>
            <y>
              <noise type="gaussian">
                <mean>0.0</mean>
                <stddev>1.7e-2</stddev>
                <bias_mean>0.1</bias_mean>
                <bias_stddev>0.001</bias_stddev>
              </noise>
            </y>
            <z>
              <noise type="gaussian">
                <mean>0.0</mean>
                <stddev>1.7e-2</stddev>
                <bias_mean>0.1</bias_mean>
                <bias_stddev>0.001</bias_stddev>
              </noise>
            </z>
          </linear_acceleration>
        </imu>
      </sensor>
    </gazebo>



    <!-- JOINT STATE PUBLISHER -->
    <!-- Gazebo requires the use of plugins to interact with other systems such as ROS. -->
    <!-- This plugin will publish the joint_states for the selected joints 
            (which robot_state_publisher can then use to broadcast the approprate tf). 
         Using Gazebo ROS2 control plugin (ros2_control) (part of ROS2 control system) publishing and
    control of joint.-->
    <gazebo>
        <plugin name="gazebo_ros_joint_state_publisher"
            filename="libgazebo_ros_joint_state_publisher.so">
            <update_rate>100</update_rate>
            <joint_name>fr_right_steer_joint</joint_name>
            <joint_name>fr_right_wheel_joint</joint_name>
            <joint_name>fr_left_steer_joint</joint_name>
            <joint_name>fr_left_wheel_joint</joint_name>
            <joint_name>re_right_wheel_joint</joint_name>
            <joint_name>re_left_wheel_joint</joint_name>
            <joint_name>virtual_steering_wheel_joint</joint_name>
        </plugin>
    </gazebo>

    <!-- This plugin will read a JointTrajectory message from the /set_joint_trajectory topic 
            and move the machine accordingly. It's a bit clunky but it works. -->
    <!-- You'll probably want to add damping to the joints to stop them it flopping around. 
            e.g. <dynamics damping="10.0" friction="10.0"/> -->
    <!-- Here's an example message to publish to test it:
            ros2 topic pub -1 /set_joint_trajectory trajectory_msgs/msg/JointTrajectory  '{header: {frame_id:
    world}, joint_names: [slider_joint, arm_joint], points: [  {positions: {0.8,0.6}} ]}' -->
    <gazebo>
        <plugin name="gazebo_ros_joint_pose_trajectory"
            filename="libgazebo_ros_joint_pose_trajectory.so">
            <update_rate>2</update_rate>
        </plugin>
    </gazebo>


    <!-- ACKERMANN DRIVE PLUGIN -->
    <gazebo>
        <plugin name='gazebo_ackermann_drive' filename='libgazebo_ros_ackermann_drive.so'>
            <ros>
                <!-- <namespace>ugv_gazebo_ackermann</namespace> -->
                <remapping>cmd_vel:=cmd_vel</remapping>
                <remapping>odom:=odom</remapping>
                <remapping>distance:=distance</remapping>
            </ros>

            <update_rate>100.0</update_rate>

            <!-- wheels -->
            <front_left_joint>fr_left_wheel_joint</front_left_joint>
            <front_right_joint>fr_right_wheel_joint</front_right_joint>
            <rear_left_joint>re_left_wheel_joint</rear_left_joint>
            <rear_right_joint>re_right_wheel_joint</rear_right_joint>
            <left_steering_joint>fr_left_steer_joint</left_steering_joint>
            <right_steering_joint>fr_right_steer_joint</right_steering_joint>
            <steering_wheel_joint>virtual_steering_wheel_joint</steering_wheel_joint>

            <!-- Max absolute steer angle for tyre in radians-->
            <!-- Any cmd_vel angular z greater than this would be capped -->
            <max_steer>0.383972</max_steer>

            <!-- Max absolute steering angle of steering wheel -->
            <max_steering_angle>1.570796</max_steering_angle>

            <!-- Max absolute linear speed in m/s -->
            <max_speed>5</max_speed>

            <!-- PID tuning -->
            <left_steering_pid_gain>1500 0 1</left_steering_pid_gain>
            <left_steering_i_range>0 0</left_steering_i_range>
            <right_steering_pid_gain>1500 0 1</right_steering_pid_gain>
            <right_steering_i_range>0 0</right_steering_i_range>
            <linear_velocity_pid_gain>1500 0 1</linear_velocity_pid_gain>
            <linear_velocity_i_range>0 0</linear_velocity_i_range>

            <!-- output -->
            <publish_odom>true</publish_odom>
            <publish_odom_tf>true</publish_odom_tf>     <!-- Don't pubslish this when using robot
            localization -->
            <publish_wheel_tf>false</publish_wheel_tf>  <!-- Don't publish this. It will override all
            wheel frames to robot_base_frame parameter below.-->
            <publish_distance>true</publish_distance>

            <odometry_frame>odom</odometry_frame>
            <robot_base_frame>base_footprint</robot_base_frame>

        </plugin>
    </gazebo>

    <!-- Virtual Steering wheel -->
    <link name="virtual_steer_link">
        <visual>
            <origin xyz="0.0 0.0 0.0" rpy="0.0 0.0 0.0" />
            <geometry>
                <box size="0.01 0.15 0.075" />
            </geometry>
            <material name="">
                <color rgba="1.0 1.0 0.0 1" />
            </material>
        </visual>
        <inertial>  <!-- Gazebo won't show this link without this inertial mass -->
            <origin xyz="0.0 0.0 0.0" rpy="0.0 0.0 0.0" />
            <mass value="0.001" />
            <inertia ixx="0.0" ixy="0.0" ixz="0.0" iyy="0.0" iyz="0.0" izz="0.0" />
        </inertial>
    </link>
    <joint name="virtual_steering_wheel_joint" type="revolute">
        <origin xyz="-0.32 0.0 0.0" rpy="0.0 0.0 0.0" />
        <parent link="chassis_link" />
        <child link="virtual_steer_link" />
        <axis xyz="-1 0 0" />
        <limit lower="-3" upper="3" effort="200" velocity="20" />
    </joint>

</robot>
  • 这里我们来额外看看一些内容
4-2-1-1 摩擦系数描述
<gazebo reference="chassis_link">
	<material>Gazebo/White</material>
	<mu1>0.5</mu1>
	<mu2>0.5</mu2>
</gazebo>
  • mu1:静摩擦系数,它描述了一个物体在开始运动之前可以承受的最大摩擦力。静摩擦系数的值通常大于动摩擦系数,这意味着开始移动一个物体比保持其运动需要更多的力。
  • mu2:动摩擦系数,它描述了一个物体在运动过程中受到的摩擦力。动摩擦系数决定了物体在持续运动状态下的摩擦阻力。
4-2-1-2 gazebo_ros_joint_state_publisher 插件
  • 这个插件用于发布选定的关节状态(joint states),这样机器人状态发布者(robot_state_publisher)可以使用这些状态来广播相应的TF变换(tf transformations)。
  • 插件配置说明:
    • <plugin name="gazebo_ros_joint_state_publisher" filename="libgazebo_ros_joint_state_publisher.so">: 这一行定义了插件的名称和共享库文件的路径。
    • <update_rate>100</update_rate>: 这一行设置了关节状态发布的频率,这里是每秒100次。
    • <joint_name>...</joint_name>: 这些行列出了需要发布状态的关节名称。插件将为这些关节发布状态信息。
 <!-- JOINT STATE PUBLISHER -->
    <!-- Gazebo requires the use of plugins to interact with other systems such as ROS. -->
    <!-- This plugin will publish the joint_states for the selected joints 
            (which robot_state_publisher can then use to broadcast the approprate tf). 
         Using Gazebo ROS2 control plugin (ros2_control) (part of ROS2 control system) publishing and
    control of joint.-->
    <gazebo>
        <plugin name="gazebo_ros_joint_state_publisher"
            filename="libgazebo_ros_joint_state_publisher.so">
            <update_rate>100</update_rate>
            <joint_name>fr_right_steer_joint</joint_name>
            <joint_name>fr_right_wheel_joint</joint_name>
            <joint_name>fr_left_steer_joint</joint_name>
            <joint_name>fr_left_wheel_joint</joint_name>
            <joint_name>re_right_wheel_joint</joint_name>
            <joint_name>re_left_wheel_joint</joint_name>
            <joint_name>virtual_steering_wheel_joint</joint_name>
        </plugin>
    </gazebo>

    
4-2-1-3 gazebo_ros_joint_pose_trajectory 插件
  • 这个插件用于读取来自/set_joint_trajectory主题的JointTrajectory消息,并相应地移动机器人的关节。
  • *插件配置说明:
    • <plugin name="gazebo_ros_joint_pose_trajectory" filename="libgazebo_ros_joint_pose_trajectory.so">: 这一行定义了插件的名称和共享库文件的路径。
    • <update_rate>2</update_rate>: 这一行设置了插件的更新频率,这里是每秒2次。
<!-- This plugin will read a JointTrajectory message from the /set_joint_trajectory topic 
            and move the machine accordingly. It's a bit clunky but it works. -->
    <!-- You'll probably want to add damping to the joints to stop them it flopping around. 
            e.g. <dynamics damping="10.0" friction="10.0"/> -->
    <!-- Here's an example message to publish to test it:
            ros2 topic pub -1 /set_joint_trajectory trajectory_msgs/msg/JointTrajectory  '{header: {frame_id:
    world}, joint_names: [slider_joint, arm_joint], points: [  {positions: {0.8,0.6}} ]}' -->
    <gazebo>
        <plugin name="gazebo_ros_joint_pose_trajectory"
            filename="libgazebo_ros_joint_pose_trajectory.so">
            <update_rate>2</update_rate>
        </plugin>
    </gazebo>
  • 通过上面配置的仿真内容,我们就做好小车的所有基本配置

5 launch.py启动文件

  • 完成上述配置文件后,我们就只剩下启动文件拉,代码很简单,核心是启动几个关键节点:
    • Robot State Publisher节点,它将发布机器人的状态信息。这里传入我们的刚刚写好的总xacro文件
    • gazebo_nodeGAZEBO仿真节点
    • gazebo_spawn_entity_node:Gazebo实体生成节点
#!/usr/bin/python3
# -*- coding: utf-8 -*-


import os

from ament_index_python.packages import get_package_share_directory
from launch import LaunchDescription
from launch.actions import DeclareLaunchArgument
from launch.actions import IncludeLaunchDescription
from launch.conditions import IfCondition
from launch.launch_description_sources import PythonLaunchDescriptionSource
from launch.substitutions import LaunchConfiguration
from launch_ros.actions import Node
import xacro


def generate_launch_description():

    use_sim_time_arg = DeclareLaunchArgument(
        "use_sim_time", default_value="true", description="Use simulation clock if true"
    )
    urdf_path = os.path.join(
        get_package_share_directory("qingzhou_gazebo"), "urdf", "qingzhou_sim.xacro"
    )
    gazebo_world_path = os.path.join(
        get_package_share_directory("qingzhou_gazebo"), "worlds", "test01.world"
    )

    robot_state_publisher_node = Node(
        package="robot_state_publisher",
        executable="robot_state_publisher",
        name="robot_state_publisher",
        output="screen",
        parameters=[
            {
                "use_sim_time": LaunchConfiguration("use_sim_time"),
                "robot_description": xacro.process_file(urdf_path).toxml(),
            }
        ],
    )

    # Gazebo launch
    # Enter below if you encounter this error "shared_ptr assertion error"
    # source /usr/share/gazebo/setup.sh
    gazebo_node = IncludeLaunchDescription(
        PythonLaunchDescriptionSource(
            [
                os.path.join(get_package_share_directory("gazebo_ros"), "launch"),
                "/gazebo.launch.py",
            ]
        ),
        launch_arguments={"world": gazebo_world_path}.items(),
    )

    gazebo_spawn_entity_node = Node(
        name="urdf_spawner",
        package="gazebo_ros",
        executable="spawn_entity.py",
        arguments=["-topic", "robot_description", "-entity", "qingzhou"],
        output="screen",
    )

    return LaunchDescription(
        [
            use_sim_time_arg,
            gazebo_node,
            gazebo_spawn_entity_node,
            robot_state_publisher_node,
        ]
    )

  • 上述程序启动后请添加图片描述

  • 小车就生成辣请添加图片描述

  • 我们可以通过键盘控制节点对小车进行遥控 请添加图片描述

  • 键盘控制速度发布节点

sudo apt install ros-humble-teleop-twist-keyboard
ros2 run teleop_twist_keyboard teleop_twist_keyboard

6 Gazebo Building Editor

  • gazebo可以使用Building Editor模型编辑地图,不再需要使用blender进行建图了。

  • 请添加图片描述

  • 我们在Building Editor模式中正上方可以进行模型的俯视图绘制请添加图片描述

  • 绘制完以后我们对地图进行保存,我们首先退出Building Editor

  • 请添加图片描述

  • 这时候会出现弹窗提示我们保存,注意的是这里保存的是模型的sdf文件请添加图片描述

  • 请添加图片描述

  • 完成sdf文件的保存后我们在左上角选择保存world,注意把机器人删掉不要保存进去,我们就得到了world文件(这里点击后八成可能会卡一下,这个主要看你电脑的配置请添加图片描述

  • 如下我的world

<sdf version='1.7'>
  <world name='default'>
    <light name='sun' type='directional'>
      <cast_shadows>1</cast_shadows>
      <pose>0 0 10 0 -0 0</pose>
      <diffuse>0.8 0.8 0.8 1</diffuse>
      <specular>0.2 0.2 0.2 1</specular>
      <attenuation>
        <range>1000</range>
        <constant>0.9</constant>
        <linear>0.01</linear>
        <quadratic>0.001</quadratic>
      </attenuation>
      <direction>-0.5 0.1 -0.9</direction>
      <spot>
        <inner_angle>0</inner_angle>
        <outer_angle>0</outer_angle>
        <falloff>0</falloff>
      </spot>
    </light>
    <model name='ground_plane'>
      <static>1</static>
      <link name='link'>
        <collision name='collision'>
          <geometry>
            <plane>
              <normal>0 0 1</normal>
              <size>100 100</size>
            </plane>
          </geometry>
          <surface>
            <contact>
              <collide_bitmask>65535</collide_bitmask>
              <ode/>
            </contact>
            <friction>
              <ode>
                <mu>100</mu>
                <mu2>50</mu2>
              </ode>
              <torsional>
                <ode/>
              </torsional>
            </friction>
            <bounce/>
          </surface>
          <max_contacts>10</max_contacts>
        </collision>
        <visual name='visual'>
          <cast_shadows>0</cast_shadows>
          <geometry>
            <plane>
              <normal>0 0 1</normal>
              <size>100 100</size>
            </plane>
          </geometry>
          <material>
            <script>
              <uri>file://media/materials/scripts/gazebo.material</uri>
              <name>Gazebo/Grey</name>
            </script>
          </material>
        </visual>
        <self_collide>0</self_collide>
        <enable_wind>0</enable_wind>
        <kinematic>0</kinematic>
      </link>
    </model>
    <gravity>0 0 -9.8</gravity>
    <magnetic_field>6e-06 2.3e-05 -4.2e-05</magnetic_field>
    <atmosphere type='adiabatic'/>
    <physics type='ode'>
      <max_step_size>0.001</max_step_size>
      <real_time_factor>1</real_time_factor>
      <real_time_update_rate>1000</real_time_update_rate>
    </physics>
    <scene>
      <ambient>0.4 0.4 0.4 1</ambient>
      <background>0.7 0.7 0.7 1</background>
      <shadows>1</shadows>
    </scene>
    <audio>
      <device>default</device>
    </audio>
    <wind/>
    <spherical_coordinates>
      <surface_model>EARTH_WGS84</surface_model>
      <latitude_deg>2.98858</latitude_deg>
      <longitude_deg>101.724</longitude_deg>
      <elevation>0</elevation>
      <heading_deg>0</heading_deg>
    </spherical_coordinates>
    <state world_name='default'>
      <sim_time>298 171000000</sim_time>
      <real_time>143 975697644</real_time>
      <wall_time>1729683079 895327834</wall_time>
      <iterations>142713</iterations>
      <model name='ground_plane'>
        <pose>0 0 0 0 -0 0</pose>
        <scale>1 1 1</scale>
        <link name='link'>
          <pose>0 0 0 0 -0 0</pose>
          <velocity>0 0 0 0 -0 0</velocity>
          <acceleration>0 0 0 0 -0 0</acceleration>
          <wrench>0 0 0 0 -0 0</wrench>
        </link>
      </model>
      <model name='test01'>
        <pose>5.99252 5.29147 0 0 -0 0</pose>
        <scale>1 1 1</scale>
        <link name='Wall_10'>
          <pose>5.99252 -3.50853 0 0 -0 0</pose>
          <velocity>0 0 0 0 -0 0</velocity>
          <acceleration>0 0 0 0 -0 0</acceleration>
          <wrench>0 0 0 0 -0 0</wrench>
        </link>
        <link name='Wall_12'>
          <pose>3.11752 2.84147 0 0 -0 0</pose>
          <velocity>0 0 0 0 -0 0</velocity>
          <acceleration>0 0 0 0 -0 0</acceleration>
          <wrench>0 0 0 0 -0 0</wrench>
        </link>
        <link name='Wall_13'>
          <pose>7.79252 5.76647 0 0 -0 1.5708</pose>
          <velocity>0 0 0 0 -0 0</velocity>
          <acceleration>0 0 0 0 -0 0</acceleration>
          <wrench>0 0 0 0 -0 0</wrench>
        </link>
        <link name='Wall_15'>
          <pose>13.5425 5.29147 0 0 -0 1.5708</pose>
          <velocity>0 0 0 0 -0 0</velocity>
          <acceleration>0 0 0 0 -0 0</acceleration>
          <wrench>0 0 0 0 -0 0</wrench>
        </link>
        <link name='Wall_16'>
          <pose>5.99252 14.0915 0 0 -0 3.14159</pose>
          <velocity>0 0 0 0 -0 0</velocity>
          <acceleration>0 0 0 0 -0 0</acceleration>
          <wrench>0 0 0 0 -0 0</wrench>
        </link>
        <link name='Wall_18'>
          <pose>-1.55748 8.54147 0 0 0 -1.5708</pose>
          <velocity>0 0 0 0 -0 0</velocity>
          <acceleration>0 0 0 0 -0 0</acceleration>
          <wrench>0 0 0 0 -0 0</wrench>
        </link>
        <link name='Wall_7'>
          <pose>-1.55748 -0.33353 0 0 0 -1.5708</pose>
          <velocity>0 0 0 0 -0 0</velocity>
          <acceleration>0 0 0 0 -0 0</acceleration>
          <wrench>0 0 0 0 -0 0</wrench>
        </link>
      </model>
      <model name='unit_cylinder'>
        <pose>4.70456 11.7486 0.499998 5e-06 4e-06 -3e-06</pose>
        <scale>1 1 1</scale>
        <link name='link'>
          <pose>4.70456 11.7486 0.499998 5e-06 4e-06 -3e-06</pose>
          <velocity>0 0 0 0 -0 0</velocity>
          <acceleration>0 0 -9.8 0 -0 0</acceleration>
          <wrench>0 0 -9.8 0 -0 0</wrench>
        </link>
      </model>
      <model name='unit_cylinder_0'>
        <pose>5.17588 5.44217 0.499993 -5e-06 -4e-06 -2e-06</pose>
        <scale>1 1 1</scale>
        <link name='link'>
          <pose>5.17588 5.44217 0.499993 -5e-06 -4e-06 -2e-06</pose>
          <velocity>0 0 0 0 -0 0</velocity>
          <acceleration>0 0 -9.8 0 -0 0</acceleration>
          <wrench>0 0 -9.8 0 -0 0</wrench>
        </link>
      </model>
      <model name='unit_cylinder_1'>
        <pose>1.84901 8.01723 0.499998 5e-06 5e-06 0</pose>
        <scale>1 1 1</scale>
        <link name='link'>
          <pose>1.84901 8.01723 0.499998 5e-06 5e-06 0</pose>
          <velocity>0 0 0 0 -0 0</velocity>
          <acceleration>0 0 -9.8 0 -0 0</acceleration>
          <wrench>0 0 -9.8 0 -0 0</wrench>
        </link>
      </model>
      <light name='sun'>
        <pose>0 0 10 0 -0 0</pose>
      </light>
    </state>
    <gui fullscreen='0'>
      <camera name='user_camera'>
        <pose>-1.86745 8.88333 29.031 0 1.22764 0.129005</pose>
        <view_controller>orbit</view_controller>
        <projection_type>perspective</projection_type>
      </camera>
    </gui>
    <model name='test01'>
      <pose>5.99252 5.29147 0 0 -0 0</pose>
      <link name='Wall_10'>
        <collision name='Wall_10_Collision'>
          <geometry>
            <box>
              <size>15.25 0.15 2.5</size>
            </box>
          </geometry>
          <pose>0 0 1.25 0 -0 0</pose>
          <max_contacts>10</max_contacts>
          <surface>
            <contact>
              <ode/>
            </contact>
            <bounce/>
            <friction>
              <torsional>
                <ode/>
              </torsional>
              <ode/>
            </friction>
          </surface>
        </collision>
        <visual name='Wall_10_Visual'>
          <pose>0 0 1.25 0 -0 0</pose>
          <geometry>
            <box>
              <size>15.25 0.15 2.5</size>
            </box>
          </geometry>
          <material>
            <script>
              <uri>file://media/materials/scripts/gazebo.material</uri>
              <name>Gazebo/Grey</name>
            </script>
            <ambient>1 1 1 1</ambient>
          </material>
          <meta>
            <layer>0</layer>
          </meta>
        </visual>
        <pose>0 -8.8 0 0 -0 0</pose>
        <self_collide>0</self_collide>
        <enable_wind>0</enable_wind>
        <kinematic>0</kinematic>
      </link>
      <link name='Wall_12'>
        <collision name='Wall_12_Collision'>
          <geometry>
            <box>
              <size>9.5 0.15 2.5</size>
            </box>
          </geometry>
          <pose>0 0 1.25 0 -0 0</pose>
          <max_contacts>10</max_contacts>
          <surface>
            <contact>
              <ode/>
            </contact>
            <bounce/>
            <friction>
              <torsional>
                <ode/>
              </torsional>
              <ode/>
            </friction>
          </surface>
        </collision>
        <visual name='Wall_12_Visual'>
          <pose>0 0 1.25 0 -0 0</pose>
          <geometry>
            <box>
              <size>9.5 0.15 2.5</size>
            </box>
          </geometry>
          <material>
            <script>
              <uri>file://media/materials/scripts/gazebo.material</uri>
              <name>Gazebo/Grey</name>
            </script>
            <ambient>1 1 1 1</ambient>
          </material>
          <meta>
            <layer>0</layer>
          </meta>
        </visual>
        <pose>-2.875 -2.45 0 0 -0 0</pose>
        <self_collide>0</self_collide>
        <enable_wind>0</enable_wind>
        <kinematic>0</kinematic>
      </link>
      <link name='Wall_13'>
        <collision name='Wall_13_Collision'>
          <geometry>
            <box>
              <size>6 0.15 2.5</size>
            </box>
          </geometry>
          <pose>0 0 1.25 0 -0 0</pose>
          <max_contacts>10</max_contacts>
          <surface>
            <contact>
              <ode/>
            </contact>
            <bounce/>
            <friction>
              <torsional>
                <ode/>
              </torsional>
              <ode/>
            </friction>
          </surface>
        </collision>
        <visual name='Wall_13_Visual'>
          <pose>0 0 1.25 0 -0 0</pose>
          <geometry>
            <box>
              <size>6 0.15 2.5</size>
            </box>
          </geometry>
          <material>
            <script>
              <uri>file://media/materials/scripts/gazebo.material</uri>
              <name>Gazebo/Grey</name>
            </script>
            <ambient>1 1 1 1</ambient>
          </material>
          <meta>
            <layer>0</layer>
          </meta>
        </visual>
        <pose>1.8 0.475 0 0 -0 1.5708</pose>
        <self_collide>0</self_collide>
        <enable_wind>0</enable_wind>
        <kinematic>0</kinematic>
      </link>
      <link name='Wall_15'>
        <collision name='Wall_15_Collision'>
          <geometry>
            <box>
              <size>17.75 0.15 2.5</size>
            </box>
          </geometry>
          <pose>0 0 1.25 0 -0 0</pose>
          <max_contacts>10</max_contacts>
          <surface>
            <contact>
              <ode/>
            </contact>
            <bounce/>
            <friction>
              <torsional>
                <ode/>
              </torsional>
              <ode/>
            </friction>
          </surface>
        </collision>
        <visual name='Wall_15_Visual'>
          <pose>0 0 1.25 0 -0 0</pose>
          <geometry>
            <box>
              <size>17.75 0.15 2.5</size>
            </box>
          </geometry>
          <material>
            <script>
              <uri>file://media/materials/scripts/gazebo.material</uri>
              <name>Gazebo/Grey</name>
            </script>
            <ambient>1 1 1 1</ambient>
          </material>
          <meta>
            <layer>0</layer>
          </meta>
        </visual>
        <pose>7.55 0 0 0 -0 1.5708</pose>
        <self_collide>0</self_collide>
        <enable_wind>0</enable_wind>
        <kinematic>0</kinematic>
      </link>
      <link name='Wall_16'>
        <collision name='Wall_16_Collision'>
          <geometry>
            <box>
              <size>15.25 0.15 2.5</size>
            </box>
          </geometry>
          <pose>0 0 1.25 0 -0 0</pose>
          <max_contacts>10</max_contacts>
          <surface>
            <contact>
              <ode/>
            </contact>
            <bounce/>
            <friction>
              <torsional>
                <ode/>
              </torsional>
              <ode/>
            </friction>
          </surface>
        </collision>
        <visual name='Wall_16_Visual'>
          <pose>0 0 1.25 0 -0 0</pose>
          <geometry>
            <box>
              <size>15.25 0.15 2.5</size>
            </box>
          </geometry>
          <material>
            <script>
              <uri>file://media/materials/scripts/gazebo.material</uri>
              <name>Gazebo/Grey</name>
            </script>
            <ambient>1 1 1 1</ambient>
          </material>
          <meta>
            <layer>0</layer>
          </meta>
        </visual>
        <pose>0 8.8 0 0 -0 3.14159</pose>
        <self_collide>0</self_collide>
        <enable_wind>0</enable_wind>
        <kinematic>0</kinematic>
      </link>
      <link name='Wall_18'>
        <collision name='Wall_18_Collision'>
          <geometry>
            <box>
              <size>11.25 0.15 2.5</size>
            </box>
          </geometry>
          <pose>0 0 1.25 0 -0 0</pose>
          <max_contacts>10</max_contacts>
          <surface>
            <contact>
              <ode/>
            </contact>
            <bounce/>
            <friction>
              <torsional>
                <ode/>
              </torsional>
              <ode/>
            </friction>
          </surface>
        </collision>
        <visual name='Wall_18_Visual'>
          <pose>0 0 1.25 0 -0 0</pose>
          <geometry>
            <box>
              <size>11.25 0.15 2.5</size>
            </box>
          </geometry>
          <material>
            <script>
              <uri>file://media/materials/scripts/gazebo.material</uri>
              <name>Gazebo/Grey</name>
            </script>
            <ambient>1 1 1 1</ambient>
          </material>
          <meta>
            <layer>0</layer>
          </meta>
        </visual>
        <pose>-7.55 3.25 0 0 -0 -1.5708</pose>
        <self_collide>0</self_collide>
        <enable_wind>0</enable_wind>
        <kinematic>0</kinematic>
      </link>
      <link name='Wall_7'>
        <collision name='Wall_7_Collision'>
          <geometry>
            <box>
              <size>6.5 0.15 2.5</size>
            </box>
          </geometry>
          <pose>0 0 1.25 0 -0 0</pose>
          <max_contacts>10</max_contacts>
          <surface>
            <contact>
              <ode/>
            </contact>
            <bounce/>
            <friction>
              <torsional>
                <ode/>
              </torsional>
              <ode/>
            </friction>
          </surface>
        </collision>
        <visual name='Wall_7_Visual'>
          <pose>0 0 1.25 0 -0 0</pose>
          <geometry>
            <box>
              <size>6.5 0.15 2.5</size>
            </box>
          </geometry>
          <material>
            <script>
              <uri>file://media/materials/scripts/gazebo.material</uri>
              <name>Gazebo/Grey</name>
            </script>
            <ambient>1 1 1 1</ambient>
          </material>
          <meta>
            <layer>0</layer>
          </meta>
        </visual>
        <pose>-7.55 -5.625 0 0 -0 -1.5708</pose>
        <self_collide>0</self_collide>
        <enable_wind>0</enable_wind>
        <kinematic>0</kinematic>
      </link>
      <static>1</static>
    </model>
    <model name='unit_cylinder'>
      <pose>4.71767 11.7624 0.5 0 -0 0</pose>
      <link name='link'>
        <inertial>
          <mass>1</mass>
          <inertia>
            <ixx>0.145833</ixx>
            <ixy>0</ixy>
            <ixz>0</ixz>
            <iyy>0.145833</iyy>
            <iyz>0</iyz>
            <izz>0.125</izz>
          </inertia>
          <pose>0 0 0 0 -0 0</pose>
        </inertial>
        <collision name='collision'>
          <geometry>
            <cylinder>
              <radius>0.5</radius>
              <length>1</length>
            </cylinder>
          </geometry>
          <max_contacts>10</max_contacts>
          <surface>
            <contact>
              <ode/>
            </contact>
            <bounce/>
            <friction>
              <torsional>
                <ode/>
              </torsional>
              <ode/>
            </friction>
          </surface>
        </collision>
        <visual name='visual'>
          <geometry>
            <cylinder>
              <radius>0.5</radius>
              <length>1</length>
            </cylinder>
          </geometry>
          <material>
            <script>
              <name>Gazebo/Grey</name>
              <uri>file://media/materials/scripts/gazebo.material</uri>
            </script>
          </material>
        </visual>
        <self_collide>0</self_collide>
        <enable_wind>0</enable_wind>
        <kinematic>0</kinematic>
      </link>
    </model>
    <model name='unit_cylinder_0'>
      <pose>5.18494 5.45104 0.5 0 -0 0</pose>
      <link name='link'>
        <inertial>
          <mass>1</mass>
          <inertia>
            <ixx>0.145833</ixx>
            <ixy>0</ixy>
            <ixz>0</ixz>
            <iyy>0.145833</iyy>
            <iyz>0</iyz>
            <izz>0.125</izz>
          </inertia>
          <pose>0 0 0 0 -0 0</pose>
        </inertial>
        <collision name='collision'>
          <geometry>
            <cylinder>
              <radius>0.5</radius>
              <length>1</length>
            </cylinder>
          </geometry>
          <max_contacts>10</max_contacts>
          <surface>
            <contact>
              <ode/>
            </contact>
            <bounce/>
            <friction>
              <torsional>
                <ode/>
              </torsional>
              <ode/>
            </friction>
          </surface>
        </collision>
        <visual name='visual'>
          <geometry>
            <cylinder>
              <radius>0.5</radius>
              <length>1</length>
            </cylinder>
          </geometry>
          <material>
            <script>
              <name>Gazebo/Grey</name>
              <uri>file://media/materials/scripts/gazebo.material</uri>
            </script>
          </material>
        </visual>
        <self_collide>0</self_collide>
        <enable_wind>0</enable_wind>
        <kinematic>0</kinematic>
      </link>
    </model>
    <model name='unit_cylinder_1'>
      <pose>1.85374 8.02152 0.5 0 -0 0</pose>
      <link name='link'>
        <inertial>
          <mass>1</mass>
          <inertia>
            <ixx>0.145833</ixx>
            <ixy>0</ixy>
            <ixz>0</ixz>
            <iyy>0.145833</iyy>
            <iyz>0</iyz>
            <izz>0.125</izz>
          </inertia>
          <pose>0 0 0 0 -0 0</pose>
        </inertial>
        <collision name='collision'>
          <geometry>
            <cylinder>
              <radius>0.5</radius>
              <length>1</length>
            </cylinder>
          </geometry>
          <max_contacts>10</max_contacts>
          <surface>
            <contact>
              <ode/>
            </contact>
            <bounce/>
            <friction>
              <torsional>
                <ode/>
              </torsional>
              <ode/>
            </friction>
          </surface>
        </collision>
        <visual name='visual'>
          <geometry>
            <cylinder>
              <radius>0.5</radius>
              <length>1</length>
            </cylinder>
          </geometry>
          <material>
            <script>
              <name>Gazebo/Grey</name>
              <uri>file://media/materials/scripts/gazebo.material</uri>
            </script>
          </material>
        </visual>
        <self_collide>0</self_collide>
        <enable_wind>0</enable_wind>
        <kinematic>0</kinematic>
      </link>
    </model>
  </world>
</sdf>

  • 我们在launch.py文件中替换,就可以得到下面的模型和车拉!请添加图片描述

7 小节

  • 本期我们使用gazebo的gazebo_ackermann_drive,激光雷达,IMU插件完成了gazebo阿克曼仿真模型的搭建原理和代码实现,同时使用gazebo的building editor制作了导航的地图

  • 下一节我们将在仿真和实车中完成cartographer建图算法的实现和复现,达到下属这样的效果

  • 仿真建图请添加图片描述

  • 实车建图请添加图片描述

  • 如有错误,欢迎指出!!!!

  • 感谢大家的支持!!!!!!!!!!


部分参考

  • https://github.com/Hisham178/ros2_ackermann
  • https://docs.ros.org/en/rolling/p/gazebo_plugins/generated/classgazebo__plugins_1_1GazeboRosAckermannDrive.html
  • https://fishros.com/d2lros2foxy/#/
### Gazebo阿克曼小车路径规划仿真设置与实现 #### 配置本地代价地图尺寸 为了在 Gazebo 中实现阿克曼小车的路径规划,首先需要配置本地代价地图(local costmap)的宽度高度。这决定了机器人周围环境感知区域的大小,类似于在 Turtlebot Stage Simulator 中看到的情况[^1]。 ```yaml local_costmap: width: 6.0 # 设置本地代价地图的宽度 height: 6.0 # 设置本地代价地图的高度 ``` #### 基础局部规划器参数调整 基础局部规划器(Base Local Planner)对于非全向移动(non-holonomic)的阿克曼车辆至关重要。过修改其配置文件中的度参数来适应特定类型的机器人运动特性。 ```yaml base_local_planner_params: max_vel_x: 0.5 # 最大线度 min_vel_x: -0.2 # 最小线度 max_rotational_vel: 0.8 # 最大角度 acc_lim_theta: 3.2 # 角度加度限制 acc_lim_x: 2.5 # 线性加度限制 ``` #### 创建自定义插件或使用现有工具包 针对阿克曼驱动的小车,在 ROS Gazebo 生态系统中有专门设计的支持库可以帮助简化开发过程。例如 `ackermann_vehicle` 或者其他类似的软件包提供了预构建的功能模块用于快搭建实验平台。 #### 实现路径规划算法集成 最后一步是将选定的全局/局部路径规划算法集成为整个系统的组成部分。可以考虑采用 Dijkstra、A* 或 RRT 等经典方法作为起点,并根据实际需求进一步优化性能表现。
评论 8
添加红包

请填写红包祝福语或标题

红包个数最小为10个

红包金额最低5元

当前余额3.43前往充值 >
需支付:10.00
成就一亿技术人!
领取后你会自动成为博主和红包主的粉丝 规则
hope_wisdom
发出的红包
实付
使用余额支付
点击重新获取
扫码支付
钱包余额 0

抵扣说明:

1.余额是钱包充值的虚拟货币,按照1:1的比例进行支付金额的抵扣。
2.余额无法直接购买下载,可以购买VIP、付费专栏及课程。

余额充值