自定义博客皮肤VIP专享

*博客头图:

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

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

博客底图:

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

栏目图:

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

主标题颜色:

RGB颜色,例如:#AFAFAF

Hover:

RGB颜色,例如:#AFAFAF

副标题颜色:

RGB颜色,例如:#AFAFAF

自定义博客皮肤

-+
  • 博客(8)
  • 收藏
  • 关注

原创 ros_pointcloud2 转 pcl_pointcloud2 转pcl_xyz

#include <ros/ros.h>#include <sensor_msgs/PointCloud2.h>#include <pcl/point_cloud.h>#include <pcl/point_types.h>#include <pcl_conversions/pcl_conversions.h>#include <pcl/PCLPointCloud2.h>#include <pcl/conversio.

2020-09-02 14:46:44 1209

原创 ros机械臂获取当前位姿

#!/usr/bin/env python# -*- coding: utf-8 -*-import rospy, sysimport moveit_commanderfrom geometry_msgs.msg import Poseclass MoveItCartesianDemo: def __init__(self): # 初始化move_group的API moveit_commander.roscpp_initialize(sys.argv)...

2020-08-22 12:48:58 2291 2

原创 openwrt解除软件包安装限制

Openwrt解除验证限制sed -i 's/\tdetect_package/\t# detect_package/g' /koolshare/scripts/ks_tar_install.sh

2020-08-22 12:43:51 3296

原创 ubuntu开启桌面共享

安装dconf-editorsudo apt-get install dconf-editor用dconf-editor调整,配置路径如下org > gnome > desktop > remote-access取消钩选 “require-encryption”属性和"prompt-enabled"属性。

2020-08-22 12:41:57 1302

原创 ifm3d相机安装ros包简化脚本

#!/bin/bashmkdir ~/dev && cd dev ;git clone https://github.com/lovepark/ifm3d-ros.git ;mkdir -p ~/catkin/ifm3d/src && cd ~/catkin/ifm3d/src ;catkin_init_workspace &&ln -s ~/dev/ifm3d-ros ifm3d ;cd .. &&catkin_make -DC

2020-08-22 12:34:47 263

原创 ubuntu脚本启动多个launch文件

#!/bin/bashsource /opt/ros/kinetic/setup.shsource ~/ml_ws/devel/setup.bashgnome-terminal "ur5_gazebo" -x bash -c "roslaunch ur_gazebo ur5.launch;exec bash" &&ti1=`date +%s` ti2=`date +%s`i=$(($ti2 - $ti1 ))while [[ "$i" -ne "8" ]]do...

2020-08-22 12:33:04 972

原创 ubuntu 编译安装opencv源码

sudo apt-get install cmakesudo apt-get install build-essential libgtk2.0-dev libavcodec-dev libavformat-dev libjpeg-dev libswscale-dev libtiff5-devpkg-confighttps://opencv.org/releases/mkdir build&&cd buildsudo cmake -D CMAKE_BUILD_TYPE=Re.

2020-08-22 02:36:15 210

原创 pip安装tensorflow cpu

sudo apt-get install python-pipsudo apt-get install python-pip3sudo apt-get install python-devpip install tensorflow (python2.7,CPU)pip install tensorflow-gpu (python2.7,GPU)pip3 install tensorflow (python3.x,CPU)pip3 install tensorflow-gpu...

2020-08-21 09:53:14 1619

空空如也

空空如也

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

TA关注的人

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