自定义博客皮肤VIP专享

*博客头图:

格式为PNG、JPG,宽度*高度大于1920*100像素,不超过2MB,主视觉建议放在右侧,请参照线上博客头图

请上传大于1920*100像素的图片!

博客底图:

图片格式为PNG、JPG,不超过1MB,可上下左右平铺至整个背景

栏目图:

图片格式为PNG、JPG,图片宽度*高度为300*38像素,不超过0.5MB

主标题颜色:

RGB颜色,例如:#AFAFAF

Hover:

RGB颜色,例如:#AFAFAF

副标题颜色:

RGB颜色,例如:#AFAFAF

自定义博客皮肤

-+
  • 博客(36)
  • 资源 (81)
  • 收藏
  • 关注

转载 c++ 函数返回值为不确定类型

https://stackoverflow.com/questions/1358427/function-which-returns-an-unknown-type

2020-04-21 10:15:32 3203

转载 快速求根算法

//---Algorithm float(IEEE754)用------inline float t_sqrtF( const float& x ){float xHalf = 0.5f * x;int tmp = 0x5F3759DF - ( *(int*)&x >> 1 ); //initial guessfloat xRes = *(float...

2020-03-16 15:06:48 1114 1

转载 c++11随记:std::bind及 std::placeholders

原文链接:https://blog.csdn.net/weixin_43333380/article/details/82935291一 使用场景先将可调用的对象保存起来,在需要的时候再调用,是一种延迟计算的思想。不论是普通函数、函数对象、还是成员函数,成员变量都可以绑定,其中成员函数都可以绑定是相当灵活的。二 头文件定义于头文件#include <funct...

2019-08-15 09:46:28 400

转载 ROS-多回调队列-示例

来源:https://answers.ros.org/question/214629/multiple-callback-queues/#include <ros/spinner.h>#include <ros/callback_queue.h>#include <std_msgs/Header.h>#include <std_msgs/St...

2019-08-14 11:59:21 595

转载 ROS-判断master节点已启动

来源:Check master ros node is started C++ https://answers.ros.org/question/236678/check-master-ros-node-is-started-c/#include "ros/ros.h"#include <iostream>int main(int argc, char *argv[])...

2019-08-06 15:22:36 2039

转载 ROS 运动规划 (Motion Planning)

https://blog.csdn.net/improve100/article/details/50619925ROS 运动规划 (Motion Planning): MoveIt! 与 OMPLhttps://blog.csdn.net/yaked/article/details/45618877KUKA youbot机械臂与Moveit工具包(1)https://moveit...

2019-06-14 09:18:41 1009

转载 ROS开发环境之Qt Creator

https://blog.csdn.net/dxuehui/article/details/44647861ROS开发环境之Qt Creatorhttps://blog.csdn.net/zyh821351004/article/details/43672887Qtcreator 配置 ros工程:debug ros 程序https://askubuntu.com/question...

2019-06-14 09:13:41 249

转载 为什么3维旋转矩阵的行列式为+1?

参考文章:Evans, Philip R. "Rotations and rotation matrices." Acta Crystallographica Section D: Biological Crystallography 57.10 (2001): 1355-1359.文章链接:https://onlinelibrary.wiley.com/doi/pdf/10.1107/S09...

2019-02-28 15:35:38 3736

转载 const 指针与指向const的指针

转载自:http://www.cnblogs.com/lihuidashen/p/4378884.html最近在复习C++,指针这块真的是重难点,很久了也没有去理会,今晚好好总结一下const指针,好久没有写过博客了,记录一下~const指针的定义:  const指针是指针变量的值一经初始化,就不可以改变指向,初始化是必要的。其定义形式如下:type *const 指针名称; ...

2019-02-25 15:59:16 253

原创 I+α*xx'的逆为I-α/(1+α*x'x)*xx'

参考文献:Broyden, C. G. (1965). A class of methods for solving nonlinear simultaneous equations. Mathematics of computation, 19(92), 577-593.

2018-12-26 08:56:45 259

转载 三维旋转矩阵(包括任意轴的通用旋转矩阵、Euler角、单位四元数)的计算

转自:https://blog.csdn.net/deng_sai/article/details/21169997转自:http://hi.baidu.com/herohbc/item/4d20780de7726697a2df437f三维旋转矩阵的计算在三维空间中,旋转变换是最基本的变换类型之一,有多种描述方式,如Euler角、旋转矩阵、旋转轴/旋转角度、四元数等。本文将介绍各种描述...

2018-07-26 14:06:41 2009

转载 矩阵变换:沿任意轴旋转及其推导

来源:http://blog.csdn.net/zsq306650083/article/details/87739961. 2D中绕原点旋转设基向量p,q和r分别是朝向+x,+y和+z方向的单位向量。旋转角度为θ,基向量p,q绕原点旋转,得到新的基向量p`和q`即旋转矩阵R(θ)为2. 3d中绕坐标轴旋转01. 绕x轴旋转,基向量q和r旋转θ,得到新的基向量q`和r`即旋转矩阵Rx(θ)为:02...

2018-03-09 14:04:43 1006

转载 C++ 中将构造函数,析构函数声明为private,protected

来源:https://zhidao.baidu.com/question/151143551.html问:我看到有些程序中,将构造函数,析构函数声明为私有和保护的,那么对象如何创建?已经不能从外部调用构造函数了,但是对象必须被构造,应该如何解决,麻烦大家帮忙说明,关于构造,析构函数声明为私有和保护时的用法,谢谢了你提出这个问题,说明你已经对c++有所思考了。从语法上来讲,一个函数被声明

2018-01-05 15:35:51 496

转载 编译过程:预编译、编译、汇编与链接

原文地址:http://blog.csdn.net/u014120684/article/details/46352167预编译的文件扩展名是ii gcc -E hello.c -o hello.i 预编译过程主要处理源代码文件当中的以#开头的预编译指令,比如#include就是把头文件插入到这个位置 #define就是把所有的宏定义展开,还有就是删除所有的注释编译

2018-01-04 15:48:51 670

转载 计算机系统基础知识

http://www.wowotech.net/sort/basic_subject

2018-01-04 10:48:07 1162

转载 如何在makefile中指定所使用的编译器?

作者:匿名用户链接:https://www.zhihu.com/question/21020661/answer/16913820来源:知乎著作权归作者所有。商业转载请联系作者获得授权,非商业转载请注明出处。

2018-01-03 18:36:12 16567

转载 设A是m*n实矩阵,证明:R(A'A)=R(AA')=R(A)

来源:https://zhidao.baidu.com/question/305821710.html?qbl=relate_question_0&word=r%28A%29%3Dr%28A%A1%E4A%29这类问题可用证明齐次线性方程组同解的方法显然, AX=0 的解都是 A'AX=0 的解.反之, 若X1是 A'AX=0的解则 A'AX1=0所以 X1'A'AX1=0故 (AX1)'

2017-12-27 15:26:18 8276

原创 关于hough直线变换的一点说明

如果theta取值[-pi, pi],ρ取非负值,则实际上整个theta取值区间只有一半(正弦函数值非负的部分)是有效的,且取决于具体的坐标点;如果令ρ可取非负值,对任意给定的坐标点,theta取值可统一在[-pi/2, pi/2]。

2017-12-27 09:47:00 222

转载 二值图像连通域标记

来源: http://www.cnblogs.com/ronny/p/img_aly_01.html一、前言二值图像,顾名思义就是图像的亮度值只有两个状态:黑(0)和白(255)。二值图像在图像分析与识别中有着举足轻重的地位,因为其模式简单,对像素在空间上的关系有着极强的表现力。在实际应用中,很多图像的分析最终都转换为二值图像的分析,比如:医学图像分析、前景检测、字

2017-12-25 15:33:21 234

转载 reinterpret_cast的本质

先看看下面的代码:#include iostream> using namespace std;void main() {     int i = 875770417;     couti" ";    char* p = reinterpret_castchar*>(&i);    for(int j=0; j4; j++)        coutp[

2017-12-25 14:54:52 576

转载 强制类型转换原理

作者:pansz链接:https://www.zhihu.com/question/20482511/answer/15262336来源:知乎著作权归作者所有。商业转载请联系作者获得授权,非商业转载请注明出处。所谓强制转换,其实也分不同的类型。一个强制转换语句,在不同的场合下,有不同的含义。大体上来看,在 C 语言里面,强制类型转换有两种含义:1,将一个数据,复制为

2017-12-25 10:32:20 3720

转载 内存对齐

来源:http://blog.csdn.net/cc_net/article/details/2908600在网上看到内存对齐的知识,内存的是否对齐,会影响对象实际分配的内存大小和程序性能。关于内存分配和字节大小的关系,依稀接的在学校上计算机组成原理还是体系结构的时候老是讲过,其中提到过对齐的问题,不过书不在身边,无法找到详细的理论解释了,哈哈·~~ 实际内存对

2017-12-22 10:46:41 131

转载 RAM、ROM、FLASH的存储原理及区别

来源:http://blog.csdn.net/grow_mature/article/details/8554465一、RAM(Random Access Memory )随机存取存储器,主要作用是存储代码和数据供CPU 需要时调用。这些数据的存储并不像用袋子盛米那般,更像是图书馆中用有格子的书架存放书籍一样,不但要放进去还要能够在需要的时候准确的调用出来。对于RAM 等存储器原理类似,

2017-12-21 10:55:02 7457 1

转载 特征点匹配——SIFT算法详解

文章来源:http://blog.csdn.net/lhanchao/article/details/52345845之前在学习三维重建的过程中,了解过SIFT算法,现在老师要求详细的了解SIFT算法,看看能不能对它进行改进,于是又详细的看了一遍SIFT算法。记录一下。一、SIFT算法综述SIFT(Scale Invariant Feature Transform)全称

2017-11-30 14:44:49 6392

转载 Linux 静态库与共享库的使用

本文转载自:http://blog.csdn.net/heyabo/article/details/11688517?t=1479524323919申明: 正如题如示,本篇讲的是Linux下是静态库与共享库,而Window下的动态链接库详细情况可见这篇文章:windows动态链接库 DLL 浅析。虽然原理,思想差不多,但是细节却各有不同。一、静态库

2017-10-06 17:28:07 175

转载 CMake入门实践

http://www.hahack.com/codes/cmake/#donate_module写得不错

2017-09-15 17:50:21 176

转载 朱松纯:初探计算机视觉的三个源头_兼谈人工智能

来源:http://www.stat.ucla.edu/~sczhu/Blog_articles/正本清源:%20初探计算机视觉的三个源头_兼谈人工智能.pdf我觉得他讲的挺好,机器学习其实并没有本质上的创新,所用思想方法与以往并无根本区别,往往换个名字,不谈来历,大有改朝换代的意味,可能这也是学术圈的通病吧

2017-08-23 17:18:52 584

转载 STM32串口的基本用法

文章来源:http://blog.sina.com.cn/s/blog_8241d5d40102xej1.html前言:本来用不到串口,但在最近在读取传感器数据的时候数据发生了错误,被师兄推荐用串口来检查一下究竟读出的数据是什么,因此学习了串口的使用。事实证明,串口很有用,也没有想象中的那么复杂...一、关于串口需要了解的几个知识点:1.波特率:在串行通讯中,数据是按位进行

2017-08-20 14:54:17 372

转载 新手PID算法的改进(Arduino-PID-Library)

非常不错的内容,请参考以下网址:http://www.geek-workshop.com/thread-197-1-1.htmlhttp://brettbeauregard.com/blog/2011/04/improving-the-beginners-pid-introduction/

2017-07-24 15:27:36 2772

转载 ROS之catkin介绍(CMakeLists.txt 、package.xml)

http://docs.ros.org/jade/api/catkin/html/index.htmlhttp://docs.ros.org/hydro/api/catkin/html/howto/format2/building_msgs.html

2017-06-14 16:19:06 299

转载 pragma comment的使用 pragma预处理指令详解

来源:http://www.cnblogs.com/forlina/archive/2011/08/11/2134961.html#pragma comment( comment-type [,"commentstring"] )该宏放置一个注释到对象文件或者可执行文件。comment-type是一个预定义的标识符,指定注释的类型,应该是compiler,exest

2017-06-09 11:04:26 230

转载 undefined symbol error in gazebo

http://answers.gazebosim.org/question/12526/undefined-symbol-error-in-gazebo/undefined symbol error in gazebogazeboundefinedsymbolerrorasked Feb 5 '16

2017-06-01 17:50:01 937

转载 ROS消息时间同步

多传感器数据处理需要考虑消息同步,请参考:http://blog.csdn.net/zyh821351004/article/details/47758433http://blog.csdn.net/start_from_scratch/article/details/52337689

2017-05-19 17:06:32 1889

转载 ROS下如何用QT打开终端并执行roslaunch

参考:1.http://answers.ros.org/question/209090/how-to-launch-a-roslaunch-in-qt-with-a-terminal-gui/2. http://blog.csdn.net/zhuoyueljl/article/details/71699098尝试QProcess弄了很久也没成功,system按如下方式可成功执行:s

2017-05-12 10:46:19 1855

转载 Syrotek Course -ROS_CPP

https://syrotek.felk.cvut.cz/course/ROS_CPP_INTRO

2017-04-21 15:06:36 311

转载 A*算法介绍(链接)

http://theory.stanford.edu/~amitp/GameProgramming/AStarComparison.html

2017-03-27 16:36:12 230

深入理解并行编程(英文版)

经典书籍,值得收藏

2017-08-17

ARM® Cortex®-M3 Processor Technical Reference Manual

Cortex®-M3技术参考手册(英文)

2017-08-17

电路基础答案(亚历山大,英文第5版)

非常不错的资源,值得收藏

2017-08-11

STM32F10xxx手册

官方文档,值得收藏

2017-08-08

离散时间控制系统(尾形克彦)

一本不错的书,值得收藏

2017-07-19

现代控制工程(尾形克彦 英文第5版)

非常不错的书,值得收藏

2017-07-19

Robotics, Vision and Control -Matlab ToolBox

《Robotics, Vision and Control》一书对应的matlab工具箱,来源于作者Peter Corke的个人网页,受上传大小限制,没有包含images文件夹

2017-03-27

Probabilistic Robotics

经典书籍,值得收藏

2017-03-23

Principles of Robot Motion_ Theory, Algorithms, and Implementations-MIT (2005)

不错,值得收藏

2017-01-18

Accurate Visual Metrology from Single and Multiple Uncalibrated Images

不错的一本计算机视觉书籍,收藏

2017-01-16

Production Planning and Industrial Scheduling_ Examples, Case Studies

收藏

2016-10-28

Essays in Production & Project Planning and Scheduling

Essays in Production & Project Planning and Scheduling 收藏

2016-10-28

生产排程之启发式算法

生产排程之启发式算法

2016-10-28

生产排程之遗传算法

(Production and Logistics) Dr. Dirk C. Mattfeld (auth.)-Evolutionary Search and the Job Shop_ Investigations on Genetic Algorithms for Production Scheduling-Physica-Verlag Heidelberg (1996)

2016-10-28

Computer Explorations in Signals and Systems Using MATLAB (John R. Buck) (1997)

经典书籍,收藏

2016-10-08

Digital Signal Processing (Proakis) (4th Edition)

经典之作,收藏

2016-10-08

Applied Functional Analysis II (Eberhard Zeidler)

经典之作,收藏

2016-09-19

Microstrip Filters for RF Microwave Application

滤波器设计经典书籍,适合射频微波器件设计人员

2016-09-18

Modeling with Stochastic Programming (Stein W. Wallace)

Modeling with Stochastic Programming (Stein W. Wallace)

2016-08-31

Stochastic Programming (Andras Prekopa)

Stochastic Programming (Andras Prekopa)

2016-08-31

Three-Dimensional Rotation Matrices

一份非常不错的旋转矩阵性质讲义,内容涉及旋转矩阵的轴角表示、欧拉角表示以及旋转矩阵的相似变换的几何解释,可供计算机视觉、机器人、导航与测绘等工程技术人员参考

2020-12-18

Screw Theory and its Applications in Robotics

一份不错的螺旋理论ppt,适合机器人运动控制、运动规划与导航方面的专业技术人员阅读

2019-09-25

Geometry and Screw Theory for Robotics.pdf

in a variety of areas of robotics, the methods and formalisms based on the geometry and algebra of the screws, have proven to be superior to other techniques

2019-09-25

Time-of-Flight and Structured Light Depth Cameras

This book has been written for a wider audience, including students and practitioners interested in current consumer depth cameras and the data they provide. This book focuses on the system rather than the device and circuit aspects of the acquisition equipment. Processing methods required by the 3D nature of the data are presented within general frameworks purposely as independent as possible from the technological characteristics of the measurement instruments used to capture the data. The results are typically presented by practical exemplifications with real data to give the reader a clear and concrete idea about the actual processing possibilities. This book is organized into three parts, the first devoted to the working principles of ToF and structured light depth cameras, the second to the extraction of accurate 3D information from depth camera data through proper calibration and data fusion techniques, and the third to the use of 3D data in some challenging computer vision applications.

2019-02-28

quaternion kinematics for the error-state kalman filter

关于四元数的非常好的入门资料,从四元数的基本性质到惯性导航系统的误差状态方程,再到传感器数据的融合,介绍得非常详细,强烈推荐

2018-08-17

Naive Lie theory

The aim of this book is to carry it out—developing the central concepts and results of Lie theory by the simplest possible methods, mainly from single-variable calculus and linear algebra. Familiarity with elementary group theory is also desirable, but the author provides a crash course on the basics of group theory in Sections 2.1 and 2.2.

2018-03-16

Robot Motion Planning-Springer US (1991)

Motion planning is the central theme of this book. It can be loosely stated as follows: How can a robot decide what motions to perform in order to achieve goal arrangements of physical objects? This capability is eminently necessary since, by definition, a robot accomplishes tasks by moving in the real world.

2018-02-01

规划算法(英文)

Planning algorithms are impacting technical disciplines and industries around the world, including robotics, computer-aided design, manufacturing, computer graphics, aerospace applications, drug design, and protein folding. Written for computer scientists and engineers with interests in artificial intelligence, robotics, or control theory, this is the only book on this topic that tightly integrates a vast body of literature from several fields into a coherent source for teaching and reference in a wide variety of applications. Difficult mathematical material is explained through hundreds of examples and illustrations.

2018-02-01

机器人手册(英文第二版)

机器人领域的Bible。这本书涵盖了机器人领域的所有方面,以及最新进展。这对于了解机器人领域、选取研究方向有莫大的帮助

2018-02-01

几何方法与应用

Gallier offers an introduction to affine geometry, projective geometry, Euclidean geometry, basics of differential geometry and Lie groups, and a glimpse of computational geometry (convex sets, Voronoi diagrams and Delaunay triangulations) and explores many of the practical applications of geometry. Some of these applications include computer vision (camera calibration) efficient communication, error correcting codes, cryptography, motion interpolation, and robot kinematics. This comprehensive text covers most of the geometric background needed for conducting research in computer graphics, geometric modeling, computer vision, and robotics and as such will be of interest to a wide audience including computer scientists, mathematicians, and engineers.

2017-11-29

微分几何与李群讲义

Introduction to Manifolds and Lie Groups; Review of Groups and Group Actions; Manifolds; Construction of Manifolds From Gluing Data; Lie Groups, Lie Algebra, Exponential Map; The Derivative of exp and Dynkin's Formula; Bundles, Riemannian Metrics, Homogeneous Spaces; Differential Forms; Integration on Manifolds; Distributions and the Frobenius Theorem; Connections and Curvature in Vector Bundles; Geodesics on Riemannian Manifolds; Curvature in Riemannian Manifolds; etc.

2017-11-29

图像处理与分析-变分、偏微、小波与随机方法

This book is written for graduate students and researchers in applied mathematics, computer science, electrical engineering, and other disciplines who are interested in problems in imaging and computer vision. It can be used as a reference by scientists with specific tasks in image processing, as well as by researchers with a general interest in finding out about the latest advances.

2017-11-21

傅里叶变换及其应用(Ronald Bracewell 英文版)

本书是电子工程领域内的一本颇受读者欢迎的教材及专业参考书,介绍了傅理叶变换的方法及其在电气系统中的应用、包括电路、天线、信号处理器等领域,另外,还有在连接信号、脉冲序列和离散信号连接方面的应用。 本书具有以下特点:所有的数学内容都有图形说明;对连接及离散信号的处理进行了统一的介绍;列举了可自行操作的计算机代码及MATLAB实例;介绍了基本理论如何应用于光学、天线、干涉测量、统计、噪声、热学及半导体传播等领域;提供了大量的参考数据表。 本书不仅适合电类专业,同样适合机电信号、物探信号、生物医学信号处理以及物理等类专业的高年级本科生作为教材,也可作为研究生的参考教材和科技人员的自学参考书。

2017-11-21

Learning OpenCV 3(英文版)

相信不用多介绍,图像处理与计算视觉方面的必备书籍,本书用C++语言实现,包含了完整的openCV库,包括用于计算机视觉的机器学习

2017-09-06

C++并发与多线程

非常不错,值得收藏

2017-08-30

斯坦福课程-凸优化PPT

非常不错的资料,值得收藏

2017-08-28

Computer Vision Models, Learning, and Inference

计算机视觉入门经典

2017-08-24

Computer Vision Algorithms and Applications

经典书籍,值得收藏

2017-08-24

Computer vision A modern approach

经典书籍,值得收藏

2017-08-24

ARM C and C++ Libraries and Floating-Point Support

arm编程参考资料

2017-08-17

空空如也

TA创建的收藏夹 TA关注的收藏夹

TA关注的人

提示
确定要删除当前文章?
取消 删除