ROS融合IMU笔记】的更多相关文章

ROS官网有一个叫robot_pose_ekf的包,是专门处理传感器融合的包,具体介绍:http://wiki.ros.org/robot_pose_ekf 其中主要功能是订阅主题包括odom(里程计).imu_data(姿态传感器).vo(视觉里程计)输入,三者或是其中两者融合后,输出合成的里程计主题odom_combined并发布出去.第二是提供一个TF变化. 配置文件如下和注释如下: <launch> <node pkg="robot_pose_ekf" typ…
摘要 在我的想象中机器人首先应该能自由的走来走去,然后应该能流利的与主人对话.朝着这个理想,我准备设计一个能自由行走,并且可以与人语音对话的机器人.实现的关键是让机器人能通过传感器感知周围环境,并通过机器人大脑处理并输出反馈和执行动作.本章节涉及到的传感器有激光雷达.IMU.轮式里程计.麦克风.音响.摄像头,和用于处理信息的嵌入式主板.关于传感器的ROS驱动程序开发和在机器人上的使用在后面的章节会展开,本章节重点对机器人传感器和嵌入式主板进行讲解,主要内容: 1.ydlidar-x4激光雷达 2…
ROS进阶学习笔记(11)- Turtlebot Navigation and SLAM - 2 - MapModify地图修改 We can use gmapping model to generate the map file: **.pgm and **.amcl, the latter is just a refer to the **.pgm map file. Here I introduce how to use the image editor "" to modify…
#!/usr/bin/env python # -*- coding: utf- -*- import rospy import math from sensor_msgs.msg import Imu from geometry_msgs.msg import Pose, Quaternion,PoseWithCovarianceStamped import PyKDL def quat_to_angle(quat): rot = PyKDL.Rotation.Quaternion(quat.…
首先,致谢易科(ExBot)和ROSWiki中文社区. 重要参考文献: Running ROS across multiple machines http://wiki.ros.org/ROS/Tutorials/MultipleMachines ARM端和PC端ROS通讯 http://www.roswiki.com/read.php?tid=312&fid=9 首先,配置主PC机(master): 修改IP地址等, $ hostname  //可以查看主机名 $ hostname rosxx…
一.程序更改的思路(参考svo_ros的做法): 1.在ROS下将pl-svo链接成库需要更改相应的CMakeLists.txt文件,添加package.xml文件: 2.注册一个ROS节点使用svo那个ATAN的数据集测试pl-svo: 3.显示部分也是参考svo_ros(visualizer.cpp)并进行相应简化(不必链接成库): 4.程序运行时参数要改(亲测svo的两个参数文件(vo_accurate.yaml,vo_fast.yaml)并不适用于pl-svo,不知道如何选择参数,使用的…
Combine Subscriber and Publisher in Python, ROS This article will describe an example of Combining Subscriber and Publisher in Python in ROS programming. This is very useful in ROS development. We will also discuss briefly how to build and modify a c…
Communication with ROS through USART Serial Port We always need to communicate with ROS through serial port as we have many devices like sensors, touch-screen, actuators to be controlled through USART serial protocol. After some investigation, I foun…
(写在前面: 这里参考rbx书中第八章和ROS社区教程进行学习,先看社区教程) ===  Doing the Turtlebot Navigation   === ref ros wiki: http://wiki.ros.org/turtlebot_navigation/Tutorials 1. Create the Data under remote control Referring the RBX book(8.4.2 Collecting and Recording Scan Data…
用interactive_makers控制Turtlebot移动 interactive_makers 是Willow Garage公司开发的一个虚拟控制工具,可通过鼠标在虚拟环境中的操作,完成实际机器人运动的拖动运动控制. 参考: ref1:   http://wiki.ros.org/turtlebot_interactive_markers/Tutorials/UsingTurtlebotInteractiveMarkers (groovy version)    === rvizTuto…