1. 编译工具安装
sudo apt update
sudo apt install python3-catkin-pkg python3-rosdep python3-rosinstall-generator python3-wstool python3-rosinstall build-essential
sudo rosdep init
rosdep update
data:image/s3,"s3://crabby-images/638ec/638ecad944dbc3ae1ef04b4b0e3ae9d75ef86130" alt="在这里插入图片描述"
2. 构建节点
mkdir -p ~/ros2_ws/src
cd ~/ros2_ws
ros2 pkg create turtlebot_suo --build-type ament_python --dependencies rclpy sensor_msgs geometry_msgs
touch turtlebot_suo/turtlebot_suo/ob_avoid.py
chmod +x turtlebot_suo/turtlebot_suo/ob_avoid.py
entry_points={
'console_scripts': [
'ob_avoid = turtlebot_suo.ob_avoid:main',
],
},
cd ~/ros2_ws
colcon build --packages-select turtlebot_suo
source install/setup.bash
data:image/s3,"s3://crabby-images/eecc4/eecc44f681f9e9312d7f85d3477692238e0e3005" alt="在这里插入图片描述"
3. 避障程序
import rclpy
from rclpy.node import Node
from sensor_msgs.msg import LaserScan
from geometry_msgs.msg import Twist
class ObstacleAvoidance(Node):
def __init__(self):
super().__init__('ob_avoid')
self.publisher_ = self.create_publisher(Twist, 'cmd_vel', 10)
self.subscription_ = self.create_subscription(LaserScan,'scan',self.laser_scan_callback,10)
self.subscription_
def laser_scan_callback(self, msg):
front_range = msg.ranges[0:45] + msg.ranges[-45:]
min_distance = min(front_range)
cmd_msg = Twist()
if min_distance < 0.5:
cmd_msg.angular.z = 0.5
self.get_logger().info('# 障碍物距离小于0.5米,左转.')
else:
cmd_msg.linear.x = 0.2
self.publisher_.publish(cmd_msg)
def main(args=None):
rclpy.init(args=args)
node = ObstacleAvoidance()
try:
rclpy.spin(node)
except KeyboardInterrupt:
pass
finally:
node.destroy_node()
rclpy.shutdown()
if __name__ == '__main__':
main()
4. 效果
roslaunch turtlebot3_gazebo turtlebot3_world.launch
ros2 run turtlebot_suo ob_avoid
data:image/s3,"s3://crabby-images/abc6b/abc6bd03b8f27c68f18941c76e4885b680ab7bdb" alt="在这里插入图片描述"
data:image/s3,"s3://crabby-images/e59f4/e59f4f69de07633564980bafdae4c9a3026e4546" alt="在这里插入图片描述"
data:image/s3,"s3://crabby-images/f0e3e/f0e3e31252fb78aed60de0beb2b8746a9b67055f" alt="在这里插入图片描述"