ROS常见问题及解决方法

2023-05-16

1. undefined reference to `tf::TransformBroadcaster::TransformBroadcaster()’

问题描述:

CMakeFiles/imu_data.dir/src/imu_data.cpp.o: In function `main':
imu_data.cpp:(.text+0x2bc): undefined reference to `tf::TransformBroadcaster::TransformBroadcaster()'
imu_data.cpp:(.text+0x4c8): undefined reference to `tf::TransformBroadcaster::sendTransform(tf::StampedTransform const&)'
collect2: error: ld returned 1 exit status
imu_publish/CMakeFiles/imu_data.dir/build.make:113: recipe for target '/home/sikong/catkin_ws/devel/lib/imu_publish/imu_data' failed
make[2]: *** [/home/sikong/catkin_ws/devel/lib/imu_publish/imu_data] Error 1
CMakeFiles/Makefile2:669: recipe for target 'imu_publish/CMakeFiles/imu_data.dir/all' failed
make[1]: *** [imu_publish/CMakeFiles/imu_data.dir/all] Error 2
Makefile:140: recipe for target 'all' failed
make: *** [all] Error 2
Invoking "make -j4 -l4" failed

解决方案
在Cmakelist.txt和package.xml中添加TF依赖
在这里插入图片描述

2. [ERROR] [1426895120.908823306, 1422676721.758969255]: Lookup would require extrapolation into the past. Requested time 1422676720.347031633 but the earliest data is at time 1422676720.654202231, when looking up transform from frame [imu_link] to frame [base_link]

问题描述:

 [ERROR] [1426895120.908823306, 1422676721.758969255]: Lookup would require extrapolation into the past.  Requested time 1422676720.347031633 but the earliest data is at time 1422676720.654202231, when looking up transform from frame [imu_link] to frame [base_link]

解决方案
时间戳的问题,需要将时间戳放到while大循环里面。

#include <ros/ros.h>
#include <tf/transform_broadcaster.h>
#include <sensor_msgs/Imu.h>

using namespace std;

int main(int argc,char **argv)
{
	ros::init(argc,argv, "imu_data_node");
 
     ros::NodeHandle nh;
 //发布主题, 消息格式使用sensor_msg::Imu标准格式(topic名称,队列长度)
     ros::Publisher IMU_read_pub = nh.advertise<sensor_msgs::Imu>("imu", 20);
     sensor_msgs::Imu imu_data;
     tf::TransformBroadcaster imu_broadcaster;
     tf::Transform transform;
     ros::Time current_time;
     while(ros::ok())
     {
		 current_time = ros::Time::now();
         imu_data.header.stamp = current_time;
         imu_data.header.frame_id = "imu_link";
         transform.setOrigin(tf::Vector3(0.0, 0.0, 0.128));
         transform.setRotation(tf::Quaternion(0, 0, 0, 1));
         imu_broadcaster.sendTransform(tf::StampedTransform(transform, current_time, "base_link", "imu_link") );
                                                                                    //父坐标系 ,子坐标系
     }
}

3.fatal error: opencv2/core/core.hpp: No such file or directory

解决方法
在相应的Cmakelist.txt文件里添加opencv的头文件路径等

find_package(OpenCV 4.1.1 EXACT REQUIRED)
message( STATUS "OpenCV Include Dir: " ${OpenCV_INCLUDE_DIRS} )
include_directories( 
	${OpenCV_INCLUDE_DIRS}
)

4. Could NOT find SDL (missing: SDL_LIBRARY SDL_INCLUDE_DIR)

解决方法

sudo apt-get install libsdl-dev

5. Could NOT find SDL_image (missing: SDL_IMAGE_LIBRARIES SDL_IMAGE_INCLUDE_DIRS)

解决方法:

sudo apt-get install libsdl-image1.2-dev

6. Warning: Invalid argument “/map” passed to canTransform argument target_frame in tf2 frame_ids cannot start with a ‘/’

问题描述

Warning: Invalid argument "/map" passed to canTransform argument target_frame in tf2 frame_ids cannot start with a '/' like: 
         at line 134 in /tmp/binarydeb/ros-melodic-tf2-0.6.5/src/buffer_core.cpp

解决方案
将global_costmap_params.yaml和local_costmap_params.yaml文件里相应的参数“/map”去掉“/” 。

7. 编译teb_local_planner程序包时编译出错

/home/sikong/catkin_ws/src/teb_local_planner/src/optimal_planner.cpp: In member function ‘boost::shared_ptr<g2o::SparseOptimizer> teb_local_planner::TebOptimalPlanner::initOptimizer()’:
/home/sikong/catkin_ws/src/teb_local_planner/src/optimal_planner.cpp:160:64: error: no matching function for call to ‘g2o::BlockSolver<g2o::BlockSolverTraits<-1, -1> >::BlockSolver(std::unique_ptr<g2o::LinearSolverCSparse<Eigen::Matrix<double, -1, -1> > >&)’
   TEBBlockSolver* blockSolver = new TEBBlockSolver(linearSolver);
                                                                ^
In file included from /opt/ros/melodic/include/g2o/core/block_solver.h:199:0,
                 from /home/sikong/catkin_ws/src/teb_local_planner/include/teb_local_planner/optimal_planner.h:55,
                 from /home/sikong/catkin_ws/src/teb_local_planner/src/optimal_planner.cpp:39:
/opt/ros/melodic/include/g2o/core/block_solver.hpp:40:1: note: candidate: g2o::BlockSolver<Traits>::BlockSolver(std::unique_ptr<typename Traits::LinearSolverType>) [with Traits = g2o::BlockSolverTraits<-1, -1>; typename Traits::LinearSolverType = g2o::LinearSolver<Eigen::Matrix<double, -1, -1> >]
 BlockSolver<Traits>::BlockSolver(std::unique_ptr<LinearSolverType> linearSolver)
 ^~~~~~~~~~~~~~~~~~~
/opt/ros/melodic/include/g2o/core/block_solver.hpp:40:1: note:   no known conversion for argument 1 from ‘std::unique_ptr<g2o::LinearSolverCSparse<Eigen::Matrix<double, -1, -1> > >’ to ‘std::unique_ptr<g2o::LinearSolver<Eigen::Matrix<double, -1, -1> >, std::default_delete<g2o::LinearSolver<Eigen::Matrix<double, -1, -1> > > >’
/home/sikong/catkin_ws/src/teb_local_planner/src/optimal_planner.cpp:161:100: error: no matching function for call to ‘g2o::OptimizationAlgorithmLevenberg::OptimizationAlgorithmLevenberg(teb_local_planner::TEBBlockSolver*&)’
   g2o::OptimizationAlgorithmLevenberg* solver = new g2o::OptimizationAlgorithmLevenberg(blockSolver);

/home/sikong/catkin_ws/src/teb_local_planner/src/teb_local_planner_ros.cpp: In member function ‘virtual bool teb_local_planner::TebLocalPlannerROS::computeVelocityCommands(geometry_msgs::Twist&)’:
/home/sikong/catkin_ws/src/teb_local_planner/src/teb_local_planner_ros.cpp:229:40: error: no matching function for call to ‘costmap_2d::Costmap2DROS::getRobotPose(tf::Stamped<tf::Transform>&)’
   costmap_ros_->getRobotPose(robot_pose);
                                        ^
In file included from /home/sikong/catkin_ws/src/navigation/nav_core/include/nav_core/base_local_planner.h:42:0,
                 from /home/sikong/catkin_ws/src/teb_local_planner/include/teb_local_planner/teb_local_planner_ros.h:45,
                 from /home/sikong/catkin_ws/src/teb_local_planner/src/teb_local_planner_ros.cpp:39:
/home/sikong/catkin_ws/src/navigation/costmap_2d/include/costmap_2d/costmap_2d_ros.h:125:8: note: candidate: bool costmap_2d::Costmap2DROS::getRobotPose(geometry_msgs::PoseStamped&) const
   bool getRobotPose(geometry_msgs::PoseStamped& global_pose) const;
        ^~~~~~~~~~~~
/home/sikong/catkin_ws/src/navigation/costmap_2d/include/costmap_2d/costmap_2d_ros.h:125:8: note:   no known conversion for argument 1 from ‘tf::Stamped<tf::Transform>’ to ‘geometry_msgs::PoseStamped& {aka geometry_msgs::PoseStamped_<std::allocator<void> >&}’
/home/sikong/catkin_ws/src/teb_local_planner/src/teb_local_planner_ros.cpp:234:40: error: no matching function for call to ‘base_local_planner::OdometryHelperRos::getRobotVel(tf::Stamped<tf::Transform>&)’
   odom_helper_.getRobotVel(robot_vel_tf);

解决方案
这个错误是由于git的源码分支版本和你使用的ROS版本不同导致的,如果你用的是melodic版本的ROS
方法1
新开一个终端,输入

cd ~/catkin_ws/src/teb_local_planner
git checkout melodic-devel

方法2

cd ~/catkin_ws/src
rm -rf teb_local_planner
git clone -b melodic-devel https://git
hub.com/rst-tu-dortmund/teb_local_planner.git
cd ..
catkin_make -DCATKIN_WHITELIST_PACKAGES="teb_local_planner"

8.在笔记本上开启rviz给机器人设定初始位姿和导航目标没反应。

解决方法:机器人跟笔记本时间不同步,同步笔记本跟机器人的系统时间。
系统时间的查看命令:date

9.ROS melodic 安装有问题

The following packages have unmet dependencies:
 ros-melodic-desktop-full : Depends: ros-melodic-desktop but it is not going to be installed
                            Depends: ros-melodic-perception but it is not going to be installed
                            Depends: ros-melodic-simulators but it is not going to be installed
E: Unable to correct problems, you have held broken packages.

解决方法:用sudo apt install ros-melodic-desktop 安装相关缺少的依赖直到不在报类似错误,我的运行下面的语句就不再报错了

 sudo apt install libboost-graph-dev

10. ros发布消息值与代码里的值不一致

问题描述
rostopic echo 后的消息:

---
steering_angle: 0.0
steering_angle_velocity: 1.59676389227e+19
speed: 1.61972191289e-27
acceleration: 1.26116861789e-44
jerk: 7.18332156973e+22
---
steering_angle: 0.0
steering_angle_velocity: 1.59676389227e+19
speed: 1.61167601716e-18
acceleration: 1.26116861789e-44
jerk: 7.18332156973e+22
---
steering_angle: 0.0
steering_angle_velocity: 1.59676389227e+19
speed: 1.59764534935e-09
acceleration: 1.26116861789e-44
jerk: 7.18332156973e+22
---

代码实际值:

ackermann speed :0.200000
speed :0.200000
keyboard value :77
ackermann speed :0.300000
keyboard value :77
ackermann speed :0.400000
keyboard value :77
ackermann speed :0.500000
speed :0.500000
speed :0.500000
keyboard value :77
ackermann speed :0.600000
speed :0.600000
speed :0.600000
speed :0.600000
speed :0.600000
speed :0.600000
speed :0.600000
speed :0.600000
speed :0.600000
speed :0.600000

解决方案
查看消息定义与发布函数的消息类型是否为同一类型,不同类型会导致上述错误:

 ackermann_msgs::AckermannDriveStamped ackermann_cmd_vel_;
 pub_ = n_.advertise<ackermann_msgs::AckermannDriveStamped>("ackermann_cmd_vel", 10);
 

11. ModuleNotFoundError: No module named ‘em’

问题描述:编译程序时报错

  [7%] Generating C++ code from ackermann_msgs/AckermannDrive.msg
Traceback (most recent call last):
  File "/opt/ros/melodic/share/gencpp/cmake/../../../lib/gencpp/gen_cpp.py", line 43, in <module>
    import genmsg.template_tools
  File "/opt/ros/melodic/lib/python2.7/dist-packages/genmsg/template_tools.py", line 39, in <module>
    import em
ModuleNotFoundError: No module named 'em'
ackermann_msgs/CMakeFiles/ackermann_msgs_generate_messages_cpp.dir/build.make:63: recipe for target '/home/zhangying/auto-driving_car/devel/include/ackermann_msgs/AckermannDrive.h' failed
make[2]: *** [/home/zhangying/auto-driving_car/devel/include/ackermann_msgs/AckermannDrive.h] Error 1
CMakeFiles/Makefile2:611: recipe for target 'ackermann_msgs/CMakeFiles/ackermann_msgs_generate_messages_cpp.dir/all' failed
make[1]: *** [ackermann_msgs/CMakeFiles/ackermann_msgs_generate_messages_cpp.dir/all] Error 2
Makefile:140: recipe for target 'all' failed
make: *** [all] Error 2
Invoking "make -j1" failed

解决方案

  1. 新开一终端:
pip uninstall em
pip install empy
source /opt/ros/kinetic/setup.bash
  1. 清除workspace空间,除了src
cd ~/catkin_ws
unlink src/CMakeLists.txt
rm -rf build
rm -rf devel
rm .catkin_workspace
cd ~/catkin_ws/src
catkin_init_workspace
cd ..
catkin_make

12. 找不到自定义消息的头文件

出现此错误时,有三种可能情况:

  1. 此.h文件是由自定义消息生成的,如robot_msgs/voltage.msg
    则解决方法是cmakeList中添加:
add_executable(robot_control_node  src/robot_control.cpp )
add_dependencies(robot_control_node robot_msgs_gencpp)
target_link_libraries(robot_control_node ${catkin_LIBRARIES})

其中:robot_control_node是所要生成的可执行文件,add_dependencies添加所需依赖。
请记得,在find_package中添加robot_msgs。
其次,请记得在package.xml中添加

<build_depend>robot_msgs</build_depend>
<run_depend>robot_msgs</run_depend>
  1. 此.h文件位于本包include内:
    解决方法是,在包含目录下包含include包:
include_directories(
	include
	${catkin_INCLUDE_DIRS} 
)
  1. 此.h文件位于别的包内,如robot_navigation:
    则在find_package中添加此包名:
find_package(catkin REQUIRED COMPONENTS
	roscpp
	rospy
	std_msgs
	robot_navigation
)

其次,请记得在package.xml中添加

<build_depend>robot_navigation</build_depend>
<run_depend>robot_navigation</run_depend>

13.ROS多机协同,主从机设置

  1. 主机中在新开一终端
vim ~/.bashrc

在该文件末尾处添加以下指令,其中的IP为主机IP

export ROS_MASTER_URI=http://192.168.0.168:11311
export ROS_HOSTNAME=192.168.0.168
  1. 从机中新开一终端
vim ~/.bashrc

在该文件末尾处添加以下指令,其中ROS_MASTER_URI的IP为主机IP, ROS_HOSTNAME为从机IP

export ROS_MASTER_URI=http://192.168.0.168:11311
export ROS_HOSTNAME=192.168.0.162
本文内容由网友自发贡献,版权归原作者所有,本站不承担相应法律责任。如您发现有涉嫌抄袭侵权的内容,请联系:hwhale#tublm.com(使用前将#替换为@)

ROS常见问题及解决方法 的相关文章

  • 算法:海量日志数据,提取出某日访问百度次数最多的那个IP

    首先是这一天 xff0c 并且是访问百度的日志中的IP取出来 xff0c 逐个写入到一个大文件中 注意到IP是32位的 xff0c 最多有个2 32个IP 同样可以采用映射的方法 xff0c 比如模1000 xff0c 把整个大文件映射为1
  • 使用JUnit测试预期异常

    开发人员常常使用单元测试来验证的一段儿代码的操作 xff0c 很多时候单元测试可以检查抛出预期异常 expected exceptions 的代码 在Java语言中 xff0c JUnit是一套标准的单元测试方案 xff0c 它提供了很多验
  • BlockingQueue深入分析

    1 BlockingQueue 定义的常用方法如下 抛出异常特殊值阻塞超时插入add e offer e put e offer e time unit 移除remove poll take poll time unit 检查element
  • Qt对directshow的封装

    在源码路径中 xff1a qt everywhere opensource src 5 1 1 qtmultimedia src plugins directshow xff0c 有两个文件夹player 和 camera xff0c 1
  • 聚合类新闻客户端产品功能点详情分析

    产品功能点 功能 今日头条 百度新闻 鲜果 ZAKER 媒体订阅 个性化内容推荐 个性化订阅 RSS 视频新闻 评论盖楼 搜索新闻 离线下载 地方新闻 一键分享 收藏 推送 天气 夜间模式 线上活动 主题设置 感兴趣 语音读文章 字体设置
  • 聚合类新闻客户端初体验

    初体验的产品 xff1a 今日头条 ios3 6 百度新闻 ios4 4 0 ZAKER ios4 4 5 鲜果 ios3 8 7 中搜搜悦 ios4 0 1 Flipboard ios2 3 9 1 Flipboard 一款国外很火的ap
  • 聚合类新闻客户端的改进

    zaker和鲜果是最早的聚合类新闻产品 xff0c 前几年发展很快 xff0c 迅速占领了市场 xff0c 但近两年发展变得缓慢 xff0c 而今日头条自发布以来才两年 xff0c 用户量就迅速超过了zaker和鲜果 xff0c 使用起来非
  • 单例模式优缺点

    主要优点 xff1a 1 提供了对唯一实例的受控访问 2 由于在系统内存中只存在一个对象 xff0c 因此可以节约系统资源 xff0c 对于一些需要频繁创建和销毁的对象单例模式无疑可以提高系统的性能 3 允许可变数目的实例 主要缺点 xff
  • 适配器模式优缺点

    优点 xff1a 1 将目标类和适配者类解耦 2 增加了类的透明性和复用性 xff0c 将具体的实现封装在适配者类中 xff0c 对于客户端类来说是透明的 xff0c 而且提高了适配者的复用性 3 灵活性和扩展性都非常好 xff0c 符合开
  • Oracle 的 Round函数

    Round函数用法 xff1a 截取数字 格式如下 xff1a ROUND xff08 number decimals xff09 其中 xff1a number 待做截取处理的数值 decimals 指明需保留小数点后面的位数 可选项 x
  • eclipse报错:Failed to load the JNI shared library

    电脑自装系统以来 xff0c 好久没有写java代码了 xff0c 所以一直也没用 eclipse IDE xff0c 今天将eclipse打开 xff0c 报了个问题 xff0c Failed to load the JNI shared
  • 10串口通信

    51单片机学习记录10 通信通信的的基本概念串口参数及时序图常用通信接口比较 51单片机串口介绍串口通信简介串口内部结构串口通信相关寄存器 串口通信实验串口向计算机发送数据计算机通过串口控制LED 通信 通信的的基本概念 通信的方式 通信方
  • 【已解决】zookeeper配置出现问题合集

    已解决 zookeeper配置出现问题合集 1 问题诊断 日志2 问题解决合集2 1zookeeper集群搭建报错 拒绝连接 2 2zookeeper集群搭建报错 没有找到主机路由 1 问题诊断 日志 1 进入文件查看日志 xff1a zo
  • noVNC 安装、配置与使用

    最近项目中使用到了远程终端操控 xff0c 从各方找到了noVNC这个神奇的家伙 xff0c 废话不多说 xff0c 开始介绍它的安装配置与使用 1 下载noNVC 好多渠道可以下载到noVNC xff0c 可以直接访问noVNC的官方网页
  • 360极速浏览器网页保护色

    方法一 xff1a 360浏览器的 扩展中心 有一个 绿色眼睛 的插件 xff1b 但是感觉一般 xff0c 不够彻底 xff1b 方法二 xff1a 360急速浏览器是基于开源Chrome浏览器修改的 xff0c 所以可以直接用Chrom
  • STM32基于FreeRTOS的多任务程序案例

    STM32基于FreeRTOS的多任务程序案例 一 初步了解FreeRTOS二 实验要求三 基于FreeRTOS的多任务程序案例四 参考链接 使用工具 野火stm32mini开发板 Keil uVision5 野火多功能调试助手 一 初步了
  • 【TcaplusDB知识库】TcaplusDB刷新tbus通道介绍

    命令 xff1a RefreshBusCfg 其中 xff0c 指进程的进程id xff0c 比如1 2 2 2 1 2 1 2等 xff0c 也支持简单的正则表达式 xff0c 比如RefreshBusCfg 1 2 2 那么只要匹配到1
  • Python中下划线的5种含义

    作者 xff1a 地球的外星人君 链接 xff1a https zhuanlan zhihu com p 36173202 来源 xff1a 知乎 著作权归作者所有 商业转载请联系作者获得授权 xff0c 非商业转载请注明出处 分享一篇文章
  • ubuntu下 安装PX4编译环境

    最近博主的ubuntu虚拟机再次崩溃 xff0c 狠下决心将4G内存升级为12G 这样就可以给虚拟机多分配些内存了 鉴于前两次安装PX4环境出现了很多错误 xff0c 走了很多弯路 xff0c 没有一一记录下来 xff0c 所获甚少 故而借
  • PX4原生固件,position_estimator_inav解读

    INAV integrated navigation组合导航 对于多旋翼的位置姿态估计系统 xff1a PX4原生固件如今已经默认使用EKF2了 xff0c 另一种情况是 使用local position estimator attitud

随机推荐

  • FusionCharts Free (FCF) 版本 v3.0 更新细节

    版本 v3 0 更新细节 1 新的图表类型 滚动图 柱二维 xff0c 二维和区系的二维 xff0c 堆栈柱二维 xff0c 二维结合 xff0c 结合二维 xff08 双 Y 轴 xff09 样图 样条区域图 对数坐标图 二维多图单 组合
  • dwm-1000 测距总是出现 #define SYS_STATUS_RXPTO 0x00200000UL /* Preamble detection timeout */

    ex 05b ds twr resp 程序 总是出现 致使官方的代码 无法实现通讯 define SYS STATUS RXPTO 0x00200000UL Preamble detection timeout 需要着重修改参数
  • VNC远程桌面到linux,提示connection refused(10061)解决办法

    确认server端的VNC服务开启 xff0c service vncserver start xff0c 检测状态时ok的 ps ef grep vnc xff0c 来查看不是已经开启多个vnc连接 如果有多个vnc连接 xff0c 使用
  • uio驱动框架

    核心 xff0c 利用mmap进行映射 参考资料 uio 编写实例 1 https blog csdn net wujiangguizhen article details 12453253 uio编写实例 2 https blog csd
  • enum类型被intent所携带时需要注意的地方

    一般我们在Activity之间传递对象时多用Parcelable 比如写一个class xff0c 在这个class上标明implements Parcelable并实现接口就可以用Intent putExtra String Parcel
  • dump文件,windbg

    dump文件 xff0c 在VC中的调试还是非常非常非常有用的 xff0c 因为我们也不会经每一行代码都加上日志 xff0c 当然如果你愿意 xff0c 也可以每一行都加上日志 xff1b 在Windows上 xff0c 添加dump文件有
  • 使用PyQt4制作一个音乐播放器(1)

    1 前言 最近用Python给老妈写了一个处理excel表格的小软件 xff0c 因为自己平时用Python一般都是用在数值计算领域 xff0c 所以一般使用命令行的方式交互即可 但是给老妈用发现用命令行交互方式使用并不是很方便 xff0c
  • AI 到底是怎么「想」的?

    本文作者 xff1a kurffzhou xff0c 腾讯 TEG 安全工程师 最近 xff0c Nature发表了一篇关于深度学习系统被欺骗的新闻文章 xff0c 该文指出了对抗样本存在的广泛性和深度学习的脆弱性 xff0c 以及几种可能
  • 效能优化实践:C/C++单元测试万能插桩工具

    作者 xff1a mannywang xff0c 腾讯安全平台后台开发 研发效能是一个涉及面很广的话题 xff0c 它涵盖了软件交付的整个生命周期 xff0c 涉及产品 架构 开发 测试 运维 xff0c 每个环节都可能影响顺畅 高质量地持
  • tensowflow报错tensorflow.python.framework.errors_impl.InvalidArgumentError<exception str

    tensorflow用于自己的数据集时 xff0c 在用saver restore导入模型到Session中 xff0c 导入语句报错 xff0c 异常链终止时提示 xff1a tensorflow python framework err
  • 详解HTTP中的摘要认证机制

    在上一期http blog csdn net tenfyguo article details 6167190中笔者较为详细的介绍了HTTPBasic认证在apache下的配置 xff0c 通过简单的实验演示了HTTP Basic认证的基本
  • 【ubuntu(Linux)安装Vs code并配置c++编译及cmake多文件编译】

    目录标题 VS code配置c 43 43 编译环境1 Linux系统安装2 在Ubuntu中安装VS code2 1 首先下载对应系统的VS code安装包2 2 安装VS code 3 在ubuntu系统下的vscode中配置g 43
  • yolo v4安装与使用

    yolo v4安装与使用 GPU版本 系统环境 Ubuntu18 04 cuda11 0 cudnn8 0 4 opencv3 4 4 相关链接 官网链接 xff1a https github com AlexeyAB darknet yo
  • Jetson NX克隆与烧录镜像

    前言 本文主要说明如何在Ubuntu系统上备份Jetson NX镜像 xff0c 并烧录镜像到多台NX开发板上 我的NX的系统是在SD卡上的 xff0c 所以这个方法只适用于系统装在SD卡上的开发板 参考链接 https blog csdn
  • ros2 CMakeLists.txt与packages.xml写法

    注 xff1a 尽量使用ament cmake auto来编写cmakelists txt文件 xff0c 依赖的程序包在packages xml文件中用 lt depend gt nav msgs lt depend gt 的形式声明 x
  • TX2 ubuntu18.04 改固定IP地址 eth0无本机IP

    注意事项 我是在TX2 ubuntu18 04上改的固定IP地址 其他主机上ubuntu18 04好像需要另一种方法 xff0c 需要你自己去百度上搜 参考博客 https blog csdn net a13662080711 articl
  • MFC与.NET混合编程

    1 xff1a VS2008 建立 MFC程序 xff1b 2 xff1a Alt 43 F7 设置 xff1a 公共语言运行库支持 xff08 选择 xff09 公共语言运行库支持 clr xff1b 3 xff1a 添加 Net相应库
  • 在TX2(Jetpack4.2+kernel4.9.140+librealsense v2.22)上安装D435i驱动

    在TX2 xff08 Jetpack4 2 43 kernel4 9 140 43 librealsense v2 22 xff09 上安装D435i驱动 前言准备工作系统版本参考资料 操作步骤 前言 用了很长时间 xff0c 参考了很多博
  • ROS发布静态tf变换

    方法一 xff1a include lt ros ros h gt include lt tf transform broadcaster h gt int main int argc char argv ros init argc arg
  • ROS常见问题及解决方法

    1 undefined reference to 96 tf TransformBroadcaster TransformBroadcaster 问题描述 xff1a CMakeFiles imu data dir src imu data