
机器人编程
机器人编程 ROS
二分掌柜的
二分掌柜的
展开
-
ROS2的安装
ROS2的安装flyfish环境:Ubuntu Bionic(18.04 LTS)ROS 2 Bouncy安装官网的步骤一步一步来对应关系Ubuntu 16.04中使用ROS1 Kinetic,ROS 2 ArdentUbuntu 18.04中使用ROS1 Melodic,ROS 2 Bouncy要安装Debian软件包,你需要在你自己的apt软件源列表中添加我们的软件源。首先...原创 2018-10-18 17:45:53 · 1810 阅读 · 1 评论 -
Ubuntu下grpc的费时费力的编译方法
Ubuntu下grpc的费时费力的编译方法flyfish按照官网教程,文件下载不了 为了方便,将grpc所需文件以上传 下载地址进行以下操作手工下载 所需的第三方文件 第三方文件夹在 grpc/third_party 把下载的源码放到third_party中各自的目录 下载grpc依赖库: github上的文件以zip的方式下载 https://github.com/...原创 2018-07-31 17:56:23 · 3302 阅读 · 2 评论 -
机器人 保存点云PCD文件去除nan值
机器人 保存点云PCD文件去除nan值flyfish原始保存例如回调函数void point_cloud_callback(const sensor_msgs::PointCloud2::ConstPtr &input){ pcl::PointCloud<pcl::PointXYZ> cloud_file; pcl::fromROSMsg(*input, ...原创 2018-12-29 18:15:01 · 1313 阅读 · 0 评论 -
以Listener和Talker为例ROS1和ROS2代码对比
以Listener和Talker为例ROS1和ROS2代码对比flyfish环境Ubuntu 18.04ROS 1 MelodicROS 2 Bouncy使用命令创建包ros2 pkg create mypkg --cpp-node-name my_node自动创建文件package.xml<?xml version="1.0"?><?xml-model ...原创 2018-10-19 18:25:25 · 1760 阅读 · 0 评论 -
Qt执行ROS命令
Qt执行ROS命令flyifsh以ROS1 kinetic为例echo OK输出OK执行完终端退出的方式system("gnome-terminal -x bash -c 'echo OK' ");执行完终端按回车再退出system("gnome-terminal -x bash -c 'echo 'OK'; read' ");以ROS1的方式调用为例std::string...原创 2018-11-21 17:46:53 · 1142 阅读 · 2 评论 -
机器人 坐标
机器人 坐标图片部分来自wiki一个点如果只在一维的轴上 只有一个数值一个点如果在二维的平面上,那么它有两个值 X轴的坐标,Y轴的坐标一个点如果在三维的立体空间中,那么它有三个值 X轴的坐标,Y轴的坐标,Z轴的坐标视觉中的坐标系包括世界坐标系相机坐标系图像物理坐标系图像像素坐标系坐标系名称表示原点单位世界坐标系Ow(Xw,Yw,Zw)自定义m...原创 2019-01-03 18:32:49 · 1780 阅读 · 0 评论 -
机器人 机械臂右手定则
机器人 机械臂右手定则flyfish图片部分 来自wikix轴的正方向,红色Ry轴的正方向,绿色Gz轴的正方向,蓝色Bx表示在X轴方向上的平移y表示在Y轴方向上的平移z表示在Z轴方向上的平移rx表示在X轴方向的旋转ry表示在Y轴方向的旋转rz表示在Z轴方向的旋转右手握住的方向是z轴旋转的正方向 (+)顺序:平移x,平移y,平移z,旋转rx,旋转ry,旋转r...原创 2019-01-08 18:38:10 · 14993 阅读 · 0 评论 -
机器人 Grasp Pose Detection (GPD) 移除平面
机器人 Grasp Pose Detection (GPD) 移除平面flyfish使用了点云分割RanSaC 算法 随机采样一致(Random sample consensus)KD树std::vector<cv::Mat> Learning::createImages(const CloudCamera& cloud_cam, const std::vector&...原创 2019-01-04 18:52:22 · 1132 阅读 · 0 评论 -
ros1与ros2之间自定义类型的多机通信
ros1与ros2之间自定义类型的多机通信flyfish以自定义srv类型为例环境如下机器1Ubuntu16.04ROS1_bridgeROS1 KineticROS2 Bouncy机器2Ubuntu18.04ROS2 Bouncy注意:ardent 版本和bouncy版本之间通信不兼容,测试时没有通过对于自定义的类型ROS1_bridge必须用源代码重新编译,编译过程...原创 2018-10-30 18:08:12 · 2835 阅读 · 0 评论 -
机器人 Grasp Pose Detection (GPD) 更改 get_grasps.py问题
机器人 Grasp Pose Detection (GPD) 更改 get_grasps.py问题flyfish更该源文件,使其可运行import rospy#from grasp_candidates_classifier.msg import GraspConfigListfrom gpd.msg import GraspConfigListgrasps = []def c...原创 2019-01-07 19:22:24 · 671 阅读 · 0 评论 -
机器人 抓取 Grasp Pose Detection (GPD) grasp类型转ROS的标准pose
机器人 抓取 Grasp Pose Detection (GPD) grasp类型转ROS的标准poseflyfish问题 :原格式包含众多的Position,Orientation 是三个向量,应该怎么用哪个?# This message describes a 2-finger grasp configuration by its 6-DOF pose, # consisting of...原创 2019-01-10 18:09:38 · 2435 阅读 · 5 评论 -
ROS的抓取姿态检测
ROS的抓取姿态检测flyfish环境ROS KineticUbuntu 16.04方法1agile_grasp参考论文是&lt;&lt;Using Geometry to Detect Grasp Poses in 3D Point Clouds&gt;&gt;Andreas ten Pas and Robert Platt参考网址是http://wiki.ros.org/...原创 2018-12-13 18:14:30 · 4363 阅读 · 0 评论 -
机器人 避障规划
机器人 避障规划flyfish#include <ros/ros.h>#include <moveit/robot_model_loader/robot_model_loader.h>#include <moveit/planning_scene/planning_scene.h>#include <moveit/kinematic_cons...原创 2018-07-31 08:23:23 · 2500 阅读 · 0 评论 -
ROS MoveIt的同步和异步
ROS MoveIt的同步和异步flyfish当调用MoveIt的同步运动或者异步运动异步:asyncMove同步:movemove_group_interface.cppmoveit::planning_interface::MoveItErrorCode moveit::planning_interface::MoveGroupInterface::asyncMove(){ ...原创 2018-10-25 17:48:44 · 1280 阅读 · 0 评论 -
机器人 关于空间规划由python代码转换到C++代码
机器人 关于空间规划由python代码转换到C++代码flyfishROS 原文的空间规划是这样的 moveit_fk_demo.py#!/usr/bin/env python# -*- coding: utf-8 -*-import rospy, sysimport moveit_commanderfrom control_msgs.msg import Gripp...原创 2018-07-21 09:44:40 · 991 阅读 · 0 评论 -
ROS 编译 moveit::planning_interface::MoveItErrorCode to bool 错误
ROS 编译 moveit::planning_interface::MoveItErrorCode to bool 错误flyfish环境 Ubuntu 16.04 ,ROS Kinetic错误信息如下/home/pumpkinking/catkin_ws/src/pick-place-robot/kuka_arm/src/trajectory_sampler.cpp: In cons...原创 2018-12-20 18:38:10 · 1931 阅读 · 0 评论 -
机器人 以expo_marker_red为例抓取姿态的生成
机器人 以expo_marker_red为例抓取姿态的生成flyfish源码地址https://github.com/atenpas/gpg生成条件是 6-DOF grasp poses for a 2-finger grasp$ git clone https://github.com/atenpas/gpg.git整个编译过程如下生成项目$ cd grasp_candidate...原创 2018-12-17 17:56:24 · 903 阅读 · 2 评论 -
机器人 四元数 与 欧拉角 的相互转换
机器人 四元数 与 欧拉角 的相互转换flyfish先看说明 Constructs and initializes the quaternion w+xi+yj+zk from its four coefficients w, x, y and z. warning Note the order of the arguments: the real w coefficient ...原创 2018-08-13 18:09:23 · 6911 阅读 · 0 评论 -
机器人 ROS 与点云PCL的结合
机器人 ROS 与点云PCL的结合flyfish以StatisticalOutlierRemoval为例 说明官网提供的例子,对官网的例子进行改造#include <iostream>#include <pcl/io/pcd_io.h>#include <pcl/point_types.h>#include <pcl/filters/stat...原创 2018-12-29 18:11:46 · 1002 阅读 · 0 评论 -
Ubuntu下的机器人开发
Ubuntu下的机器人开发flyfish主要是ROS1 执行python文件需要注意的地方 rosrun marm_planning moveit_fk_demo.py py文件需要权限可以右键选择文件访问:读写 执行:勾选允许作为程序执行文件2 拷贝文件需要权限时sudo nautilus在这里进行文件操作3 编译时std没有某个函数时 C++11版本才...原创 2018-07-21 09:34:44 · 2714 阅读 · 1 评论 -
ROS action 以类的方式编写
ROS action 以类的方式编写flyfish普通用法 1 #include <chores/DoDishesAction.h> // Note: "Action" is appended 2 #include <actionlib/client/simple_action_client.h> 3 4 typedef actionlib::...原创 2018-10-09 17:55:01 · 927 阅读 · 0 评论 -
ros1_bridge 编译的一个问题
ros1_bridge 编译的一个问题flyfish错误提示如下In file included from ros2code/ros1_bridge/build/ros1_bridge/generated/get_factory.cpp:3:0:ros2code/ros1_bridge/include/ros1_bridge/factory.hpp: In static member fu...原创 2018-11-21 18:17:07 · 899 阅读 · 0 评论 -
ROS 常用命令
ROS 安装包flyfish版本Ubuntu16.04 Kinetic1 move_base_msgssudo apt-get install ros-kinetic-navigation2 dynamixel_msgssudo apt-get install ros-kinetic-dynamixel-controllers ros-kinetic-dynamixel-drive...原创 2018-12-18 18:19:07 · 1169 阅读 · 0 评论 -
机器人 Grasp Pose Detection (GPD) 源码编译问题
机器人 Grasp Pose Detection (GPD) 源码编译问题flyfish错误1CMake Error at CMakeLists.txt:11 (find_package): By not providing "FindPCL.cmake" in CMAKE_MODULE_PATH this project has asked CMake to find a pack...原创 2018-12-17 17:55:58 · 1825 阅读 · 1 评论 -
机器人 Grasp Pose Detection (GPD) 工作空间的设置
机器人 Grasp Pose Detection (GPD) 工作空间的设置目的:只抓取在工作空间的物体环境 Ubuntu 16.04ROS Kinetic假设运行的roslaunch astra_launch astra.launchrosrun rviz rviz(加载openni2.rviz)roslaunch gpd tutorial1.launch相机坐标 以人眼的举例...原创 2019-01-04 18:45:07 · 1750 阅读 · 0 评论 -
机器人 笛卡尔运动规划
机器人 笛卡尔运动规划flyfish#include <ros/ros.h>// 包含moveit的API#include <moveit/robot_model_loader/robot_model_loader.h>#include <moveit/planning_scene/planning_scene.h>#include <mo...原创 2018-07-24 18:11:04 · 5637 阅读 · 1 评论 -
机器人 Grasp Pose Detection (GPD) 添加OpenCV需要注意的问题
机器人 Grasp Pose Detection (GPD) 添加OpenCV需要注意的问题flyfishCMakeFiles/gpd_get_grasps.dir/src/interface/get_grasps.cpp.o:在函数‘cv::operator<<(std::ostream&, cv::Mat const&) [clone .constprop.57...原创 2019-01-04 18:42:45 · 1728 阅读 · 0 评论 -
机器人 已知关节位置的位置、速度、加速度求力矩
机器人已知关节位置的位置、速度、加速度求力矩flyfish力矩的wiki解释: 在物理学里,作用力促使物体绕着转动轴或支点转动的趋向,称为力矩(torque),也就是扭转的力。转动力矩又称为转矩。力矩能够使物体改变其旋转运动。推挤或拖拉涉及到作用力 ,而扭转则涉及到力矩。简略地说,力矩是一种施加于好像螺栓或飞轮一类的物体的扭转力。例如,用扳手的开口箝紧螺栓或螺帽,然后转动扳手,这动作...原创 2018-09-11 18:23:37 · 8026 阅读 · 0 评论 -
机器人 Grasp Pose Detection (GPD) select_grasp.py 问题
机器人 Grasp Pose Detection (GPD) select_grasp.py 问题flyfish问题描述python santiago_select_grasp.py [ERROR] [1546838582.884550]: bad callback: <function cloudCallback at 0x7f08de6d4938>Traceback (m...原创 2019-01-07 19:24:35 · 967 阅读 · 0 评论 -
ROS 编译代码过程中遇到的Protocol Buffer版本问题
ROS 编译代码过程中遇到的Protocol Buffer版本问题flyfish版本 Ubuntu16.04 , Kinetic,Gazebo7现象现象/usr/include/gazebo-7/gazebo/msgs/color.pb.h:17:2: error: #error This file was generated by an older version of protoc ...原创 2018-12-19 18:04:37 · 2867 阅读 · 0 评论 -
ros1和ro2 之间的通信
ros1和ro2 通信之间的通信flyfish环境Ubuntu 18.04ROS 1 MelodicROS 2 Bouncy都安装到同一台机器所以设置环境变量会有如下命令source /opt/ros/bouncy/setup.bash source /opt/ros/melodic/setup.bash启动4个终端Terminal 0$ roscoreTermi...原创 2018-10-19 18:29:01 · 1249 阅读 · 0 评论 -
平面坐标系变换
平面坐标系变换flyfishx′=xcosθ+ysinθx&#x27; = x \cos \theta + y \sin \theta x′=xcosθ+ysinθy′=−xsinθ+ycosθy&#x27; = - x \sin \theta + y \cos \theta y′=−xsinθ+ycosθ矩阵形式(x′y′)=(cosθsinθ−sin...原创 2018-11-14 18:44:38 · 4966 阅读 · 0 评论