
ROS 机器人 三维空间
文章平均质量分 50
彩云的笔记
一起编程去!!
展开
专栏收录文章
- 默认排序
- 最新发布
- 最早发布
- 最多阅读
- 最少阅读
-
TransportException: receive_once[/add_two_ints]: DeserializationError cannot deserialize
$ sudo apt-get install ros-kinetic-genpyser.py#!/usr/bin/env pythonfrom __future__ import print_functionfrom rospy_tutorials.srv import *import rospydef handle_add_two_ints(req): print( req) return req.a+req.bdef add_two_ints_...原创 2021-08-02 17:01:55 · 227 阅读 · 0 评论 -
转动惯量矩阵
长方体圆柱球体原创 2021-07-07 10:10:40 · 2896 阅读 · 0 评论 -
ros urdf link join中的origin关系
link原创 2021-06-18 11:50:36 · 561 阅读 · 0 评论 -
ros 常用命令
rosdep install --from-paths src --ignore-src -yrosbag record -a -x "(.*)/compressed(.*)"顺时针,逆时针 rostopic pub -r 5 /mavros/rc/override mavros_msgs/OverrideRCIn "channels: [1500, 1500, 1500, 1700, 1500, 1500, 1500, 1500]" rostopic pub /mavros/rc/..原创 2021-02-03 10:01:54 · 928 阅读 · 0 评论 -
apriltag_ros 坐标转换
将机载端相机坐标系下的表示 fly_p 转换为tag坐标系下的向量tag_p def tag_callback(self,data): # print len(data.detections ) # useid =-1 if len(data.detections )>0: q = data.detections[0].pose.pose.pose.orientation q ...原创 2021-02-01 15:38:34 · 1144 阅读 · 0 评论 -
gazebo publish pose
在GimbalSmall2dPlugin.cc 基础上修改origin https://github.com/khancyr/ardupilot_gazebo (fetch) public: transport::PublisherPtr pub,posepub; this->dataPtr->posepub = this->dataPtr->node->Advertise<gazebo::msgs::Pose>(std::stri...原创 2020-11-13 15:46:24 · 537 阅读 · 0 评论 -
gnome-terminal 提高开发效率 tab
gnome-terminal --tab -e "roslaunch /home/zhangym/pcl_robots_simulator/copter_usv_sim/usv_copter_close.launch "--tab -e "/home/zhangym/Desktop/ardupilot/Tools/autotest/sim_vehicle.py -v ArduCopter -L SHENZHEN -f gazebo-iris --console --map -I 0"--tab -...原创 2020-11-05 10:48:09 · 514 阅读 · 0 评论 -
gazebo publish
#!/usr/bin/env pythonimport socketimport structfrom sys import *from xml.dom import minidomimport request_pb2TCP_IP = '127.0.0.1'TCP_PORT = 50199BUFFER_SIZE = 1024models = {}################################################## Read the main .原创 2020-10-23 14:28:28 · 227 阅读 · 1 评论 -
仿真相机内参如何给出
有给出,实际上我们可以根据水平视场horizontal_fov来计算出来的,参考以下两个介绍:http://playerstage.sourceforge.net/wiki/GazeboProblemResolutionGuidehttps://answers.ros.org/question/12658/how-to-change-gazebo-gui-focal-lengthfov/即可以通过以下公式得到焦距:flength = (width/2)/tan(hfov/2)https://ww原创 2020-07-13 14:24:55 · 1738 阅读 · 4 评论 -
面试收货-halcon
HALCON是德国MVtec公司开发的一套完善的标准的机器视觉算法包,它节约了产品成本,缩短了软件开发周期。halcon:底层功能算法多,运算性能快,开发需要一定软件功底和图像处理理论手眼标定nao机器人NAO是世界上应用最广泛的人型机器人之一,具有25个自由度,100多个传感器,机载电脑,支持23国语言,支持远程控制,可实现完全编程。NAO在上海世博会期间入驻法国馆kaggle比赛经历...原创 2020-07-10 15:37:23 · 1502 阅读 · 0 评论 -
gazebo topic订阅
http://gazebosim.org/tutorials?tut=topics_subscribed&ver=1.9Tutorial: How to subscribe to gazebo topicsGazebo communicates on TCP/IP sockets, which allows separate programs to interface with Gazebo.Boost ASIOis used by Gazebo to manage th...原创 2020-07-10 12:06:12 · 1394 阅读 · 1 评论 -
gazebo urdf sdf 相互转换
https://zhuanlan.zhihu.com/p/129661375【ROS-Gazebo】SDF与URDF的相互转换小明工坊机甲电光大师 | Master of Machatronic1 人赞同了该文章前言这是一个系列小文章,主要介绍在ROS-Gazebo中如何更好地使用SDF格式建模与仿真。众所周知,URDF是ROS的原生支持格式,但在某些情况下(尤其是Gazebo仿真时),使用SDF格式会更加合理。鉴于中文网络上几乎没有成体系的SDF介绍博文,因此我将自己在硕士期间转载 2020-07-09 09:11:54 · 3173 阅读 · 0 评论 -
gazebo 插件
http://gazebosim.org/tutorials?tut=ros_gzpluginsPlugin TypesGazebo supportsseveral plugin types, and all of them can be connected to ROS, but only a few types can be referenced through a URDF file:ModelPlugins, to provide access to thephysics::Mode..原创 2020-06-09 09:13:14 · 1366 阅读 · 0 评论 -
ZED2 ROS
git clonehttps://github.com/stereolabs/zed-ros-wrapper.git~/rosws/src/zed-ros-wrapper$ git checkout v3.0.3/usr/local/zed$ cat zed-config-version.cmakeset(PACKAGE_VERSION "3.0.3")https://github.com/stereolabs/zed-ros-wrapperhttps://www.stereolabs...原创 2020-06-05 19:10:27 · 1430 阅读 · 0 评论 -
arducopter mavros sitl qgc 一起工作
~/Desktop/ardupilot/ArduCopter$ ../Tools/autotest/sim_vehicle.py --map --console --out=udp:0.0.0.0:14560 -v ArduCopter~$ "mavproxy.py" "--master" "tcp:127.0.0.1:5760" "--sitl" "127.0.0.1:5501" "--out" "127.0.0.1:14550" "--out" "127.0.0.1:14551" "--map" "-原创 2020-05-13 17:09:16 · 555 阅读 · 0 评论 -
ardupilot_gazebo 初次运行
Unable to download model[model://iris_with_ardupilot]https://ardupilot.org/dev/docs/using-gazebo-simulator-with-sitl.html#using-gazebo-simulator-with-sitl今天跑了这页。git clone https://github.com/khancyr/ardupilot_gazebo cd ardupilot_gazebo/ git chec...原创 2020-05-12 17:32:19 · 620 阅读 · 0 评论 -
gazebo9降级到gazebo7
$ sudo apt-get remove gazebo9$ sudo apt-get install libignition-math2 libsdformat4$ sudo apt-get install ros-kinetic-gazebo7*$ sudo apt-get install libgazebo7sudo sh -c 'echo "deb http://packages.osrfoundation.org/gazebo/ubuntu-stable `lsb_relea...原创 2020-05-11 11:42:01 · 1496 阅读 · 0 评论 -
ArduSub SITL Ubuntu mavros环境搭建
第一章 ArduSub SITL Ubuntu环境搭建作者:张玉梅 [email protected].安装过程第一步:http://ardupilot.org/dev/docs/building-setup-linux.html#building-setup-linuxSetting up the Build Environment (Linux/Ubuntu)如果已经有git...原创 2020-04-29 11:51:23 · 1793 阅读 · 0 评论 -
pixhawk连接到nvidia xavier
mavproxy.param--master=/dev/ttyACM0,115200--load-module='GPSInput,DepthOutput'--source-system=200--cmd="set heartbeat 0"--out udpin:localhost:9000--out udpbcast:192.168.2.255:14550--out ...原创 2020-04-23 11:47:23 · 1759 阅读 · 1 评论 -
gazebo升级 ‘Any’ is not a member of ‘gazebo::msgs’
sudo sh -c 'echo "deb http://packages.osrfoundation.org/gazebo/ubuntu-stable `lsb_release -cs` main" > /etc/apt/sources.list.d/gazebo-stable.list'wget http://packages.osrfoundation.org/gazebo.key ...原创 2020-03-30 14:24:45 · 782 阅读 · 0 评论 -
ROS rviz gazebo No transform from [left_leg] to [base_link]
当出现这种现象时,是因为joint_state_publisher没有启动。在launch中添加joint_state_publisher 和robot_state_publisher会正常。<launch> <!-- these are the arguments you can pass this launch file, for example paus...原创 2020-02-28 10:53:55 · 2252 阅读 · 0 评论 -
gazebo urdf 在gazebo中的显示
给每个link都添加<collision><inertia>如果joint type="fixed"则默认在gazebo中不显示。<?xml version="1.0"?><robot name="materials" xmlns:xacro="http://ros.org/wiki/xacro"> <xacro:mac...原创 2020-02-25 17:01:39 · 1155 阅读 · 0 评论 -
rosbag 使用大全
<launch><node pkg="rosbag" type="play" args="--clock /home/zhangym/Bag/usblnode.bag" name="rosbag" output="screen" /><node pkg="usbl" type="usblbag.py" name="usblbag" output="screen...原创 2020-01-16 14:52:22 · 1066 阅读 · 0 评论 -
ubuntu 18 安装roboware
$ sudo apt-get install libgconf-2-4$ sudo dpkg -i roboware-studio_1.2.0-1524709819_amd64.deb原创 2019-12-11 15:01:30 · 1369 阅读 · 0 评论 -
NVIDIA Jetson AGX Xavier ROS
NVIDIA L4T 32.2.3 supports Jetson AGX Xavier series, Jetson TX2 series, Jetson TX1, and Jetson Nano. It is included as part ofJetPack 4.2.3and includes a reference filesystem derived from Ubuntu 18....原创 2019-11-21 14:56:40 · 1715 阅读 · 0 评论 -
开源飞控 mavlink mavros ardupilot -----mavlink部分代码分析
https://mavlink.io/en/messages/common.html#mav_commands手柄协议 MANUAL_CONTROLSET_MODERC_CHANNELS_OVERRIDE...在固件代码中https://github.com/ArduPilot/ardupilot/blob/master/ArduSub/GCS_Mavlink.cppGCS_Mavli...原创 2019-11-14 16:16:08 · 1135 阅读 · 0 评论 -
ar_track_alvar
http://wiki.ros.org/ar_track_alvarhttps://github.com/ros-perception/ar_track_alvarOverviewThis package is a ROS wrapper forAlvar, an open source AR tag tracking library.ar_track_alvar has 4 m...转载 2019-10-28 10:08:00 · 4198 阅读 · 0 评论 -
fatal error: ignition/math/Inertial.hh: No such file or directory
gazebofatal error: ignition/math/Inertial.hh: No such file or directorysudo apt-get install libignition-math2-dev转载 2019-10-22 11:44:13 · 749 阅读 · 0 评论 -
uuv_simulator
https://uuvsimulator.github.io/packages/uuv_simulator/docs/tutorials/disturbances/2019-07-18 10:30:29,701 | ERROR | dp_controller_local_planner | Invalid waypoint file 2019-07-18 10:31:35,073 |...原创 2019-07-18 10:44:32 · 2823 阅读 · 2 评论 -
ros opencv error cv_bridge exception
cv_bridge exception: [8UC3] and [32FC1] do not have the same number of channelcv_bridge exception: [8UC3] and [32FC1] do not have the same number of channelcv_bridge exception: [mono8] is a ...原创 2019-07-04 15:12:55 · 2818 阅读 · 0 评论 -
'ascii' codec can't decode byte ros
'ascii' codec can't decode byte 0xe7 in position 8: ordinal not in range(128)The traceback for the exception was written to the log fileros 发生这种错误,一般是因为路径名字中有中文导致。解决方法就是,不要用中文名字。...原创 2019-07-03 19:31:31 · 1165 阅读 · 0 评论 -
rosbag code API
http://wiki.ros.org/rosbag/Code%20APIhttps://github.com/sofiathefirst/imagesCpp/tree/master/bagdemo_ros_img$catkin_create_pkg bagdemo roscpp rospy rosbag std_msgs geometry_msgswritebag.cpp...原创 2019-07-03 17:35:41 · 950 阅读 · 0 评论 -
Eclipse构建ROS开发环境
https://blog.csdn.net/jinking01/article/details/80372445哈哈,好了。$catkin_make --force-cmake -G"Eclipse CDT4 - Unix Makefiles" -DCMAKE_BUILD_TYPE=Debug -DCMAKE_ECLIPSE_MAKE_ARGUMENTS=-j8...原创 2019-05-06 10:51:39 · 415 阅读 · 0 评论 -
kobuki 源码阅读
目 录第1章 kobuki源码 21.1 kobuki协议的网址: 21.1.1 协议相关接口 21.1.2 串口通信的核心代码: 2第2章 Move_base源码 3第3章 Nodelets 43.1 Bumper2PcNodelet 43.2 SafetyControllerNodelet代码关系 53.3 键盘控制 63.4 话题关系 63.原创 2016-12-28 20:18:10 · 2898 阅读 · 0 评论 -
Quaternion to angular velocity. 四元数 角速度
原创 2016-12-19 12:37:12 · 4920 阅读 · 2 评论 -
ROS Native Compilation
https://wiki.gumstix.com/index.php?title=ROSROS Native CompilationGet all libraries and tools$ sudo apt-get install python-pip build-essential python-yaml cmake subversion wget python-se转载 2016-02-23 10:51:09 · 857 阅读 · 0 评论 -
mavros ArduSub SITL Ubuntu环境搭建
ArduSub SITL Ubuntu环境搭建第一步:http://ardupilot.org/dev/docs/building-setup-linux.html#building-setup-linuxSetting up the Build Environment (Linux/Ubuntu)如果已经有git了。可以忽略页面中git相关的步骤。git clone https://...原创 2019-07-31 16:37:11 · 948 阅读 · 0 评论 -
urdf tools
zhangym@zhangym:~/catws/eca_a9/eca_a9_description/robots$ rosrun xacro xacro.py eca_a9_default.urdf.xacro -o a.urdfzhangym@zhangym:~/catws/eca_a9/eca_a9_description/robots$ urdf_to_graphiz a.urdf...原创 2019-07-23 11:08:32 · 258 阅读 · 0 评论 -
rosbag
rosbag基本使用bag实际上是将一个node的行为录制下来,然后可以重新播放 使用命令行能够:录制,从包重新发布,获取包的概括信息,检查包的消息类型,使用Python表达式过滤包中信息,压缩解压缩包,重新索引包 如果录制高带宽的东西,例如图像信息,建议在本地录制和存放文件 bag文件默认名字为日期,可以添加前缀 基本命令包括 record:制定主题来录制 rosbag re...转载 2019-09-26 16:03:03 · 696 阅读 · 0 评论 -
坐标系 旋转矩阵基础知识回顾
坐标系介绍使用OPENCV中的ArUco Marker Detection相关库函数cv::aruco::estimatePoseSingleMarkers(corner, marker_len,cameraMatrix, distCoeffs, rvecs, tvecs);。定位结果。Rvecs代表姿态(camera 坐标系到marker坐标系的变换,camera 坐标系是参考坐标系), t...原创 2019-09-06 10:26:59 · 1582 阅读 · 0 评论