【路径规划】原理及实现

路径规划(Path Planning)是指在给定地图、起始点和目标点的情况下,确定应该采取的最佳路径。常见的路径规划算法包括A* 算法、Dijkstra 算法、RRT(Rapidly-exploring Random Tree)等。

目录

一.A*

1.算法原理

2.实例

二.Dijkstra

1.算法原理

2.实例

三.RRT

1.算法原理

2.实例

一.A*

A*算法找到的1条由图中节点以及边组成的路径。一般而言,A*算法基于BFS(Breath First Search,广度优先遍历),同时也可以认为是对BFS搜索算法的优化。

1.算法原理

具体执行过程如下:

(1) 搜索区域

以2维平面坐标下的简单搜索为例。

绿色方框代表起点和终点,红色方框代表不可经过的点。

(2) 搜索起点

A*算法从起点开始向四周检索相邻方格并进行扩展,直到扩展扫描到终点,算法结束。

流程如下:

① 从起点S开始,把S作为一个等待检查的方格,将其放入open_list中。

open_list:待走的位置。相当于候选点集合,每到1点,将周围点放入候选集合中,往后有可能往候选点去走。

闭集合:已经走过的位置,不会再被考虑。

② 寻找起点S周围可以到达的方格(最多8个),并将它们加入open_list,同时设置他们的父方格为S;

③ 从open_list中删除起点S,同时将S加入close_list;

④ 计算每个周围方格的F值(F=G+H);

G:从起点S按照生成的路径移动到指定方格的移动代价。有2种距离计算方式:欧拉距离、曼哈顿距离。

H:从指定方格移动到终点的估算成本。使用Manhattan方法,忽略路径中的障碍物,计算当前方格横向或纵向移动到达目标所经过的方格数。

⑤ 从open_list中选取F值最小的方格a,并将其从open_list中删除,放入close_list中;

⑥ 继续检查a的邻接方格:

a). 忽略不可经过的方格以及被标记在close_list中的方格,将剩余的方格加入open_list,并计算这些方格的F值,同时设置父方格为a;

b). 如果某邻接的方格c已经在open_list中,则需计算新的路径从S到c的值G,判断是否需要更新:

如果新的G值更小一些,则修改父方格为方格a,重新计算F值。注意:H值不需要改变,因为方格到达终点的预计消耗是固定的,不需要重复计算。

如果新的G值更大一些,那么说明新路径不是一条更优的路径,则不需要更新值。

⑦ 继续从open_list中找出F值最小的,跳跃至第⑤步继续循环执行。

⑧ 当open_list出现终点E时,代表路径已经被找到,搜索成功。

如果open_list为空,那么说明没有找到合适的路径,搜索失败。

2.实例

'''A*'''
import time
import numpy as np
from matplotlib.patches import Rectangle
import matplotlib.pyplot as plt
import heapq# 地图上的每1个点都是1个Point对象,用于记录该点的类别、代价等信息
class Point:def __init__(self, x=0, y=0):self.x = xself.y = y# 0代表可通行,1代表障碍物self.val = 0 self.cost_g = 0  self.cost_h = 0self.cost_f = 0self.parent = None# 0:不在开集合  1:在开集合  -1:在闭集合self.is_open = 0# 用于heapq小顶堆的比较def __lt__(self, other):return self.cost_f < other.cost_fclass Map:def __init__(self, map_size):self.map_size = map_sizeself.width = map_size[0]self.height = map_size[1]self.map = [[Point(x, y) for y in range(self.map_size[1])] for x in range(self.map_size[0])]# 手动设置障碍物,可多次调用设置地图def set_obstacle(self, topleft, width, height):for x in range(topleft[0], topleft[0] + width):for y in range(topleft[1], topleft[1] + height):self.map[x][y].val = 1class AStar:def __init__(self, map, start_point, end_point, connect_num=4):self.map: Map = mapself.start_point = start_pointself.end_point = end_point# 开集合,先放入起点,从起点开始遍历self.open_set = [self.start_point]self.start_point.is_open = 1 # 连通数,目前支持4连通或8连通 self.connect_num = connect_numself.diffuse_dir = [(1, 0), (-1, 0), (0, 1), (0, -1)]def g_cost(self, p):'''计算 g 代价:当前点与父节点的距离 + 父节点的 g 代价(欧氏距离)'''x_dis = abs(p.parent.x - p.x)y_dis = abs(p.parent.y - p.y)return np.sqrt(x_dis ** 2 + y_dis ** 2) + p.parent.cost_gdef h_cost(self, p):'''计算 h 代价:当前点与终点之间的距离(欧氏距离)'''x_dis = abs(self.end_point.x - p.x)y_dis = abs(self.end_point.y - p.y)return np.sqrt(x_dis ** 2 + y_dis ** 2)def is_valid_point(self, x, y):# 无效点:超出地图边界或为障碍物if x < 0 or x >= self.map.width:return Falseif y < 0 or y >= self.map.height:return Falsereturn self.map.map[x][y].val == 0def search(self):self.start_time = time.time()p = self.start_pointwhile not (p == self.end_point):# 弹出代价最小的开集合点,若开集合为空,说明没有路径try:p = heapq.heappop(self.open_set)except:raise 'No path found, algorithm failed!!!'p.is_open = -1# 遍历周围点for i in range(self.connect_num):dir_x, dir_y = self.diffuse_dir[i]self.diffusion_point(p.x + dir_x, p.y + dir_y, p)return self.build_path(p)  # p = self.end_pointdef diffusion_point(self, x, y, parent):# 无效点或者在闭集合中,跳过if not self.is_valid_point(x, y) or self.map.map[x][y].is_open == -1:returnp = self.map.map[x][y]pre_parent = p.parentp.parent = parent# 先计算出当前点的总代价cost_g = self.g_cost(p)cost_h = self.h_cost(p)cost_f = cost_g + cost_h# 如果在开集合中,判断当前点和开集合中哪个点代价小,换成小的,相同x,y的点h值相同,g值可能不同if p.is_open == 1:if cost_f < p.cost_f:# 如果从当前parent遍历过来的代价更小,替换成当前的代价和父节点p.cost_g, p.cost_h, p.cost_f = cost_g, cost_h, cost_felse:# 如果从之前父节点遍历过来的代价更小,保持之前的代价和父节点p.parent = pre_parentelse:# 如果不在开集合中,说明之间没遍历过,直接加到开集合里就好p.cost_g, p.cost_h, p.cost_f = cost_g, cost_h, cost_fheapq.heappush(self.open_set, p)p.is_open = 1def build_path(self, p):print('search time: ', time.time() - self.start_time, ' seconds')# 回溯完整路径path = []while p != self.start_point:path.append(p)p = p.parentprint('search time: ', time.time() - self.start_time, ' seconds')# 打印开集合、闭集合的数量print('open set count: ', len(self.open_set))close_count = 0for x in range(self.map.width):for y in range(self.map.height):close_count += 1 if self.map.map[x][y].is_open == -1 else 0print('close set count: ', close_count)print('total count: ', close_count + len(self.open_set))# path = path[::-1]  # path为终点到起点的顺序,可使用该语句翻转return pathif __name__ == '__main__':map = Map((6, 6))# 用于显示plt图ax = plt.gca()ax.xaxis.set_ticks_position('top')ax.set_xlim([0, map.width])ax.set_ylim([0, map.height])plt.tight_layout()plt.grid(True, linestyle="--", color="black", linewidth="1", axis='both')ax.xaxis.set_ticks_position('top')ax.invert_yaxis()# 设置障碍物map.set_obstacle([2, 2], 3, 1)map.set_obstacle([2, 3], 1, 2)# 设置起始点和终点,并创建astar对象start_point = map.map[1][1]end_point = map.map[4][4]# 将障碍物及起点、终点显示到plt上ax.add_patch(Rectangle([2, 2], width=3, height=1, color='red'))ax.add_patch(Rectangle([2, 3], width=1, height=2, color='red'))ax.add_patch(Rectangle([1, 1], width=1, height=1, color='green'))ax.add_patch(Rectangle([4, 4], width=1, height=1, color='green'))astar = AStar(map, start_point, end_point)path = astar.search()# 可视化起点到终点完整路径for p in path:if p!=end_point:ax.add_patch(Rectangle([p.x, p.y], width=1, height=1, color='blue'))plt.savefig('res.jpg') plt.show()

二.Dijkstra

Dijkstra是1种适用于非负权值网络的单源最短路径算法,可以给出从指定节点到图中其他节点的最短路径,以及任意2点的最短路径。

1.算法原理

下面用1个示例讲述算法的原理过程,如图所示,1个有向权值图,利用Dijkstra算法找到从节点1到节点6的最短路径。

(1) 首先进行初始化,初始化1个空的open list,close list 以及parent。将起点及其距离信息放入到open list 中,将起点及其父亲节点放入parent中,起点的父节点为None。

open list :存放已经访问的从该节点到起点有路径的结点(有路径但不一定是最优路径)
close list :存放那些已经找到最优路径的结点。
parent :存放结点的父子关系,方便后面路径回溯。

(2) 按步骤执行:

(3) 按步骤执行:

(4) 按步骤执行:

(5) 按步骤执行:

(6) 按步骤执行:

(7) 按步骤执行:

(8) 路径回溯

根据parent中的继承关系,从终点向起点回溯,得到从起点到终点的最短路径为:1=>4=>7=>6,最短路径长为:6。

2.实例

import heapqdef dijkstra(graph,start):distances = {vertex: float('infinity') for vertex in graph}distances[start] = 0# 初始化父亲节点parent = {vertex: None for vertex in graph}priority_queue = [(0,start)]while priority_queue:# 弹出堆中距离最小的节点current_distance, current_vertex = heapq.heappop(priority_queue)# 如果当前距离已经大于已知的最短距离,则跳过if current_distance > distances[current_vertex]:continue# 更新相邻节点的距离for neighbor, weight in graph[current_vertex].items():distance = current_distance + weight# 如果找到更短的路径,则更新距离,并将节点加入优先队列if distance < distances[neighbor]:distances[neighbor] = distanceparent[neighbor] = current_vertexheapq.heappush(priority_queue, (distance, neighbor))# print("加入后的队列:",priority_queue)return distances, parent# 输出路径回溯
def get_path(parent,end):path = []current = endwhile current is not None:path.append(current)current = parent[current]path.reverse()return pathgraph = {'1': {'2': 2, '4': 1},'2': {'4': 3, '5': 11 },'3': {'1': 4, '6': 5},'4': {'5': 2, '6': 8, '7': 4},'5': {'7': 6},'6':{},'7': {'6': 1},
}
start_node='1'
end_node = '6'
distances, parent = dijkstra(graph, start_node)
path = get_path(parent, end_node)
print(f"从节点 {start_node} 到节点 {end_node} 的路径:", path)

三.RRT

1.算法原理

快速随机树算法(Rapid Random Tree,RRT)以初始的1个根节点,通过随机采样的方法在空间搜索,然后添加叶节点来不断扩展随机树。当目标点进入随机树里面后,随机树扩展立即停止,此时能找到1条从起始点到目标点的路径。

算法的计算过程如下:

(1) 初始化随机树。设置起点x_{init},目标点x_{goal}和搜索空间M;将起点作为随机树搜索的起点,此时树中只包含1个节点即根节点; 

(2)在M中随机采样。在M中随机采样1个点x_{rand},若x_{rand}不在障碍物范围内,则计算随机树中所有节点到x_{rand}的欧式距离,并找到距离最近的节点x_{near};若x_{rand}在障碍物范围内则重新采样;

(3)生成新节点。在x_{near}x_{rand}连线方向,由固定步长距离生成1个新的节点x_{new},并判断x_{new}是否在障碍物范围内,若不在障碍物范围内则将x_{new}添加到随机树中,并将x_{new}的父节点设置为x_{near};否则的话返回(2)重新对环境进行随机采样;

(4)停止搜索。重复步骤(2)、(3),当x_{new}x_{goal}之间的距离小于设定的阈值时,则代表随机树已经到达了目标点,将作为最后1个路径节点加入到随机树中,算法结束并得到所规划的路径 。

2.实例

import math
import random
import matplotlib.pyplot as plt
import numpy as np
from celluloid import Cameraclass RRT:class Node:def __init__(self, x, y):self.x = xself.y = yself.path_x = []self.path_y = []self.parent = Noneclass AreaBounds:def __init__(self, area):self.xmin = float(area[0])self.xmax = float(area[1])self.ymin = float(area[2])self.ymax = float(area[3])def __init__(self,start,goal,obstacle_list,rand_area,expand_dis=1.0,goal_sample_rate=5,max_iter=500,play_area=None,robot_radius=0.0,):"""Setting Parameterstart:起点 [x,y]goal:目标点 [x,y]obstacleList:障碍物位置列表 [[x,y,size],...]rand_area: 采样区域 x,y ∈ [min,max]play_area: 约束随机树的范围 [xmin,xmax,ymin,ymax]robot_radius: 机器人半径expand_dis: 扩展的步长goal_sample_rate: 采样目标点的概率,百分制.default: 5,即表示5%的概率直接采样目标点"""self.start = self.Node(start[0], start[1])  # 根节点(0,0)self.end = self.Node(goal[0], goal[1])  # 终点(6,10)self.min_rand = rand_area[0]  # -2  树枝生长区域xminself.max_rand = rand_area[1]  # 15  xmaxif play_area is not None:self.play_area = self.AreaBounds(play_area)  # 树枝生长区域,左下(-2,0)==>右上(12,14)else:self.play_area = None  # 数值无限生长self.expand_dis = expand_dis  # 树枝一次的生长长度self.goal_sample_rate = goal_sample_rate  # 多少概率直接选终点self.max_iter = max_iter  # 最大迭代次数self.obstacle_list = obstacle_list  # 障碍物的坐标和半径self.node_list = []  # 保存节点self.robot_radius = robot_radius  # 随机点的搜索半径# 路径规划def planning(self, animation=True, camara=None):# 先在节点列表中保存起点self.node_list = [self.start]for i in range(self.max_iter):# 随机选取一个节点rnd_node = self.sample_free()# 从已知节点中选择和目标节点最近的节点nearest_ind = self.get_nearest_node_index(self.node_list, rnd_node)nearest_node = self.node_list[nearest_ind]new_node = self.steer(nearest_node, rnd_node, self.expand_dis)# 判断新点是否在规定的树的生长区域内,新点和最近点之间是否存在障碍物if self.is_inside_play_area(new_node, self.play_area) and \self.obstacle_free(new_node, self.obstacle_list, self.robot_radius):# 都满足才保存该点作为树节点self.node_list.append(new_node)# 如果此时得到的节点到目标点的距离小于扩展步长,则直接将目标点作为xrand。if self.calc_dist_to_goal(self.node_list[-1].x, self.node_list[-1].y) <= self.expand_dis:# 以新点为起点,向终点画树枝final_node = self.steer(self.node_list[-1], self.end, self.expand_dis)# 如果最新点和终点之间没有障碍物Trueif self.obstacle_free(final_node, self.obstacle_list, self.robot_radius):return self.generate_final_course(len(self.node_list) - 1)if animation and i % 5 == 0:self.draw_graph(rnd_node, camara)return None  # cannot find path# 距离最近的已知节点坐标,随机坐标,从已知节点向随机节点的延展的长度def steer(self, from_node, to_node, extend_length=float("inf")):# d已知点和随机点之间的距离,theta两个点之间的夹角d, theta = self.calc_distance_and_angle(from_node, to_node)# 如果树枝的生长长度超出了随机点,就用随机点位置作为新节点if extend_length >= d:new_x = to_node.xnew_y = to_node.y# 如果树生长长度没达到随机点长度,就截取长度为extend_length的节点作为新节点else:new_x = from_node.x + math.cos(theta) * extend_lengthnew_y = from_node.y + math.sin(theta) * extend_lengthnew_node = self.Node(new_x, new_y)new_node.path_x = [from_node.x]new_node.path_y = [from_node.y]new_node.path_x.append(new_x)new_node.path_y.append(new_y)new_node.parent = from_nodereturn new_nodedef generate_final_course(self, goal_ind):path = [[self.end.x, self.end.y]]node = self.node_list[goal_ind]while node.parent is not None:path.append([node.x, node.y])node = node.parentpath.append([node.x, node.y])return pathdef calc_dist_to_goal(self, x, y):"""计算(x,y)离目标点的距离"""dx = x - self.end.xdy = y - self.end.yreturn math.hypot(dx, dy)def sample_free(self):if random.randint(0, 100) > self.goal_sample_rate:rnd = self.Node(random.uniform(self.min_rand, self.max_rand),random.uniform(self.min_rand, self.max_rand))else:  # goal point samplingrnd = self.Node(self.end.x, self.end.y)return rnd# 绘制搜索过程def draw_graph(self, rnd=None, camera=None):if camera == None:plt.clf()# for stopping simulation with the esc key.plt.gcf().canvas.mpl_connect('key_release_event',lambda event: [exit(0) if event.key == 'escape' else None])# 画随机点if rnd is not None:plt.plot(rnd.x, rnd.y, "^k")if self.robot_radius > 0.0:self.plot_circle(rnd.x, rnd.y, self.robot_radius, '-r')# 画生成的树for node in self.node_list:if node.parent:plt.plot(node.path_x, node.path_y, "-g")# 画障碍物for (ox, oy, size) in self.obstacle_list:self.plot_circle(ox, oy, size)# 画出可行区域if self.play_area is not None:plt.plot([self.play_area.xmin, self.play_area.xmax,self.play_area.xmax, self.play_area.xmin,self.play_area.xmin],[self.play_area.ymin, self.play_area.ymin,self.play_area.ymax, self.play_area.ymax,self.play_area.ymin],"-k")# 画出起点和目标点plt.plot(self.start.x, self.start.y, "xr")plt.plot(self.end.x, self.end.y, "xr")plt.axis("equal")plt.axis([-2, 15, -2, 15])plt.grid(True)plt.pause(0.01)if camera != None:camera.snap()@staticmethoddef plot_circle(x, y, size, color="-b"):deg = list(range(0, 360, 5))deg.append(0)xl = [x + size * math.cos(np.deg2rad(d)) for d in deg]yl = [y + size * math.sin(np.deg2rad(d)) for d in deg]plt.plot(xl, yl, color)@staticmethoddef get_nearest_node_index(node_list, rnd_node):# 计算所有已知节点和随机节点之间的距离dlist = [(node.x - rnd_node.x) ** 2 + (node.y - rnd_node.y) ** 2for node in node_list]minind = dlist.index(min(dlist))return minind@staticmethoddef is_inside_play_area(node, play_area):if play_area is None:return Trueif node.x < play_area.xmin or node.x > play_area.xmax or \node.y < play_area.ymin or node.y > play_area.ymax:return Falseelse:return True@staticmethoddef obstacle_free(node, obstacleList, robot_radius):# 目标点,障碍物中点和半径,移动时的占地半径if node is None:return Falsefor (ox, oy, size) in obstacleList:dx_list = [ox - x for x in node.path_x]dy_list = [oy - y for y in node.path_y]d_list = [dx * dx + dy * dy for (dx, dy) in zip(dx_list, dy_list)]if min(d_list) <= (size + robot_radius) ** 2:return Falsereturn True@staticmethoddef calc_distance_and_angle(from_node, to_node):"""计算两个节点间的距离和方位角"""dx = to_node.x - from_node.xdy = to_node.y - from_node.yd = math.hypot(dx, dy)theta = math.atan2(dy, dx)return d, thetadef main(gx=6.0, gy=10.0):print("start " + __file__)fig = plt.figure(1)camera = Camera(fig) # 保存动图时使用show_animation = TrueobstacleList = [(5, 5, 1), (3, 6, 2), (3, 8, 2), (3, 10, 2), (7, 5, 2),(9, 5, 2), (8, 10, 1)]  # [x, y, radius]# Set Initial parametersrrt = RRT(start=[0, 0],goal=[12, 12],rand_area=[-2, 15],obstacle_list=obstacleList,play_area=[-2, 15, 0, 15],# 搜索半径robot_radius=0.2)path = rrt.planning(animation=show_animation, camara=camera)if path is None:print("Cannot find path")else:print("found path!!")# 绘制最终路径if show_animation:print('start drawing the final path')rrt.draw_graph(camera=camera)plt.grid(True)plt.pause(0.01)plt.plot([x for (x, y) in path], [y for (x, y) in path], '-r')if camera != None:camera.snap()animation = camera.animate()animation.save('trajectory_res.gif')plt.show()if __name__ == '__main__':main()

本文来自互联网用户投稿,该文观点仅代表作者本人,不代表本站立场。本站仅提供信息存储空间服务,不拥有所有权,不承担相关法律责任。如若转载,请注明出处:http://www.rhkb.cn/news/496243.html

如若内容造成侵权/违法违规/事实不符,请联系长河编程网进行投诉反馈email:809451989@qq.com,一经查实,立即删除!

相关文章

在 Vue3 项目中实现计时器组件的使用(Vite+Vue3+Node+npm+Element-plus,附测试代码)

一、概述 记录时间 [2024-12-26] 本文讲述如何在 Vue3 项目中使用计时器组件。具体包括开发环境的配置&#xff0c;ViteVue 项目的创建&#xff0c;Element Plus 插件的使用&#xff0c;以及计时器组件的创建和使用。 想要直接实现计时器组件&#xff0c;查看文章的第四部分。…

简单园区网拓扑实验

1.实验拓扑 2.实验要求 1、按照图示的VLAN及IP地址需求&#xff0c;完成相关配置 2、要求SW1为VLAN 2/3的主根及主网关 SW2为vlan 20/30的主根及主网关 SW1和SW2互为备份 3、可以使用super vlan 4、上层通过静态路由协议完成数据通信过程 5、AR1为企业出口路由器 6、要求全网可…

jetson Orin nx + yolov8 TensorRT 加速量化 环境配置

参考【Jetson】Jetson Orin NX纯系统配置环境-CSDN博客 一 系统环境配置&#xff1a; 1.更换源&#xff1a; sudo vi /etc/apt/sources.list.d/nvidia-l4t-apt-source.list2.更新源&#xff1a; sudo apt upgradesudo apt updatesudo apt dist-upgrade sudo apt-get updat…

音视频入门基础:MPEG2-TS专题(22)——FFmpeg源码中,获取TS流的音频信息的实现

音视频入门基础&#xff1a;MPEG2-TS专题系列文章&#xff1a; 音视频入门基础&#xff1a;MPEG2-TS专题&#xff08;1&#xff09;——MPEG2-TS官方文档下载 音视频入门基础&#xff1a;MPEG2-TS专题&#xff08;2&#xff09;——使用FFmpeg命令生成ts文件 音视频入门基础…

MySQL45讲 第三十六讲 为什么临时表可以重名?——阅读总结

文章目录 MySQL45讲 第三十六讲 为什么临时表可以重名&#xff1f;——阅读总结一、引言二、临时表与内存表的区别&#xff08;一&#xff09;内存表&#xff08;二&#xff09;临时表 三、临时表的特性&#xff08;一&#xff09;可见性与生命周期&#xff08;二&#xff09;与…

MATLAB符号计算-符号表达式基础运算操作

1.1.2符号变量取值域的限定 默认复数域 【例1-1-2】解不等式 1.1.3创建符号表达式 对符号对象进行各种运算&#xff08;算术运算、关系运算、逻辑运算&#xff09;&#xff0c;即可创建符号表达式。 1.算术运算与转置 【例1-1-3】 f5是f4的共轭转置 f6是f4的转置 2.关系…

深度学习-78-大模型量化之Quantization Aware Training量化感知训练QAT

文章目录 1 量化感知训练1.1 QAT的核心思想1.2 QAT的工作原理1.2.1 第一个维度1.2.2 第二个维度2 大模型的1-bits时代BitNet2.1 BitLinear层2.2 权重量化2.3 激活量化2.4 反量化3 大模型处于1.58Bits状态3.1 零值的作用3.2 量化3.3 效果4 参考附录1 量化感知训练 PTQ方法的一个…

(亲测)frp对外提供简单的文件访问服务-frp静态文件效果

话说有一天&#xff0c;希望将软件安装包放到网上&#xff0c;希望类似如下效果&#xff0c;正好在调试frp docker版&#xff0c;看到frp有个【对外提供简单的文件访问服务】功能&#xff0c;网上搜索也没相关效果图&#xff0c;所以顺手测试一下&#xff0c;截了几张图&#x…

基于YOLOV5+Flask安全帽RTSP视频流实时目标检测

1、背景 在现代工业和建筑行业中&#xff0c;安全始终是首要考虑的因素之一。特别是在施工现场&#xff0c;工人佩戴安全帽是确保人身安全的基本要求。然而&#xff0c;人工监督难免会有疏漏&#xff0c;尤其是在大型工地或复杂环境中&#xff0c;确保每个人都佩戴安全帽变得非…

LabVIEW数字式气压计自动检定系统

开发了一个基于LabVIEW开发的数字式气压计自动检定系统。在自动化检定PTB220和PTB210系列数字气压计&#xff0c;通过优化硬件组成和软件设计&#xff0c;实现高效率和高准确度的检定工作&#xff0c;有效降低人力成本并提升操作准确性。 项目背景 随着自动气象站的广泛部署&a…

FPGA的DMA应用——pcileech

硬件通过pcie总线&#xff0c;访存本机的内存&#xff0c;并进行修改&#xff0c;可以进行很多操作。 学习视频&#xff1a;乱讲DMA及TLP 1-pcileech项目简介和自定义模块介绍_哔哩哔哩_bilibili vivado2024.1的下载文章链接和地址&#xff1a;AMD-Xilinx Vivado™ 2024.1 现…

【漫话机器学习系列】022.微积分中的链式求导法则(chain rule of Calculus)

链式求导法则&#xff08;Chain Rule of Calculus&#xff09; 链式求导法则是微积分中的重要工具&#xff0c;用于处理复合函数的求导。它描述了如何计算一个函数的函数&#xff08;复合函数&#xff09;的导数。 1. 链式法则的定义 假设有一个复合函数 y f(g(x))&#xff…

TP5 动态渲染多个Layui表格并批量打印所有表格

记录&#xff1a; TP5 动态渲染多个Layui表格每个表格设置有2行表头&#xff0c;并且第一行表头在页面完成后动态渲染显示内容每个表格下面显示统计信息可点击字段排序一次打印页面上的所有表格打印页面上多个table时,让每个table单独一页 后端代码示例&#xff1a; /*** Nod…

开发微信小程序的过程与心得

起因 作为家长&#xff0c;我近期参与了学校的护学岗工作。在这个过程中&#xff0c;我发现需要使用水印相机来记录护学活动&#xff0c;但市面上大多数水印相机应用都要求开通会员才能使用完整功能。作为一名程序员&#xff0c;我决定利用自己的技术背景&#xff0c;开发一个…

新建一个springboot项目

注意版本注意版本注意版本&#xff01;&#xff01;&#xff01; 参考&#xff1a; 我的IDEA 2022.2.3 是通过IDEA内嵌的功能来完成该项目的创建的。 一、创建 其实按截图走就够了&#xff0c;别弄的太麻烦了。 注意版本 注意&#xff0c;springboot的版本要是最新的&…

机器视觉检测相机基础知识 | 颜色 | 光源 | 镜头 | 分辨率 / 精度 / 公差

注&#xff1a;本文为 “keyence 视觉沙龙中机器视觉检测基础知识” 文章合辑。 机器视觉检测基础知识&#xff08;一&#xff09;颜色篇 视觉检测硬件构成的基本部分包括&#xff1a;处理器、相机、镜头、光源。 其中&#xff0c;和光源相关的最重要的两个参数就是光源颜色和…

7. petalinux 根文件系统配置(package group)

根文件系统配置&#xff08;Petalinux package group&#xff09; 当使能某个软件包组的时候&#xff0c;依赖的包也会相应被使能&#xff0c;解决依赖问题&#xff0c;在配置页面的help选项可以查看需要安装的包 每个软件包组的功能: packagegroup-petalinux-audio包含与音…

接口测试Day03-postman断言关联

postman常用断言 注意&#xff1a;不需要手敲&#xff0c;点击自动生成 断言响应状态码 Status code&#xff1a;Code is 200 //断言响应状态码为 200 pm.test("Status code is 200", function () {pm.response.to.have.status(200); });pm: postman的实例 test() …

Python vs PHP:哪种语言更适合网页抓取

本文将比较 Python 和 PHP&#xff0c;以帮助读者确定哪种语言更适合他们的需求。文章将探讨两种语言的优点和缺点&#xff0c;并根据读者的经验水平分析哪种语言可能更容易上手。接下来&#xff0c;文章将深入探讨哪种语言在抓取网页数据方面更胜一筹。 简而言之&#xff0c;…

五分钟学会如何在GitHub上自动化部署个人博客(hugo框架 + stack主题)

上一篇文章&#xff1a; 10分钟学会免费搭建个人博客&#xff08;Hugo框架 stack主题&#xff09; 前言 首先&#xff0c;想要实现这个功能的小伙伴需要完成几个前置条件&#xff1a; 有一个GitHub账号安装了git&#xff0c;并可以通过git推送commit到GitHub上完成第一篇文章…