- 博客(43)
- 资源 (15)
- 收藏
- 关注
原创 Difference between plans obtained by CHOMP and OMPL
Optimizing planners optimize a cost function that may sometimes lead to surprising results: moving through a thin obstacle might be lower cost than a long, winding trajectory that avoids all collision...
2019-03-28 13:39:51
430
原创 Running OMPL as a pre-processor for CHOMP
<launch> <!-- OMPL Plugin for MoveIt! --> <arg name="planning_plugin" value="ompl_interface/OMPLPlanner" /> <!-- The request adapters (plugins) used when planning with OMP...
2019-03-28 13:39:04
576
2
原创 How to Calculate a Robot's Forward Kinematics in 5 Easy Steps
https://blog.robotiq.com/how-to-calculate-a-robots-forward-kinematics-in-5-easy-steps
2019-03-27 10:05:44
362
原创 Solution of Inverse Kinematics for 6R Robot Manipulators With Offset Wrist Based on Geometric Algebr
https://www.ncbi.nlm.nih.gov/pmc/articles/PMC3707203/
2019-03-27 10:05:11
288
原创 Kinematics: Why Robots Move Like They Do
https://blog.robotiq.com/kinematics-why-robots-move-like-they-do
2019-03-27 09:58:02
307
原创 How Can an Industrial Robot Be Calibrated?
https://blog.robotiq.com/bid/73064/How-Can-an-Industrial-Robot-Be-Calibrated讲到了机器人模型、标定、补偿
2019-03-27 09:50:14
215
原创 8 reasons why you should use ROS for robotics projects
8 reasons why you should use ROS for robotics projectsYou already know some programming and how to use a terminal, and you want to get into robotics. Or you are making the specs for an entire new ro...
2019-03-25 11:14:52
291
原创 pilz机械臂直线规划
bool TrajectoryGeneratorLIN::generate(const planning_interface::MotionPlanRequest &req, planning_interface::MotionPlanResponse &res, ...
2019-03-20 13:41:06
687
原创 手柄控制高斯机械臂
#!/usr/bin/env pythonimport rospy, actionlibfrom std_msgs.msg import Boolfrom sensor_msgs.msg import Joyfrom sensor_msgs.msg import JointStatefrom trajectory_msgs.msg import JointTrajectoryfr...
2019-03-19 15:55:33
1037
原创 高斯六轴机械臂画圆
#!/usr/bin/env python# Copyright (c) 2018 Pilz GmbH & Co. KG## This program is free software: you can redistribute it and/or modify# it under the terms of the GNU Lesser General Public Licens...
2019-03-19 15:33:53
2570
原创 cartographer_ros 命令行参数解析和日志打印
/* * Copyright 2016 The Cartographer Authors * * Licensed under the Apache License, Version 2.0 (the "License"); * you may not use this file except in compliance with the License. * You may obtai...
2019-03-19 09:28:29
1353
原创 树莓派_Linux串口编程_实现接收
recv.h#ifndef _RECV_H#define _RECV_H#include <stdio.h>#include <stdlib.h>#include <unistd.h>#include <string.h>#include <errno.h>#include <sys/types.h>#in...
2019-02-20 15:15:16
859
原创 树莓派使用wiringSerial
#include <stdio.h>#include <wiringPi.h>#include <wiringSerial.h> int main(){ int fd; if(wiringPiSetup()<0) return 1; if((fd=serialOpen("/dev/ttyAMA0",9600))<0) retur...
2019-02-20 15:12:56
2142
原创 plotclock代码
// Plotclock// cc - by Johannes Heberlein 2014// v 1.02// thingiverse.com/joo wiki.fablab-nuernberg.de// units: mm; microseconds; radians// origin: bottom left of drawing surface// time librar...
2019-02-18 16:54:14
1164
3
转载 line-us机械臂编程
import socketimport timeclass LineUs: """An example class to show how to use the Line-us API""" def __init__(self, line_us_name): self.__line_us = socket.socket(socket.AF_INET, so..
2019-02-15 15:03:15
1352
2
转载 Simple6DoFVer1.2.ino
/*Simple script to move my tiny 6dof robotic arm*/#include &lt;math.h&gt;#define PI 3.1415926535897932384626433832795//driver for the axis 1#define PUL1_PIN 39#define DIR1_PIN 37//driver for...
2019-02-13 10:34:18
530
转载 Simple6DoFVer2.ino
/*Simple script to move my tiny 6dof robotic arm*/#include &amp;lt;math.h&amp;gt;#define PI 3.1415926535897932384626433832795//driver for the axis 1#define PUL1_PIN 39#define DIR1_PIN 37//driver for...
2019-02-13 10:30:45
805
原创 python 发送blockly xml到blockly server,并产生python代码
#!/usr/bin/env pythonimport rospyimport subprocessimport socketimport osimport signalimport astHOST = '127.0.0.1'def cleanup_node_tcp_port(port_number): try: output = subprocess.check_...
2019-02-12 16:06:42
542
原创 执行blockly的python代码
class SequenceCodeExecutor: def __init__(self): self.blockly_dir = rospy.get_param("~sequence_code_to_execute_path") self.python_file = str(self.blockly_dir) + '/generated_code.py...
2019-02-12 15:32:29
1826
原创 blockly server 产生python代码
#!/usr/bin/env nodevar fs = require('fs');var net = require('net'); var Blockly = require('./gauss_python_generators').Blockly;Blockly.Python.STATEMENT_PREFIX = 'n.highlight_block(%1)\n';Block...
2019-02-12 15:24:22
1177
原创 获取gauss机械臂的当前状态
//获取当前参数 currentParameter = () =&gt; { let network = new Networking(); let sub = network.listen('/joint_states','sensor_msgs/JointState',(name , data) =&gt; { this.setState({ ...
2019-02-12 14:41:19
567
原创 gauss 机械臂示教模式切换
//示教模式切换 teaching = value => { this.setState({ teachStatus: value }); let status; if (value) { status = 1; } else { status = 0; } let network = new...
2019-02-12 14:38:05
670
原创 gauss 机械臂自动校准和手动校准
自动校准://零点校准 calibration = () =&gt; { let network = new Networking(); network.callService( "/gauss/calibrate_motors", "gauss_msgs/SetInt", { value: 1 }, ...
2019-02-12 14:34:47
1089
原创 通过rosbridge 修改 gauss 机械臂的末端工具
useActuator = (index) => { let indexNewForm = this.state.newForm[index] let network = new Networking(); let localStorage = new LocalStorage(); // 电磁铁,激光,直流电流(电磁铁...
2019-02-12 13:44:34
431
5
原创 欢迎使用优快云-markdown编辑器 模板
这里写自定义目录标题欢迎使用Markdown编辑器新的改变功能快捷键合理的创建标题,有助于目录的生成如何改变文本的样式插入链接与图片如何插入一段漂亮的代码片生成一个适合你的列表创建一个表格设定内容居中、居左、居右SmartyPants创建一个自定义列表如何创建一个注脚注释也是必不可少的KaTeX数学公式新的甘特图功能,丰富你的文章UML 图表FLowchart流程图导出与导入导出导入欢迎使用Ma...
2019-02-12 13:42:19
130
原创 通过rosbridge和roslibjs与 gauss 机械臂通信
let ROSLIB = require('roslib');import intl from 'react-intl-universal';import { isLegal } from './message.type'import { LocalStorage } from './localStorage'import { notification } from 'antd';le...
2019-02-12 11:59:42
2684
1
原创 rviz插件获取当前的执行进度代码
代码路径:moveit/moveit_ros/visualization/rviz_plugin_render_tools/src/trajectory_visualization.cppvoid TrajectoryVisualization::update(float wall_dt, float ros_dt){ if (drop_displaying_trajectory_) ...
2018-11-22 16:30:31
623
原创 gdb调试ros node
rosrun --prefix ‘gdb -ex run --args’ [package_name] [node_name]rosrun --prefix ‘gdb -ex run --args’ marm_planning moveit_obstacles_demo记得:catkin_make -DCMAKE_BUILD_TYPE=Debug如果你用roslaunch,在你的lau...
2018-10-31 09:27:43
1907
原创 用CMake编译OpenSplice的HelloWord项目
Build a OpenSplice HelloWorld project with CMakehttps://github.com/itfanr/opensplice-cpp-cmake设置环境变量编译和运行都需要终端的环境变量!环境变量很重要,必须首先设置!cd 到 x86_64.linux 目录,然后执行:source release.com查看环境变量:itfanr@...
2018-10-19 11:03:29
834
原创 已知两个坐标系下的坐标,求坐标系之间的转换矩阵(三)
#include <iostream>#include <GTEngine/Mathematics/GteConvertCoordinates.h>using namespace gte;int main(int argc, char const *argv[]){// // Affine change of basis. ConvertCoordinates...
2018-10-17 14:27:41
9889
5
原创 已知空间三个点画圆
https://www.geometrictools.com/GTEngine/Include/Mathematics/GteContScribeCircle3Sphere3.h
2018-10-17 14:02:09
2668
原创 已知两个坐标系下的坐标,求坐标系之间的转换矩阵(二)
包含平移和旋转变换:#include <iostream>#include <GTEngine/Mathematics/GteConvertCoordinates.h>using namespace gte;// #define Vector4<double> Vector<4, double>int main(int argc, cha...
2018-10-17 11:28:14
21963
8
原创 已知两个坐标系下的坐标,求坐标系之间的转换矩阵(一)
#include &amp;lt;iostream&amp;gt;#include &amp;lt;GTEngine/Mathematics/GteConvertCoordinates.h&amp;gt;using namespace gte;// #define Vector4&amp;lt;double&amp;gt; Vector&amp;lt;4, double&a
2018-10-17 10:48:16
29152
1
原创 GTEngine计算坐标变换
#include &lt;iostream&gt;#include &lt;GTEngine/Mathematics/GteConvertCoordinates.h&gt;using namespace gte;// #define Vector4&lt;double&gt; Vector&lt;4, double&gt;int main(int argc, char c
2018-10-16 16:19:33
930
原创 Eigen计算坐标系变换
#include &lt;vector&gt;#include &lt;Eigen/Geometry&gt;#include &lt;stdio.h&gt;#include &lt;iostream&gt;#define Scalar double Eigen::Transform&lt;Scalar, 3, Eigen::Affine&
2018-10-15 16:20:20
4170
原创 通过Eigen计算直线在不同坐标系统的转换
//////////////////////////////////////////////////////////////////////////////////////////template &lt;typename Scalar&gt; boolpcl::transformBetween2CoordinateSystems (const Eigen::Matrix&lt;Scalar,...
2018-10-15 11:17:55
1131
原创 boost::property_tree::ptree解析json数组
json数组如下:{&quot;var_name&quot;:&quot;var1&quot;,&quot;positions&quot;:[0.1,0.1,0.1,0.1,0.1,0.1]},;代码:#include &amp;lt;boost/property_tree/ptree.hpp&amp;gt;#include &amp;lt;boost/p
2018-10-10 13:07:47
5207
1
原创 从ros parameter server 获取URDF
// get the general robot description, the lwr class will take care of parsing what’s useful to itself std::string urdf_string = getURDF(lwr_nh, “/robot_description”);// Get the URDF XML from the ...
2018-09-12 12:47:16
411
折纸之光 折纸之光 折纸之光
2021-09-02
学派网2010-2014年职称英语_理工A_历年真题汇总.pdf
2020-03-08
Hall-LieGroupsLiealgebras2015.Springer.Elementaryintro.pdf
2020-03-08
Unity5.x完全自学手册.pdf
2020-03-08
Geometric Tools for Computer Graphics.pdf
2019-07-11
A General, Fast, and Robust Implementation of the Time-Optimal Path.pdf
2019-03-28
KUKA_FRI_from_WS_Proceedings_ICRA2010.pdf
2018-09-12
Universal_Robot_report.pdf
2018-09-10
面向直接示教的机器人零力控制-游有鹏.pdf
2018-09-10
空空如也
TA创建的收藏夹 TA关注的收藏夹
TA关注的人