ROS.Taiwan 造訪社團 » PC

原文網址 Kai Chiu
2020-01-15 17:29:17

各位前輩好
最近想要購入一台移動平台來開發相關應用

找到預算與功能比較相似的為iRobot create2
並使用小PC走ROS與其溝通

但是因為此款時間相對來說出的時間已太久
找不太到購買點

想請問板上有沒有前輩知道還有哪邊可以購買
或是有更適合開發平台可以推薦的

(預算大約為1W上下 並因為要核銷是需要發票的)

感激不盡

張合中
2020-01-15 19:48:19

直接買台掃地機器人拆了做就好。

Brian Yang
2020-01-16 00:06:23

請洽iCshop ?

蔡宗廷
2020-01-16 00:07:36


原文網址 Yuhong Lin
2019-06-04 19:36:29

[ROS Developers LIVE class] #60: Python for Robotics
https://youtu.be/8ehPWJ2HdPc
Python is a good programming language for robotics. However many roboticists do not know the basics of it. In this class, you will see the basics of Python, directly applying the Python programs to ROS robots.

LIVE on June 4 at 6pm CEST.

翻譯年糕


原文網址 鄭小隆
2018-10-02 14:08:58

請問各位大大,稍微敘述一下我的硬體:
1.ROS kinetic(PC)
2.Arduino uno(作為馬達訊號控制用)
3.L298n(馬達驅動板)
4.12v Dc Motor以及車體
我利用arduino軟體測試作動正常,不過用ROS啟動ROS arduino bridge功能包裡面的ROS arduino python的arduino(launch),但是我另開啟終端器輸入$rostopic pub -1 /cmd_vel geometry_msgs/Twist ‘{angular: {z: 0.5} }’,馬達不會動,想請教各位大大高手,我是哪裡出錯了?感謝

郭俊志
2018-10-02 14:17:51

郭俊志
2018-10-02 14:23:02

康心奕
2018-10-02 14:41:09

張育仁
2018-10-02 15:05:02

鄭小隆
2018-10-02 15:05:25

陳曜承
2018-10-02 15:11:04

康心奕
2018-10-02 18:58:19

鄭小隆
2018-10-02 20:06:34

康心奕
2018-10-02 20:09:35


原文網址 Yuhong Lin
2018-06-08 22:33:57

[ROS Developers LIVE-Classes List]

Upcoming ROS LIVE streams:
http://www.theconstructsim.com/ros-developers-live-class-d…/
12 Jun | How to create an OpenAI environment for your robotic problem
19 Jun | Using Tensorflow with ROS

Previous ROS Developers LIVE-Class:
- #20: Simulate an Industrial Environment
http://www.theconstructsim.com/ros-developers-live-class-2…/

- #19: Let’s Use Gazebo Plugins
http://www.theconstructsim.com/ros-developers-live-class-1…/

- #18 : Let’s Simulate a World in Gazebo Simulator http://www.theconstructsim.com/ros-developers-live-class-1…/

- #17: Let's Simulate a Robotic Arm With Gazebo
https://youtu.be/DJwnZSaHy7s

- #16: How to build a Gazebo robot simulation
https://youtu.be/q01dDxeHTMs

- #15: Using ROS TF to transform sensor data
https://youtu.be/dBATvRhvGRI

- #14: How To Control Robot Joints With ROS
https://youtu.be/M4KF2c3OMSI

- #13: ROS Navigation Stack How To
https://youtu.be/fTizQneURWo

- #12: How to use ROS with industrial robots (ROS Industrial)
https://youtu.be/BCDFvMw6N-8

- #11: Visually Programming ROS State Machines (Round #3)
https://youtu.be/ZLv5iCSnR5c

- #10: Visually Programming ROS State Machines (Round #2)
https://youtu.be/lKkP5qhFbHQ

- #9: Visually Programming ROS State Machines (Round #1)
https://youtu.be/jrV5jRs1SJc

- #8: How to recognize faces with the ROS face recognition package
https://youtu.be/yENvskEKhJk

- #7: OpenAI+ROS Robot: Practical section
https://youtu.be/FYdS3-c2lKw

- #6: How to use OpenAI to train your robot
https://youtu.be/L7mlz7I8RbI

- #5: Simulating a Drone from Scratch
https://youtu.be/l6hVfVK_YWw

- #4: Carrot Navigation using AR Tags
https://youtu.be/QkUZWRe5f4I

- #3: rotating laser mounted on a vehicle
https://youtu.be/W2VNNMiiN-Q

- #2: Merging Odometry and IMU data for robot localization
https://youtu.be/nQZeAafDEJE

- #1: Building 3D pointclouds from rotating lasers
https://youtu.be/5CvqJ5EFbE4

翻譯年糕


原文網址 馬鐸瑋
2018-05-11 13:13:03

大家好
最近在使用google play下載的
ros Make A Map的 app
我是使用TurtleBot3的Burger做測試
使用過程中遇到幾個問題
1.APP顯示的地圖上沒有出現TB3的model
但是Rviz上有確實顯示TB3的model
2.APP在儲存map的時候出現
"no such service /save_map of type world_canvas_msgs/SaveMap"
但是PC端能夠儲存map
有嘗試過下面這篇的方法,但還是沒有成功
https://github.com/rosjava/android_apps/issues/65
謝謝大家

林浩鋕
2018-05-11 18:33:24

關於問題1
我不認為是rosjava的問題
RVIZ中可以顯示是因為RVIZ有對urdf做顯示
但就我知道(有點久沒用rosjava了 不知是否有更新)
rosjava or app那端並沒有對urdf做支援

印象中Willow Garage有做過類似的demo:
https://bitbucket.org/zimmrmn3/rviz-for-android/wiki/Home
可以試試 XD

馬鐸瑋
2018-05-11 19:28:42

嗯嗯好,我嘗試看看,感謝你的建議!謝謝


原文網址 林浩鋕
2018-03-30 22:10:20

趁這個可愛的小社群突破300人
來分享一下ROS2的一些資訊

OSRF & ROS-I非官方小道消息:
1. 目前正在進行Gazebo的ROS2移植,
但不同於RVIZ模組化的核心,
Gazebo會花比較多時間(太多第三方的要求了)
另外NASA目前也在與OSRF合作
要把沙子模擬放進Gazebo中 XD

2. 他們知道Actionlib的重要性,
但要達成那一步, 還有許多前期作業
所以短時間內無法看到ROS2版move_base
但會有很多獨立Pkg移植到ROS2

3. 目前ROS2的願景是模組化的硬體
有點像是H-ROS在做的事情

第三方廠商在ROS2的貢獻:
除了Tutorial中已經有的astra, turtlebot, amcl外
最近動作最大的可以說是Intel OTC (上海)
他們的Realsense & Movidius Wrapper皆已移到ROS2

Realsense D4XX ROS2 Driver:
https://github.com/intel/ros2_intel_realsense

Movidius ROS2 Driver:
https://github.com/intel/ros2_intel_movidius_ncs

從Intel的Github Repo可以發現
他們會逐漸把ROS1的Pkg都增加ROS2支援
像是之前分享的: ros2_object_analytics
https://github.com/intel…

最後, 順便(偷偷)工商一下XD
ADLINK-ARPG本身也在推ROS2的解決方案
像是之前年會分享的Neuron IPC
已經推出相對應的NeuronBot Demo
做為ROS2/DDS PoC的平台
在德國Embedded world 2018 & ROS-I America
都有相當好的反應與回饋
所有source code都有公開:
https://github.com/Adlink-ROS/adlink_neuronbot

概念影片: https://youtu.be/RC6XvTvTs9Y
展場錄影: https://youtu.be/-mbbiR0t6I0


原文網址 林浩鋕
2018-03-25 21:55:38

[ROS系列文章] 第10篇 - ETHZ RSL (ANYmal)
系列文章強勢回歸(自己說XD)
上次介紹ETHZ非常有名ASL (Autonomous Systems Lab)
(基本上學術界做VIO都要跟他們的ROVIO, OKVIS比較)
這次來介紹另一個很有名的Lab: RSL
(Robotic Systems Lab)
最有名的是他們的quadrupedal robot: ANYmal
https://youtu.be/ZdeRi_5xK5U
最近的video, ANYmal隨音樂起舞XD
https://youtu.be/kHBLaw5nfzk

我對quadrupedal不太熟
但是ETHZ依舊保持一貫作風
上層架構完全建立在ROS上並且開源!!
free_gait:
An Architecture for the Versatile Control of Legged Robots
Video: https://youtu.be/5BkoGug8HhE
Github: https://github.com/leggedrobotics/free_gait
Slide:
https://www.ethz.ch/…/rs…/ROS2017/case_study_2018_anymal.pdf

透過架構可以看到整合諸多ETHZ本身開發的ROS pkg
像是ASL早期推出(目前還有在維護的) libpointmatcher
用作3D mapping & localization
加上 elevation_mapping 作為dense map generator
最後再導入grid_map以及OMPL(RRT*)
使ANYmal能透根據周遭複雜環境做
path planning & control

另外RSL的leader: Prof: Hutter, Marco
亦有開設ROS初階入門課程
(包含ROS架構, coding技巧, 實際演練與題目等)
算是我看這麼多教學裡面最紮實也最用心的課程
http://www.rsl.ethz.ch/education-stude…/…/robotdynamics.html
Video: https://youtu.be/0BxVPCInS3M

另外一門Robot Dynamics
其所有slides也是公開
強烈建議剛踏入機器人領域的人參考
畢竟ROS裡面很多pkg的參數調整
都是需要相關學術背景才能處理!!
http://www.rsl.ethz.ch/education-stude…/…/robotdynamics.html

Don Si
2018-03-26 08:42:42

感謝小林老師的分享

不知道老師對grid_map和elevation_mapping這兩個包的使用有否建議或分享


原文網址 吳彥寬
2018-02-16 00:26:41

Share a great book "Mastering ROS for Robotic Programming". It's a little bit advanced but useful for users with experience of the basic concept and operations.

Here is the outline:

Chapter 1: Introduction to ROS and its Package Management
Chapter 2: Working with *3D Robot Modeling* in ROS
Chapter 3: Simulating Robots Using ROS and *Gazebo*
Chapter 4: Using ROS *MoveIt*! and Navigation stack
Chapter 5: Working with Pluginlib, Nodelets and Gazebo plugins
Chapter 6: Writing ROS Controllers and Visualization plugins
Chapter 7: Interfacing I/O boards, sensors and actuators to ROS
Chapter 8: Programming Vision sensors using ROS, Open-CV and PCL
Chapter 9: Building and interfacing a differential drive mobile robot hardware in ROS
Chapter 10: Exploring advanced capabilities of ROS-MoveIt!
Chapter 11: *ROS for Industrial Robots*
Chapter 12: Troubleshooting and best practices in ROS

Source code: https://github.com/qboticslabs/mastering_ros
PDF: http://pdf.th7.cn/…/Mastering%20ROS%20for%20Robotics%20Prog…

分享一本很棒的書"掌握 ros for ros for ros for ros for ros". 它有點先進, 但對於擁有基本概念和操作經驗的使用者來說很有用.

這是大綱:

第1章: ros介紹及其套件管理
第2章: 與*3D機器人模特*在ros合作
第3章: 使用ros和* gazebo模擬機器人
第4章: 使用ros * moveit *! 和導航堆
第5章: 與pluginlib, nodelet和gazebo外掛程式合作
第6章: 寫入ros控制器和視覺化外掛程式
第7章: 將i / o板, 感測器和啓動器與ros介面
第8章: 使用ros, open-cv和pcl的程式設計視覺感測器
第9章: 在ros建造和介面不同驅動移動機器人硬體
第10章: 探索ros-moveit的高階功能!
第11章: *工業機器人的ros *
第12章: ros的疑難排解和最佳做法

原始碼: https://github.com/qboticslabs/mastering_ros
PDF: http://pdf.th7.cn/down/files/1603/Mastering%20ROS%20for%20Robotics%20Programming.pdf

· 查看原文 · 為此翻譯評分

林浩鋕
2018-02-16 00:42:36

Lentin Joseph
不過要注意版本問題
書是以indigo為主
到kinetic後 opencv 換成3 會有一些API使用上的問題~

黃大峯
2018-02-16 00:44:13

opencv3在ros 上真的很麻煩...有除了重編譯以外的好解法嗎..

林浩鋕
2018-02-16 00:44:23

不過 Yen-Kuan Wu 你也太認真
在加拿大過年還在po文XD

林浩鋕
2018-02-16 00:46:53

這幾天被KDTree搞死
我後來都直接在cmakelist強迫使用opencv2

吳彥寬
2018-02-16 01:20:58

No holidays here : (

林浩鋕
2018-02-16 01:23:59

我去年過年是在toulouse
因為訂錯機票 初三才回到家 呵呵
(所以與在那邊的台灣人狂喝酒)


原文網址 林浩鋕
2018-02-08 22:11:48

[ROS系列文章] 第5篇 - ROS 2.0 資源統整
這幾天感冒, 所以今天po比較輕鬆一點的統整文章

ROS2.0 的生態正在急速地擴展
雖然相較ROS 1.0來說比較生硬(文章少/應用少)
但因為其middlware 直接採用DDS的關係
對未來系統商品化/規模化會有極大的貢獻
像是百度無人車計畫(Apollo) 採用的ROS1.0架構
在改版時就是採用DDS作為依據
知名開源無人車計畫 AutoWare, 目前也逐漸轉向ROS2

以下統整一些本人在研讀/開發ROS2.0時的一些資源~

ROS 2.0 Wiki
https://github.com/ros2/ros2/wiki

OpenSplice DDS Tutorial
http://download.prismtech.com/…/html/ospl/DDSTut…/index.html
http://download.prismtech.com/…/…/OpenSplice_DDSTutorial.pdf

RTI Online document
https://community.rti.com/…/RTI_ConnextDDS_CoreLi…/index.htm

ROS 2.0 Design
http://design.ros2.org/

ROS 2.0 demos
https://github.com/ros2/demos

DDS Vender之戰 (ROS Discourse XD)
https://discourse.ros.org/t/ipc-in-ros2/2619

ROSCon2017 ROS 2.0 (TonyRobitcs 翻譯)
http://mp.weixin.qq.com/s/lMCaWhHZIkrwZOHcwD9qBA

古月大大 迎接ROS2.0时代的到来
http://www.guyuehome.com/1228

ROS 2.0 ExBot易科机器人相關介紹/教學
http://blog.exbot.net/archives/3514
http://blog.exbot.net/archives/3520

HyphaROS ROS2 x DDS Introduction
https://www.youtube.com/watch?v=iWhpReUA6RE

林浩鋕
2018-02-09 01:00:40

林永仁
2018-02-09 16:33:54

林浩鋕
2018-02-09 20:39:40

林永仁
2018-02-09 20:44:03

林浩鋕
2018-02-09 20:45:50

林永仁
2018-02-09 21:36:02

林浩鋕
2018-02-09 23:12:50


原文網址 林浩鋕
2018-01-28 11:46:45

[ROS系列文章] 第1篇 - PythonRobotics
昨天偷偷瀏覽 張岳傳 (Yueh Chuan Chang) 的github時
突然瞥見這個有趣的github, 往回查了一下
發現是Berkeley MPC實驗室的訪問學者AtsushiSakai
做的python based for localization, planning, tracking demo
基本上把傳統控制所有出名的演算法都呈現出來
(還附參考論文)
Github: https://github.com/AtsushiSakai/PythonRobotics
包含以下知名演算法:
EKF, UKF (類似robot_localization)
DWA (move_base local controller)
A* & Dijkstra (move_base global planner)
RRT, RRT*, CLRRT, RPM (有點類似OMPL)
Pure pursuit tracking (RaceCar 裡面的L1 controller)
LQR, 跟我最近在進行的MPC (linear model, by cvxpy)

簡單來說重點如下:
1. open source (License MIT)
2. python based & Visualization
3. Reference papers

看完只好邀請大家一起來跪著看Codes啦XD

張岳傳
2018-01-28 12:06:02

受到小林老師關注(〃∀〃)~♡

陳怡宏
2018-01-28 12:10:10

最讚的是有論文啊~ ?


 

全不選 發文排行