- 博客(34)
- 收藏
- 关注
原创 S32DS144K-bug:配置输入捕获模式时,使用捕获函数得不到计数器的值
2.然后查看measurementResults被调用的函数,发现了measurementResults被FTM_DRV_InputCaptureHandler调用。4.然后进一步发现FTM_DRV_InputCaptureHandler函数被FTM_DRV_IrqHandler函数调用。1.先进入该函数,发现value为我们需要的值,value又在measurementResults被赋值。3.同样我们在进入FTM_DRV_InputCaptureHandler函数,发现了捕获值的计算公式。
2023-03-29 11:25:19
960
1
原创 S32DS144K-bug:程序一直在中断循环,不能跳出中断且进不了主程序的while循环。
下面是简单的主函数while循环:注意:为了防止变量被编译器优化,我们定义变量时加上关键词volatile。然后编译运行:发现tim01一直在增加,而num却没有值。(当你在程序运行前在while里打一个断点,发现while会执行一次。由于我开的是通道0和1的中断,所以需要清除两个标志。
2023-03-29 09:21:33
1182
原创 每日一题解答(四)
给你两个按 非递减顺序 排列的整数数组nums1 和 nums2,另有两个整数 m 和 n ,分别表示 nums1 和 nums2 中的元素数目。
2022-09-08 20:13:20
291
原创 每日一题解答(三)
给定一个整数数组 nums和一个整数目标值 target,请你在该数组中找出 和为目标值 target的那两个整数,并返回它们的数组下标。
2022-09-07 20:49:52
170
原创 The `padding` argument must be a list/tuple or one of “valid“
layers.Conv2D()调用时出现的问题
2022-06-27 11:59:07
480
原创 gzip: stdin: unexpected end of file tar: 归档文件中异常的 EOF解决办法(多次重新下载无效)
gzip: stdin: unexpected end of filetar: 归档文件中异常的 EOFtar: 归档文件中异常的 EOFtar: Error is not recoverable: exiting now
2022-03-17 10:51:25
20472
9
原创 (十二)学习笔记autoware源码core_planning(velocity_set)
1.libvelocity_set#include <waypoint_planner/velocity_set/libvelocity_set.h>// extract edge points from zebra zonestd::vector<geometry_msgs::Point> removeNeedlessPoints(std::vector<geometry_msgs::Point> &area_points){ area_poi
2022-02-08 21:26:09
1851
原创 (十一)学习笔记autoware源码core_planning(astar_search)
#include "astar_search/astar_search.h"AstarSearch::AstarSearch(){ ros::NodeHandle private_nh_("~"); // base configs private_nh_.param<bool>("use_back", use_back_, true); private_nh_.param<bool>("use_potential_heuristic", use_potent.
2022-01-28 22:13:48
1726
原创 (十)学习笔记autoware源码core_planning(astar_avoid)
1.astar_avoid_node#include "waypoint_planner/astar_avoid/astar_avoid.h"//首先是其 main 函数,main函数在astar_avoid_node.cpp中,节点的功能主要通过AstarAvoid对象的run函数实现。int main(int argc, char** argv){ ros::init(argc, argv, "astar_avoid"); AstarAvoid node; node.run();
2022-01-28 22:11:34
1225
原创 (九)学习笔记autoware源码core_planning(lane_select)
1.lane_select_node就一个主函数。#include <ros/ros.h>#include "lane_select_core.h"int main(int argc, char **argv){ ros::init(argc, argv, "lane_select"); lane_planner::LaneSelectNode lsn; lsn.run(); return 0;}2.hermite_curve#include "
2022-01-22 21:17:11
1644
原创 (八)学习笔记autoware源码core_planning(lane_stop)
#include <ros/console.h>#include "autoware_config_msgs/ConfigLaneStop.h"#include "autoware_msgs/TrafficLight.h"#include "autoware_msgs/LaneArray.h"#include <lane_planner/lane_planner_vmap.hpp>namespace {bool config_manual_detection .
2022-01-22 14:54:08
1339
原创 (七)学习笔记autoware源码core_planning(lane_rule)
#ifdef DEBUG#include <sstream>#endif // DEBUG#include <ros/console.h>#include <vector_map/vector_map.h>#include "autoware_config_msgs/ConfigLaneRule.h"#include "autoware_msgs/LaneArray.h"#include <lane_planner/lane_planner_.
2022-01-21 21:30:55
1309
原创 (六)学习笔记autoware源码core_planning(lane_navi)
#include <sstream>#include <ros/console.h>#include <tf/transform_datatypes.h>#include <vector_map/vector_map.h>#include "autoware_msgs/LaneArray.h"#include "lane_planner/lane_planner_vmap.hpp"namespace {int waypoint_max.
2022-01-21 19:11:26
873
原创 (五)学习笔记autoware源码core_planning(waypoint_marker_publisher)
#include <ros/ros.h>#include <ros/console.h>#include <visualization_msgs/MarkerArray.h>#include <std_msgs/Int32.h>#include <tf/transform_datatypes.h>#include <iostream>#include <vector>#include <string..
2022-01-19 21:14:24
701
原创 (四)学习笔记autoware源码core_planning(waypoint_replanner)
1.waypoint_replanner_node.#include <ros/ros.h>#include <autoware_msgs/LaneArray.h>#include "waypoint_replanner.h"namespace waypoint_maker{class WaypointReplannerNode{public: WaypointReplannerNode();private: ros::NodeHandle nh_;
2022-01-19 17:23:58
1526
原创 (三)学习笔记autoware源码core_planning(waypoint_loader)
1.waypoint_loader_node#include <ros/ros.h>#include "waypoint_loader_core.h"int main(int argc, char** argv){ ros::init(argc, argv, "waypoint_loader"); waypoint_maker::WaypointLoaderNode wln; wln.run(); return 0;}/*首先是其main函数,main函数在
2022-01-17 19:28:03
1167
原创 (二)学习笔记autoware源码core_planning(waypoint_extractor)
#include <ros/ros.h>#include <tf/transform_datatypes.h>#include <autoware_msgs/LaneArray.h>#include <iostream>#include <fstream>#include <vector>/*节点waypoint_extractor的主要作用:在其被关闭时将lane_navi节点规划出来的路径集合中的所有轨迹点数据按照路.
2022-01-17 16:12:09
693
原创 (一)学习笔记autoware源码core_planning(waypoint_saver)
#include <ros/ros.h>#include <geometry_msgs/PoseStamped.h>#include <visualization_msgs/Marker.h> /*rviz中使用MarkerArray绘制地图线*/#include <visualization_msgs/MarkerArray.h>#include <message_filters/subscriber.h>.
2022-01-11 17:12:32
952
原创 使用artibox控制机器人运动,在rviz中没有出现odom问题解决
报错问题:(注:artibox仅限于noetic)解决方案:1.更新软件源sudo apt-get update2.下载sudo apt install python3-pip3.sudo pip3 install pyserial
2021-11-30 15:58:02
4023
6
原创 “make cmake_check_build_system”
该问题应该是ROS中某些依赖缺失,需要安装相应的功能包可以先用下面命令查看一下当前ROS安装的功能包,看看是否存在上面的功能包。 rospack list如果没有,则可用下面命令查询所有功能包Ubuntu16.04 apt-cache search ros-kineticUbuntu18.04apt-cache search ros-melodic选择需要的功能包install(不过显示出来的功能包太多了)当然,有的时候因为某些功能包被集成了,不...
2021-11-18 11:26:56
5837
原创 从零开始搭建自动驾驶汽车(四)
(四)GPS与IMU模拟1.GPS模拟同样在(二)中创建的功能包里进行编译和source,使用下面命令打开GPS 模拟roslaunch sensor_sim_gazebo gps.launch下面检查GPS插件是否正确rostopic list下面进行测试rostopic echo /gps/fix出现下面参数且不停的跳动就说明GPS运行良好2.IMU模拟关闭所有终端,同样在(二)中创建的功能包里进行编译和source,使用下面命令打开IMU...
2021-11-16 15:53:10
902
原创 从零开始搭建自动驾驶汽车(三)
(三)单目与立体摄像头模拟1.在(二)中创建的功能包下,使用catkin_make编译并sourse一下。2.使用下面命令启动单目摄像头模拟roslaunch sensor_sim_gazebo camera.launch同样此命令不会主动打开rviz(不打开rviz也可以使用下面命令直接查看图像)rosrun image_view image_view image:=/sensor/camera1/image_raw下面我们使用rviz进行查看rosrun..
2021-11-16 15:08:51
878
原创 从零开始搭建自动驾驶汽车(二)
(二)激光扫描仪模拟1.首先先去下面的网址下载一个名为chapter_10_ws中的一个名为sensor_sim_gazebo的代码包。https://github.com/PacktPublishing/ROS-Robotics-Projects-SecondEditionhttps://github.com/PacktPublishing/ROS-Robotics-Projects-SecondEdition如果访问失败可以...
2021-11-16 10:37:09
976
1
原创 无法解析域名“mirrors.ustc.edu.cn
在使用apt-get install时,出现无法解析域名“mirrors.ustc.edu.cn错误,这时先打开Ubuntu内Firefox浏览器,如果出现网络异常,那该错误就是因为没连上网导致的。如果能正常上网,那可能就是域名出现问题了,可以参考下面方法http://(5条消息) Ubuntu 无法解析域名_Daniel is coding-优快云博客 https://blog.youkuaiyun.com/danielpei1222/article/details/65452451?ops_request_m
2021-11-14 20:13:45
11800
1
原创 从零开始搭建自动驾驶汽车(一)
(一)VelodyneLIDAR模拟1.在ROS Melodic上安装Velodynesudo apt-get install ros-melodic-velodyne-simulator2.下载源代码到主文件夹下git clone https://bitbucket.org/DataspeedInc/velodyne_simulator.git3.创建一个工作空间mkdir -p ~/catkin_ws/srccd ~/catkin_ws/src catkin_.
2021-11-14 19:58:29
1068
原创 从零开始搭建自动驾驶汽车(0)
前提准备:1.安装Ubuntu18.04系统(虚拟机内存最少8G)2.预先安装ROS Melodic Morenia 和Gazebo93.拥有一定的ros基础(不建议直接上手,因为ros很容易报各种错)下面推荐一个B站的免费学习视频:可以先学一二章以及第六章,对简单的错误能直接定位原因。【奥特学园】ROS机器人入门课程《ROS理论与实践》零基础教程_哔哩哔哩_bilibili为了帮助大家快速上手机器人开发,我们制作了一套非常详细、适合零基础学习的ROS教程,免费分享给大家。课程文档:http:/
2021-11-13 22:54:37
915
原创 Invoking“make -j2 -l2“failed
注意,这个提示不是出问题的地方,也就是说出错的不是invoking"make -j2 -l2",它只是表明你使用了双线程计算,就好比电脑的双核。同理也会出现“-j4 -l4”,"-j8 -l8"。就如上图,问题出在我在编写c++代码时,少打了一个分号;。...
2021-11-05 16:35:25
9272
4
原创 Couldn‘t find executable(ROS)
问题:可能原因:检查一下c_cpp_properties.json文件中“includePath”下面是否包含“cppStandard:“c++17””
2021-11-04 16:25:30
678
空空如也
空空如也
TA创建的收藏夹 TA关注的收藏夹
TA关注的人