
机器人
小弧光
这个作者很懒,什么都没留下…
展开
-
从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 阅读 · 0 评论 -
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 评论 -
Simple6DoFVer1.2.ino
/*Simple script to move my tiny 6dof robotic arm*/#include <math.h>#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 阅读 · 0 评论 -
高斯六轴机械臂画圆
#!/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 阅读 · 0 评论 -
手柄控制高斯机械臂
#!/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 阅读 · 0 评论 -
pilz机械臂直线规划
bool TrajectoryGeneratorLIN::generate(const planning_interface::MotionPlanRequest &req, planning_interface::MotionPlanResponse &res, ...原创 2019-03-20 13:41:06 · 687 阅读 · 0 评论 -
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 阅读 · 0 评论 -
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 阅读 · 0 评论 -
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 阅读 · 0 评论 -
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 阅读 · 0 评论 -
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 阅读 · 0 评论 -
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 阅读 · 0 评论 -
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 阅读 · 0 评论 -
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 阅读 · 0 评论 -
获取gauss机械臂的当前状态
//获取当前参数 currentParameter = () => { let network = new Networking(); let sub = network.listen('/joint_states','sensor_msgs/JointState',(name , data) => { this.setState({ ...原创 2019-02-12 14:41:19 · 567 阅读 · 0 评论 -
KDL::ChainIdSolver_RNE gcSolver计算力矩
main.cpp文件:#include <kdl/chainfksolverpos_recursive.hpp>#include <kdl/chainidsolver_recursive_newton_euler.hpp>#include <kdl/tree.hpp>#include <kdl_parser/kdl_parser.hpp>...原创 2018-09-11 08:42:08 · 910 阅读 · 0 评论 -
已知两个坐标系下的坐标,求坐标系之间的转换矩阵(一)
#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 · 29153 阅读 · 1 评论 -
已知两个坐标系下的坐标,求坐标系之间的转换矩阵(三)
#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 · 9890 阅读 · 6 评论 -
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 阅读 · 0 评论 -
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 阅读 · 0 评论 -
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 评论 -
通过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 评论 -
通过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 评论 -
gauss 机械臂自动校准和手动校准
自动校准://零点校准 calibration = () =&gt; { let network = new Networking(); network.callService( "/gauss/calibrate_motors", "gauss_msgs/SetInt", { value: 1 }, ...原创 2019-02-12 14:34:47 · 1089 阅读 · 0 评论 -
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 阅读 · 0 评论 -
逆解常用公式
原创 2019-03-28 09:26:02 · 1303 阅读 · 0 评论