SlideShare a Scribd company logo
1 of 140
Download to read offline
Website: https://hypharosworkshop.wordpress.com/contact/
FB Page: https://www.facebook.com/HyphaROS/
Email: hypha.ros@gmail.com
ROS Ecosystem & Applications
Lecturer : HaoChih, LIN
林浩鋕
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
● About us
● ROS Introduction
● SLAM Package
● Applications
(ARDrone Indoor monoSLAM & Navigation)
● ROS Industrial
● ROS 2.0
● Q & A
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
About us
● Introduction
○ Website: https://hypharosworkshop.wordpress.com/
○ Github: https://github.com/Hypha-ROS/hypha-racecar
○ Facebook: https://www.facebook.com/HyphaROS/
○ Youtube: https://www.youtube.com/watch?v=jgS6gpmWPoY
○ Youku: http://i.youku.com/hypha
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
About us
● Introduction
○ Established date: April-2017
○ Self-organized Workshop: 3
○ Speech & Training: 6
○ Technical supports: > 10 universities/labs & > 5 companies
○ HyphaROS RaceCar ver 1.0 released (sold 30 units)
4
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
About us
● Introduction
○ Lecturer in “ROS Summer School in China 2017”
○ Presenter in “2017 WRC ROS Forum”
○ Product & Service [ROS]: Workshop, Technical Consultant, AGVs, Home robots, etc..
○ Cooperate with Chips Company (China), will attend CES 2018 (if everything goes right...)
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
About us
ROS.Taipei 2018 開發者年會
Official Website: https://ros-taipei.wixsite.com/2018
FB Page: https://www.facebook.com/groups/ros.taipei/
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
Source: http://www.ros.org/history/
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
● Package
○ include/package_name: C++ include headers
○ msg/: Folder containing Message (msg) types
○ src/: Source files
○ srv/: Folder containing Service (srv) types
○ scripts/: executable scripts
○ CMakeLists.txt: CMake build file (see catkin/CMakeLists.txt)
○ package.xml: Package catkin/package.xml
● Node
● Message [A message is simply a data structure, comprising typed fields (much like C structs).]
● Master [provides name registration and lookup to the rest of the Computation Graph]
● Parameter Server
● Topics
● Service [for request / reply interactions]
● Rosbag
● Actionlib [A common, topic-based interface for preemptible tasks in ROS.]
● Plugins [provides a library for dynamically loading libraries in C++ code.]
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
● [concept] Establishing a topic connection
○ Subscriber starts.
○ Publisher starts.
○ Subscriber registers with the Master. (XMLRPC)
○ Publisher registers with the Master. (XMLRPC)
○ Master informs Subscriber of new Publisher. (XMLRPC)
○ Subscriber contacts Publisher to request a topic
connection and negotiate the transport protocol. (XMLRPC)
○ Publisher sends Subscriber the settings
for the selected transport protocol. (XMLRPC)
○ Subscriber connects to Publisher using
the selected transport protocol. (TCPROS, etc...)
figure source: http://wiki.ros.org/ROS/Technical%20Overview
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
• Standard Linux tools:
Compilers, Debuggers, Loggers, IDEs
• Multiple language support:
C/C++, Python, Java, Lisp, Go, Scratch, etc.
• Standard libraries:
Boost, MySQL, XML (whatever you can imagine)
• Modern GUI tools
• Many tools missing from industrial development packages
Source: ROS-Industrial Introduction slides 2013, Shaun Edwards
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
c
Source: Navigation Illumination Slides, David V. Lu 2014
David V. Lu
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
2014 2016 2017
Source: ROS metrics-report-2017-07
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
Source: ROS metrics-report-2017-07
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
Source: RosCon2017 Opening Remark
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
Source: https://software.intel.com/en-us/articles/build-an-autonomous-mobile-robot-with-the-intel-realsense-camera-ros-and-sawr
IntelROSProject
Realsense
Movidius
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
IntelROSProject
Realsense
Movidius
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
• Website
1. ROS Install (Kinetic): http://wiki.ros.org/kinetic/Installation/Ubuntu
2. ROS Wiki (Tutorial): http://wiki.ros.org/ROS/Tutorials
3. CLEARPATH Tutorial: http://www.clearpathrobotics.com/assets/guides/ros/
• Youtube Video
1. ROS Tutorial:
https://www.youtube.com/playlist?list=PLSzYQGCXRW1HLWHdJ7ehZPA-nn7R9UKPa
2. Erle Robotics:
https://www.youtube.com/playlist?list=PL39WpgKDjDfVfiNVG47DBi93wsh2XHKVO
3. The Construct: http://www.theconstructsim.com/
ROS Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
2D Laser SLAM
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
● Gmapping
○ needs external odom (in our case: laser odom fused with imu0)
○ Rao-Blackwellized Particle Filter (RBPF)
○ Loop closure
● Hector SLAM
○ Gauss-Newton approach
○ External odom is not necessary
○ No loop closure
○ Requires high quality sensor (e.g. UTM-30LX)
○ Supports EKF fusion (imu)
● MRPT-ICP SLAM
○ ICP algorithm
○ For small to mid-sized maps
○ External odom is not necessary
2D Laser SLAM
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
2D Laser SLAM
gmapping (laser odom) mrpt icp hector slam
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
● Google cartographer
○ http://wiki.ros.org/cartographer
● MRPT-ICP SLAM
○ https://github.com/ethz-asl/ethzasl_icp_mapping
2D Laser SLAM
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
3D SLAM
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
● 3D Laser
○ google cartographer
○ ETHZ-ASL libpointmatcher
○ ETHZ-ASL laser_slam
● Visual (RGBD)
○ Rtabmap
○ RGBD SLAM (v1, v2)
● Visual Stereo
○ Duo-VIO
● Visual Monocular
○ PTAM
○ LSD_SLAM (semi-dense)
○ SVO (semi-dense)
○ ORB-SLAM (feature based)
● Visual Inertial Odometry/SLAM
○ Loosely coupled: MSF_EKF
○ Tightly coupled: OKVIS, ROVIO, Duo-VIO
○ Framework: ETHZ-ASL maplab
3D SLAM & Odometry
Source: https://github.com/ethz-asl/maplab
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
● RtabMap
3D SLAM & Odometry
Source: http://wiki.ros.org/rtabmap_ros
Real-Time Appearance-Based Mapping
http://introlab.github.io/rtabmap/
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
● RtabMap
3D SLAM & Odometry
Source: http://wiki.ros.org/rtabmap_ros
Real-Time Appearance-Based Mapping
http://introlab.github.io/rtabmap/
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
3D SLAM & Odometry
Tutorials
1.RGB-D Hand-Held Mapping
2.This tutorial shows how to use rtabmap_ros out-of-the-box with a Kinect-like sensor in mapping mode or localization mode.
3.Stereo Hand-Held Mapping
4.This tutorial shows how to use rtabmap_ros out-of-the-box with a stereo camera in mapping mode or localization mode.
5.Remote Mapping
6.This tutorial shows how to do mapping on a remote computer.
7.Stereo Outdoor Mapping
8.This tutorial shows how to do stereo mapping with RTAB-Map.
9.Stereo Outdoor Navigation
10.This tutorial shows how to integrate autonomous navigation with RTAB-Map in context of outdoor stereo mapping.
11.Setup RTAB-Map on Your Robot!
12.This tutorial shows multiple RTAB-Map configurations that can be used on your robot.
13.Mapping and Navigation with Turtlebot
14.This tutorial shows how to use RTAB-Map with Turtlebot for mapping and navigation.
15.Tango ROS Streamer
16.Tutorial to get Tango ROS Streamer working with rtabmap_ros
17.Advanced Parameter TuningThis tutorial tells you which parameter to change to improve performances
18.Wifi Signal Strength Mapping (User Data Usage)
19.This tutorial shows how to add user data during mapping that will be saved directly in RTAB-Map's database for convenience.
● RtabMap Real-Time Appearance-Based Mapping
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
3D SLAM & Odometry
● RtabMap Real-Time Appearance-Based Mapping
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
3D SLAM & Odometry
● RtabMap Real-Time Appearance-Based Mapping
● 3D mapping on Odroid XU4 with Realsense R200
ORB vs GFTT/ORB (BRISK is not good enough)
320 * 240
loop closure (g2o)
Vis + ICP
PCL filter and octomap
The IMU issue (mpu6050 -> gy85)
Supports multi-mapping
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
3D SLAM & Odometry
● ORBSLAM v1 & v2 http://webdiis.unizar.es/~raulmur/orbslam/
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
3D SLAM & Odometry
● ORBSLAM v1 & v2 http://webdiis.unizar.es/~raulmur/orbslam/
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
3D SLAM & Odometry
● SVO 1 & 2 http://rpg.ifi.uzh.ch/svo2.html
1. Parrot-SenseFly Albris drone:
https://www.youtube.com/watch?v=mYKrR...
2. Virtual reality:
https://www.youtube.com/watch?v=k0MLs...
3. iPhone app 3D around:
https://3daround.dacuda.com/
4. iPhone app Staramba3D:
https://itunes.apple.com/us/app/stara...
5. Zurich-Eye (now Facebook-Oculus VR):
http://www.zurich-eye.com/
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
3D SLAM & Odometry
● SVO 1 & 2
http://rpg.ifi.uzh.ch/svo2.htmlhttps://github.com/uzh-rpg/rpg_svo
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
● ETHZ-ASL libpointmatcher
3D SLAM & Odometry
Source: https://github.com/ethz-asl/libpointmatcher
An "Iterative Closest Point" library for 2-D/3-D mapping in Robotics
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
● ETHZ-ASL OKVIS & ROVIO
3D SLAM & Odometry
https://github.com/ethz-asl/okvis_ros https://github.com/ethz-asl/rovio
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
● ETHZ ASL MapLap
3D SLAM & Odometry
Source: https://github.com/ethz-asl/maplab
An Open Framework for Research in Visual-inertial Mapping and Localization
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
HyphaROS RaceCar
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
HyphaROS RaceCar: Introduction
● The requirements of the platform
○ ROS fully support
○ Able to implement 2D Navigation stack (laser based)
○ Low cost (ARM SBC, low-cost lidar, mems imu, etc)
○ High speed/performance
○ Robust & Safety
○ Algorithms evaluation/comparison
○ Modularization & Extensibility
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
HyphaROS RaceCar: Introduction
● The origin of RACECAR
MIT: https://mit-racecar.github.io/
Youtube: https://www.youtube.com/watch?v=9fzzp6oxid4
1/10-scale Traxxis Rally Car
Nvidia Jetson TX 1
Hokuyo UST-10LX laser range finder
Stereolabs ZED stereo camera
Structure.io depth camera
Sparkfun IMU
Encoder + optical flow
realtime onboard 4 m/s
Total cost: around 3,600 USD
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
HyphaROS RaceCar: Introduction
● Similar projects
Penn: http://f1tenth.org/ [without slam, NAV]
UCB: http://www.barc-project.com/projects/ [without laser]
Georgia Tech: https://github.com/AutoRally [for outdoor]
CMU: https://github.com/mrsd16teamd/loco_car [indoor]
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
HyphaROS RaceCar: Introduction
MIT RaceCar
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
HyphaROS RaceCar: Introduction
Georgia Tech AutoRally
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
HyphaROS RaceCar: Introduction
● Our Solution
○ Open-Source, Open-Hardware
○ Low-cost (~ 600 USD), High-speed (~ 3 m/s)
○ Step by step tutorial for beginner (available on github: Hypha-ROS)
Version 1 Version 2
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
HyphaROS RaceCar: Introduction
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
HyphaROS RaceCar: Major Functions
HyphaROS
RaceCar
Localization
Odometry
SLAM
Base
Controller
Navigation
Sensors/
Actuators
Drivers
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
HyphaROS RaceCar: Hardware Architecture
Odroid XU4
Arduino
Nano
USB
Hub
Gy85
Servo
Motor ESC
Arduino
UNO
RPLidar
(A1M8)
FTDI
USB
USB
I2C
PWM
PWM
Wifi
TX/RX
USB
Ethernet
7.4V BatteyBEC
DC 2 DC
Core
Motor
BEC
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
HyphaROS RaceCar: Software Architecture
move_base
(path planning)
robot_localization
(EKF)
rf2o
(laser odom)
PySerial
(imu reading)
Filtered
Odometry • Pure Pursuit
• TEB control
• MPC
rosserial
(to arduino)
rplidar_ros
(laser scan)
Ackerman
(rpm odom)
GPS
(optional)
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
HyphaROS RaceCar: Software Architecture
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
HyphaROS RaceCar: Github
HyphaROS
VM image
Desktop sharing
(vino + remmina)
Terminal or File
manager (ssh)
All source code can be found
on Hypha-ROS github:
https://github.com/Hypha-
ROS/hypha-racecar
(including udev setting, Arduino
files, necessary documents)
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
Drone Applications
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
Drone Applications
● Simulation
○ Gazebo (with PX4)
○ AirSim Simulation
● Well known Projects
○ APM
○ PX4 & Dronecode
○ PaparazziUAV
○ CrazySwarm
○ Erlerobot gym-gazebo
○ DJI SDK
○ ARDrone SDK
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
Drone Applications
● PX4 X Gazebo https://dev.px4.io/en/simulation/gazebo.html
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
Drone Applications
● AirSim https://github.com/Microsoft/AirSim
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
Drone Applications
● CrazySwarm http://crazyswarm.readthedocs.io/en/latest/
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
Drone Applications
● PaparazziUAV https://blog.paparazziuav.org/
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
MCU
(Pixhawk, APM, Arduino)SBC (Odroid XU4, Nvidia TX1/2 or NUC)
Drone Applications
● General Architecture (Loosely coupled)
MoveIt
(octomap &
Path)
Trajectory
Generator
(optional)
Serial
e.g. MAVROS
PySerial
VO/SLAM
Sensors
Imu, gps
MSF-
EKF
RGB
camera
High level
Controller
Platform
(HW)
Low level
Controller
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ARDrone Indoor Navigation
(LSD-SLAM)
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ARDrone Indoor Navigation
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ARDrone Indoor Navigation
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ARDrone Indoor Navigation
LSD-SLAM
PTAM (IMU)
Least
square
MoveIt
(octomap & RRT*)
Trajectory
Generator
NDI
Controller
In: RGB image
In:
• RGB image
• IMU
• Sonar
Out: scaled pcl Out: way points Out: trajectory
Out: cmd
Could be
replaced by
MSF-EKF
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
●LSD-SLAM (Large-Scale Direct Monocular SLAM)
As direct method, LSD-SLAM uses all information in the image, including
e.g. edges – while keypoint-based approaches can only use small
patches around corners. This leads to higher accuracy and more
robustness in sparsely textured environments (e.g. indoors), and a much
denser 3D reconstruction.
ARDrone Indoor Navigation
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ARDrone Indoor Navigation
Monocular SLAM non scaled issue
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
𝑀 𝑞𝑙 𝑖
𝛿𝑞 − 𝑞𝑡 𝑖
2
Am+1 = Am + 𝑀 𝑇 𝑞𝑙 𝑚+1
𝑀(𝑞𝑙 𝑚+1
)
ym+1 = ym + 𝑀 𝑇 𝑞𝑙 𝑚+1
𝑞𝑡 𝑚+1
[𝐼3×3 𝑅 𝛿𝑞 𝑥𝑙 𝑖
𝛿𝑥
𝛼
− 𝑥 𝑡 𝑖
|2
Am+1 = Am + 𝐼3×3 𝑅 𝛿𝑞 𝑥𝑙 𝑚+1
𝑇
𝐼3×3 𝑅 𝛿𝑞 𝑥𝑙 𝑚+1
ym+1 = ym + 𝐼3×3 𝑅 𝛿𝑞 𝑥𝑙 𝑚+1
𝑇
𝑥 𝑡𝑖
Recursive least-squares
M is quaternion multiplication matrix
R is quaternion rotation matrix
ARDrone Indoor Navigation
Monocular SLAM non scaled issue
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
Let 𝑝 𝑛, denote the coefficients of a polynomial P of degree N such that
P t = 𝑃𝑛 𝑡 𝑁
+ 𝑃𝑛−1 𝑡 𝑛−1
. . . +𝑝0 =
𝑛=0
𝑁
𝑃𝑛 𝑡 𝑛
We are interested in optimizing the coefficients of P to minimize cost functions (lateral offset
from a nominal path) of the form
J =
0
𝜏
𝑐0 𝑃 𝑡 2
+ 𝑐1 𝑃′
𝑡 2
+ 𝑐2 𝑃′′
𝑡 2
+ . . . +𝑐 𝑁 𝑃 𝑁
𝑡 2
𝑑𝑡
which can be written in quadratic form as, J = 𝑝 𝑇
𝑄 𝑝
where
Q =
𝑟=0
𝑁
𝑐 𝑟 𝑄 𝑟
Qr
𝑖𝑙
=
2(
𝑚=0
𝑟−1
(𝑖 − 𝑚)(𝑙 − 𝑚))
𝜏 𝑖+𝑙−2𝑟+1
𝑖 + 𝑙 − 2𝑟 + 1
; 𝑖 ≥ 𝑟 ∧ 𝑙 ≥ 𝑟
0; 𝑖 < 𝑟 ∨ 𝑙 < 𝑟
Control, Estimation, and Planning Algorithms for Aggressive Flight using Onboard Sensing, MIT, Adam Parker Bry
ARDrone Indoor Navigation
Trajectory Generating
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
Piecewise Polynomial Joint Optimization
We now have a quadratic program (QP) of the form: min
𝑥
𝑥 𝑇
𝑄𝑥
s. t. Ax − b = 0
Since we wish to "correct" for derivative discontinuities in Dubins curves it is necessary
to jointly optimize multiple polynomial segments
Control, Estimation, and Planning Algorithms for Aggressive Flight using Onboard Sensing, MIT, Adam Parker Bry
ARDrone Indoor Navigation
Trajectory Generating
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
Piecewise Polynomial Joint Optimization
The higher order time differential constraints for curve-segment of Dubins curves:
ARDrone Indoor Navigation
Trajectory Generating
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
Piecewise Polynomial Joint Optimization
The higher order time differential constraints for line-segment of Dubins curves:
ARDrone Indoor Navigation
Trajectory Generating
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
𝑥 = 𝑥 𝑤 𝑦 𝑤 zw 𝑢 𝑤 𝑣 𝑤 𝑞1 𝑞2 𝑞3 𝑞4
𝑇
𝑢 = 𝜙 𝜃 𝜓 𝑧 = [𝑢1 𝑢2 𝑢3 𝑢4]
𝑉 = 𝑧 𝑤 = 𝑢4
𝑢1 = tan−1
𝑥
𝑔 − 𝑧
𝑢2 = tan−1
𝑦𝑐𝑜𝑠𝑢1
𝑔 − 𝑧
𝑢3 = 𝜓
ARDrone Indoor Navigation
Nonlinear Dynamic Inversion (NDI)
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ARDrone Indoor Navigation
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Industrial
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
Source: Source: ROS-Industrial slides 2017, 邱强 (上海交大)
ROS Industrial
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
Source: Source: ROS-Industrial slides 2017, 邱强 (上海交大)
ROS Industrial
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
Source: Source: ROS-Industrial slides 2017, 邱强 (上海交大)
Inverse
Kinematics
(KDL, IK-FAST)
Collision
Checking
(FCL)
Motion
Planning
(OMPL: RRT)
Forward
Kinematics
(URDF, TF)
ROS Industrial
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Industrial
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Industrial
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
Source: 04-Mirko_Bordignon_WRC2017_ROS
ROS Industrial
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Industrial
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
Source: 04-Mirko_Bordignon_WRC2017_ROS
ROS Industrial
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
Source: 04-Mirko_Bordignon_WRC2017_ROS
ROS Industrial
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
Robot Arms
• Motoman
• Adept
• Universal
• Fanuc
• ABB
• Kuka
• Techman (Taiwan)
• More to come…
Source: ROS-Industrial Introduction slides 2013, Shaun Edwards
ROS Industrial
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
Industrial_Robot_Driver_Spec http://wiki.ros.org/Industrial/Industrial_Robot_Driver_Spec
ROS Industrial
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Industrial
Source: ROS-Industrial Website
ROS-industrial Conference ROS-industrial Workshops
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
Source: ROS-Industrial Website
ROS Industrial
ROS-industrial Consortium Worldwide Membership, December 2017
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Industrial
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
rtt_lwr: OROCOS/ROS Components for Light Weight Robots
ROS Industrial
Source: http://rtt-lwr.readthedocs.io/en/latest/index.html
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
●New Horizon 2020 robotics projects from 2016
https://ec.europa.eu/programmes/horizon2020/en/news/new-horizon-
2020-robotics-projects-2016
The two biggest projects are ROS related !
RoBMoSys and ROSIN (15.5 MEUR in total)
http://rosin-project.eu/
http://robmosys.eu/ € 8,000,000.00
€ 7,504,236.25
• ABB AB Sweden
• Delft University of Technology
• FH Aachen University of Applied Sciences
• Fraunhofer-Institut für Produktionstechnik und Automatisierung IPA
• Fundación Tecnalia Research & Innovations
• IT University of Copenhagen
ROS Industrial
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
Source: 04-Mirko_Bordignon_WRC2017_ROS
ROS Industrial
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
Melonee Wise
http://fetchrobotics.com/fetchers/
ROS Industrial
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
https://github.com/
ApolloAuto
ROS Industrial
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Industrial
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS Industrial
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS 2.0
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
Known Issue of ROS 1.0
• Realtime performance
• Node management
• Master (roscore)
• Multi-robots capability (Swarm)
• Small processors
• Communication Priority
• Communication Security
• Unreliable network connectivity
Source: http://blog.ascens-ist.eu/wp-content/uploads/2011/03/13marxbots.jpg
ROS 2.0
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
The Goals
of ROS 2
Source: https://roscon.ros.org/2014/wp-content/uploads/2014/07/ROSCON-2014-Next-Generation-of-ROS-on-top-of-DDS.pdf
ROS 2.0
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
Source: https://roscon.ros.org/2014/wp-content/uploads/2014/07/ROSCON-2014-Next-Generation-of-ROS-on-top-of-DDS.pdf
=
less time
spent here
more time to spent here
ROS 2.0
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS 1 ROS 2
ROS 2.0
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
User Code
ROS Client Lib
rclpy rclcpp Third Party
ROS Middleware
OpenSplice
RMW Impl.
FastRTPS
RMW Impl.
Third Party
RMW Impl.
PrismTech
OpenSplice
eProsima
FastRTPS
Third Party
DDS
User
Applications
Client
Wrapper
Middleware
DDS
DDS
agnostic
ROS
agnostic
ROS 2.0
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
Alpha 1
31 Aug 2015
Beta 1
31 Aug
2015
Beta 2
31 Aug
2015
Beta 3
13 Sep
2017
Ver. 1
13 Dec
2017
ROS 2.0
Ardent Apalone
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS 2.0
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS 2.0
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS 2.0
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS 2.0
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
ROS 2.0
https://hypharosworkshop.wordpress.com/
Copyright © 2017 Hypha ROS Workshop. All rights reserved Lecturer: HaoChih, LIN
Q & A
Website: https://hypharosworkshop.wordpress.com/
Github: https://github.com/Hypha-ROS/hypha-racecar
FB Page: https://www.facebook.com/HyphaROS/
Youku: http://i.youku.com/hypha
Gmail: hypha.ros@gmail.com
WeChat (ID): HyphaROS

More Related Content

What's hot

Demystify eBPF JIT Compiler
Demystify eBPF JIT CompilerDemystify eBPF JIT Compiler
Demystify eBPF JIT CompilerNetronome
 
[Unite Seoul 2019] Mali GPU Architecture and Mobile Studio
[Unite Seoul 2019] Mali GPU Architecture and Mobile Studio [Unite Seoul 2019] Mali GPU Architecture and Mobile Studio
[Unite Seoul 2019] Mali GPU Architecture and Mobile Studio Owen Wu
 
전자해도 표준과 뷰어 (최규성)
전자해도 표준과 뷰어 (최규성)전자해도 표준과 뷰어 (최규성)
전자해도 표준과 뷰어 (최규성)Kyu-sung Choi
 
An Introduction to ROS-Industrial
An Introduction to ROS-IndustrialAn Introduction to ROS-Industrial
An Introduction to ROS-IndustrialClay Flannigan
 
Hybrid cloud : why and how to connect your datacenters to OVHcloud ?
Hybrid cloud : why and how to connect your datacenters to OVHcloud ? Hybrid cloud : why and how to connect your datacenters to OVHcloud ?
Hybrid cloud : why and how to connect your datacenters to OVHcloud ? OVHcloud
 
이원, 온라인 게임 프로젝트 개발 결산 - 마비노기 개발 완수 보고서, NDC2011
이원, 온라인 게임 프로젝트 개발 결산 - 마비노기 개발 완수 보고서, NDC2011이원, 온라인 게임 프로젝트 개발 결산 - 마비노기 개발 완수 보고서, NDC2011
이원, 온라인 게임 프로젝트 개발 결산 - 마비노기 개발 완수 보고서, NDC2011devCAT Studio, NEXON
 
What is gRPC introduction gRPC Explained
What is gRPC introduction gRPC ExplainedWhat is gRPC introduction gRPC Explained
What is gRPC introduction gRPC Explainedjeetendra mandal
 
Database, data storage, hosting with Firebase
Database, data storage, hosting with FirebaseDatabase, data storage, hosting with Firebase
Database, data storage, hosting with FirebaseTu Pham
 
Scaling and Unifying SciKit Learn and Apache Spark Pipelines
Scaling and Unifying SciKit Learn and Apache Spark PipelinesScaling and Unifying SciKit Learn and Apache Spark Pipelines
Scaling and Unifying SciKit Learn and Apache Spark PipelinesDatabricks
 
Ceph and Openstack in a Nutshell
Ceph and Openstack in a NutshellCeph and Openstack in a Nutshell
Ceph and Openstack in a NutshellKaran Singh
 
Best Practice of Compression/Decompression Codes in Apache Spark with Sophia...
 Best Practice of Compression/Decompression Codes in Apache Spark with Sophia... Best Practice of Compression/Decompression Codes in Apache Spark with Sophia...
Best Practice of Compression/Decompression Codes in Apache Spark with Sophia...Databricks
 
NGINX: HTTP/2 Server Push and gRPC
NGINX: HTTP/2 Server Push and gRPCNGINX: HTTP/2 Server Push and gRPC
NGINX: HTTP/2 Server Push and gRPCNGINX, Inc.
 
An Introduction to SPARQL
An Introduction to SPARQLAn Introduction to SPARQL
An Introduction to SPARQLOlaf Hartig
 
Escaping Dependency Hell: A deep dive into Gradle's dependency management fea...
Escaping Dependency Hell: A deep dive into Gradle's dependency management fea...Escaping Dependency Hell: A deep dive into Gradle's dependency management fea...
Escaping Dependency Hell: A deep dive into Gradle's dependency management fea...Roberto Pérez Alcolea
 
Traffic Insight Using Netflow and Deepfield Systems
Traffic Insight Using Netflow and Deepfield SystemsTraffic Insight Using Netflow and Deepfield Systems
Traffic Insight Using Netflow and Deepfield SystemsMyNOG
 
HTTP2 and gRPC
HTTP2 and gRPCHTTP2 and gRPC
HTTP2 and gRPCGuo Jing
 

What's hot (20)

A deep dive into libuv
A deep dive into libuvA deep dive into libuv
A deep dive into libuv
 
Demystify eBPF JIT Compiler
Demystify eBPF JIT CompilerDemystify eBPF JIT Compiler
Demystify eBPF JIT Compiler
 
Block Storage For VMs With Ceph
Block Storage For VMs With CephBlock Storage For VMs With Ceph
Block Storage For VMs With Ceph
 
[Unite Seoul 2019] Mali GPU Architecture and Mobile Studio
[Unite Seoul 2019] Mali GPU Architecture and Mobile Studio [Unite Seoul 2019] Mali GPU Architecture and Mobile Studio
[Unite Seoul 2019] Mali GPU Architecture and Mobile Studio
 
전자해도 표준과 뷰어 (최규성)
전자해도 표준과 뷰어 (최규성)전자해도 표준과 뷰어 (최규성)
전자해도 표준과 뷰어 (최규성)
 
An Introduction to ROS-Industrial
An Introduction to ROS-IndustrialAn Introduction to ROS-Industrial
An Introduction to ROS-Industrial
 
Hybrid cloud : why and how to connect your datacenters to OVHcloud ?
Hybrid cloud : why and how to connect your datacenters to OVHcloud ? Hybrid cloud : why and how to connect your datacenters to OVHcloud ?
Hybrid cloud : why and how to connect your datacenters to OVHcloud ?
 
이원, 온라인 게임 프로젝트 개발 결산 - 마비노기 개발 완수 보고서, NDC2011
이원, 온라인 게임 프로젝트 개발 결산 - 마비노기 개발 완수 보고서, NDC2011이원, 온라인 게임 프로젝트 개발 결산 - 마비노기 개발 완수 보고서, NDC2011
이원, 온라인 게임 프로젝트 개발 결산 - 마비노기 개발 완수 보고서, NDC2011
 
What is gRPC introduction gRPC Explained
What is gRPC introduction gRPC ExplainedWhat is gRPC introduction gRPC Explained
What is gRPC introduction gRPC Explained
 
OpenDaylight OpenStack Integration
OpenDaylight OpenStack IntegrationOpenDaylight OpenStack Integration
OpenDaylight OpenStack Integration
 
ShEx vs SHACL
ShEx vs SHACLShEx vs SHACL
ShEx vs SHACL
 
Database, data storage, hosting with Firebase
Database, data storage, hosting with FirebaseDatabase, data storage, hosting with Firebase
Database, data storage, hosting with Firebase
 
Scaling and Unifying SciKit Learn and Apache Spark Pipelines
Scaling and Unifying SciKit Learn and Apache Spark PipelinesScaling and Unifying SciKit Learn and Apache Spark Pipelines
Scaling and Unifying SciKit Learn and Apache Spark Pipelines
 
Ceph and Openstack in a Nutshell
Ceph and Openstack in a NutshellCeph and Openstack in a Nutshell
Ceph and Openstack in a Nutshell
 
Best Practice of Compression/Decompression Codes in Apache Spark with Sophia...
 Best Practice of Compression/Decompression Codes in Apache Spark with Sophia... Best Practice of Compression/Decompression Codes in Apache Spark with Sophia...
Best Practice of Compression/Decompression Codes in Apache Spark with Sophia...
 
NGINX: HTTP/2 Server Push and gRPC
NGINX: HTTP/2 Server Push and gRPCNGINX: HTTP/2 Server Push and gRPC
NGINX: HTTP/2 Server Push and gRPC
 
An Introduction to SPARQL
An Introduction to SPARQLAn Introduction to SPARQL
An Introduction to SPARQL
 
Escaping Dependency Hell: A deep dive into Gradle's dependency management fea...
Escaping Dependency Hell: A deep dive into Gradle's dependency management fea...Escaping Dependency Hell: A deep dive into Gradle's dependency management fea...
Escaping Dependency Hell: A deep dive into Gradle's dependency management fea...
 
Traffic Insight Using Netflow and Deepfield Systems
Traffic Insight Using Netflow and Deepfield SystemsTraffic Insight Using Netflow and Deepfield Systems
Traffic Insight Using Netflow and Deepfield Systems
 
HTTP2 and gRPC
HTTP2 and gRPCHTTP2 and gRPC
HTTP2 and gRPC
 

Similar to ROS Ecosystem & Applications [HyphaROS] -- by HaoChih

Hypha ROS X 星火計畫 ROS 2.0 Introduction [haochih, English ver]
Hypha ROS X 星火計畫 ROS 2.0 Introduction [haochih, English ver]Hypha ROS X 星火計畫 ROS 2.0 Introduction [haochih, English ver]
Hypha ROS X 星火計畫 ROS 2.0 Introduction [haochih, English ver]HaoChih Lin
 
PHP Training in Ambala ! BATRA COMPUTER CENTRE
PHP Training in Ambala ! BATRA COMPUTER CENTREPHP Training in Ambala ! BATRA COMPUTER CENTRE
PHP Training in Ambala ! BATRA COMPUTER CENTREjatin batra
 
Spring Framework 5.0による Reactive Web Application #JavaDayTokyo
Spring Framework 5.0による Reactive Web Application #JavaDayTokyoSpring Framework 5.0による Reactive Web Application #JavaDayTokyo
Spring Framework 5.0による Reactive Web Application #JavaDayTokyoToshiaki Maki
 
Hire PHP Developer India for smart, reliable and Professional Web Development
Hire PHP Developer India for smart, reliable and Professional Web DevelopmentHire PHP Developer India for smart, reliable and Professional Web Development
Hire PHP Developer India for smart, reliable and Professional Web DevelopmentAResourcePool
 
A REST Layer on Top of the World - IPC13 Munich
A REST Layer on Top of the World - IPC13 MunichA REST Layer on Top of the World - IPC13 Munich
A REST Layer on Top of the World - IPC13 MunichNicolas Pastorino
 
Why Learn PHP Programming?
Why Learn PHP Programming?Why Learn PHP Programming?
Why Learn PHP Programming?XtreemHeights
 
Move your Castle to the Cloud
Move your Castle to the CloudMove your Castle to the Cloud
Move your Castle to the CloudBlaine Carter
 
Develop web APIs in PHP using middleware with Expressive (Code Europe)
Develop web APIs in PHP using middleware with Expressive (Code Europe)Develop web APIs in PHP using middleware with Expressive (Code Europe)
Develop web APIs in PHP using middleware with Expressive (Code Europe)Zend by Rogue Wave Software
 
Introduction to PHP (SDPHP)
Introduction to PHP   (SDPHP)Introduction to PHP   (SDPHP)
Introduction to PHP (SDPHP)Eric Johnson
 
HTMX: Web 1.0 with the benefits of Web 2.0 without the grift of Web 3.0
HTMX: Web 1.0 with the benefits of Web 2.0 without the grift of Web 3.0HTMX: Web 1.0 with the benefits of Web 2.0 without the grift of Web 3.0
HTMX: Web 1.0 with the benefits of Web 2.0 without the grift of Web 3.0Martijn Dashorst
 
Introduction to PHP - SDPHP
Introduction to PHP - SDPHPIntroduction to PHP - SDPHP
Introduction to PHP - SDPHPEric Johnson
 
Running Zeppelin in Enterprise
Running Zeppelin in EnterpriseRunning Zeppelin in Enterprise
Running Zeppelin in EnterpriseDataWorks Summit
 
OpenAPI v.Next - Events, Alternative Schemas & the Road Ahead
OpenAPI v.Next - Events, Alternative Schemas & the Road AheadOpenAPI v.Next - Events, Alternative Schemas & the Road Ahead
OpenAPI v.Next - Events, Alternative Schemas & the Road AheadTed Epstein
 

Similar to ROS Ecosystem & Applications [HyphaROS] -- by HaoChih (20)

Hypha ROS X 星火計畫 ROS 2.0 Introduction [haochih, English ver]
Hypha ROS X 星火計畫 ROS 2.0 Introduction [haochih, English ver]Hypha ROS X 星火計畫 ROS 2.0 Introduction [haochih, English ver]
Hypha ROS X 星火計畫 ROS 2.0 Introduction [haochih, English ver]
 
PHP Training in Ambala ! BATRA COMPUTER CENTRE
PHP Training in Ambala ! BATRA COMPUTER CENTREPHP Training in Ambala ! BATRA COMPUTER CENTRE
PHP Training in Ambala ! BATRA COMPUTER CENTRE
 
Spring Framework 5.0による Reactive Web Application #JavaDayTokyo
Spring Framework 5.0による Reactive Web Application #JavaDayTokyoSpring Framework 5.0による Reactive Web Application #JavaDayTokyo
Spring Framework 5.0による Reactive Web Application #JavaDayTokyo
 
Hire PHP Developer India for smart, reliable and Professional Web Development
Hire PHP Developer India for smart, reliable and Professional Web DevelopmentHire PHP Developer India for smart, reliable and Professional Web Development
Hire PHP Developer India for smart, reliable and Professional Web Development
 
Introduction to chef
Introduction to chefIntroduction to chef
Introduction to chef
 
A REST Layer on Top of the World - IPC13 Munich
A REST Layer on Top of the World - IPC13 MunichA REST Layer on Top of the World - IPC13 Munich
A REST Layer on Top of the World - IPC13 Munich
 
Why Learn PHP Programming?
Why Learn PHP Programming?Why Learn PHP Programming?
Why Learn PHP Programming?
 
Zero to flow
Zero to flowZero to flow
Zero to flow
 
Move your Castle to the Cloud
Move your Castle to the CloudMove your Castle to the Cloud
Move your Castle to the Cloud
 
Develop web APIs in PHP using middleware with Expressive (Code Europe)
Develop web APIs in PHP using middleware with Expressive (Code Europe)Develop web APIs in PHP using middleware with Expressive (Code Europe)
Develop web APIs in PHP using middleware with Expressive (Code Europe)
 
A Checklist for Every API Call
A Checklist for Every API CallA Checklist for Every API Call
A Checklist for Every API Call
 
Introduction to PHP (SDPHP)
Introduction to PHP   (SDPHP)Introduction to PHP   (SDPHP)
Introduction to PHP (SDPHP)
 
HTMX: Web 1.0 with the benefits of Web 2.0 without the grift of Web 3.0
HTMX: Web 1.0 with the benefits of Web 2.0 without the grift of Web 3.0HTMX: Web 1.0 with the benefits of Web 2.0 without the grift of Web 3.0
HTMX: Web 1.0 with the benefits of Web 2.0 without the grift of Web 3.0
 
Expand LibreOffice Contribution to North Africa
Expand LibreOffice Contribution to North AfricaExpand LibreOffice Contribution to North Africa
Expand LibreOffice Contribution to North Africa
 
PHP
 PHP PHP
PHP
 
Introduction to PHP - SDPHP
Introduction to PHP - SDPHPIntroduction to PHP - SDPHP
Introduction to PHP - SDPHP
 
Running Zeppelin in Enterprise
Running Zeppelin in EnterpriseRunning Zeppelin in Enterprise
Running Zeppelin in Enterprise
 
As Novidades do Java EE 8
As Novidades do Java EE 8As Novidades do Java EE 8
As Novidades do Java EE 8
 
Php
PhpPhp
Php
 
OpenAPI v.Next - Events, Alternative Schemas & the Road Ahead
OpenAPI v.Next - Events, Alternative Schemas & the Road AheadOpenAPI v.Next - Events, Alternative Schemas & the Road Ahead
OpenAPI v.Next - Events, Alternative Schemas & the Road Ahead
 

Recently uploaded

CloudStudio User manual (basic edition):
CloudStudio User manual (basic edition):CloudStudio User manual (basic edition):
CloudStudio User manual (basic edition):comworks
 
Dev Dives: Streamline document processing with UiPath Studio Web
Dev Dives: Streamline document processing with UiPath Studio WebDev Dives: Streamline document processing with UiPath Studio Web
Dev Dives: Streamline document processing with UiPath Studio WebUiPathCommunity
 
The Ultimate Guide to Choosing WordPress Pros and Cons
The Ultimate Guide to Choosing WordPress Pros and ConsThe Ultimate Guide to Choosing WordPress Pros and Cons
The Ultimate Guide to Choosing WordPress Pros and ConsPixlogix Infotech
 
Developer Data Modeling Mistakes: From Postgres to NoSQL
Developer Data Modeling Mistakes: From Postgres to NoSQLDeveloper Data Modeling Mistakes: From Postgres to NoSQL
Developer Data Modeling Mistakes: From Postgres to NoSQLScyllaDB
 
Story boards and shot lists for my a level piece
Story boards and shot lists for my a level pieceStory boards and shot lists for my a level piece
Story boards and shot lists for my a level piececharlottematthew16
 
Merck Moving Beyond Passwords: FIDO Paris Seminar.pptx
Merck Moving Beyond Passwords: FIDO Paris Seminar.pptxMerck Moving Beyond Passwords: FIDO Paris Seminar.pptx
Merck Moving Beyond Passwords: FIDO Paris Seminar.pptxLoriGlavin3
 
Connect Wave/ connectwave Pitch Deck Presentation
Connect Wave/ connectwave Pitch Deck PresentationConnect Wave/ connectwave Pitch Deck Presentation
Connect Wave/ connectwave Pitch Deck PresentationSlibray Presentation
 
How to write a Business Continuity Plan
How to write a Business Continuity PlanHow to write a Business Continuity Plan
How to write a Business Continuity PlanDatabarracks
 
Powerpoint exploring the locations used in television show Time Clash
Powerpoint exploring the locations used in television show Time ClashPowerpoint exploring the locations used in television show Time Clash
Powerpoint exploring the locations used in television show Time Clashcharlottematthew16
 
Transcript: New from BookNet Canada for 2024: BNC CataList - Tech Forum 2024
Transcript: New from BookNet Canada for 2024: BNC CataList - Tech Forum 2024Transcript: New from BookNet Canada for 2024: BNC CataList - Tech Forum 2024
Transcript: New from BookNet Canada for 2024: BNC CataList - Tech Forum 2024BookNet Canada
 
Human Factors of XR: Using Human Factors to Design XR Systems
Human Factors of XR: Using Human Factors to Design XR SystemsHuman Factors of XR: Using Human Factors to Design XR Systems
Human Factors of XR: Using Human Factors to Design XR SystemsMark Billinghurst
 
Streamlining Python Development: A Guide to a Modern Project Setup
Streamlining Python Development: A Guide to a Modern Project SetupStreamlining Python Development: A Guide to a Modern Project Setup
Streamlining Python Development: A Guide to a Modern Project SetupFlorian Wilhelm
 
Tampa BSides - Chef's Tour of Microsoft Security Adoption Framework (SAF)
Tampa BSides - Chef's Tour of Microsoft Security Adoption Framework (SAF)Tampa BSides - Chef's Tour of Microsoft Security Adoption Framework (SAF)
Tampa BSides - Chef's Tour of Microsoft Security Adoption Framework (SAF)Mark Simos
 
Anypoint Exchange: It’s Not Just a Repo!
Anypoint Exchange: It’s Not Just a Repo!Anypoint Exchange: It’s Not Just a Repo!
Anypoint Exchange: It’s Not Just a Repo!Manik S Magar
 
Commit 2024 - Secret Management made easy
Commit 2024 - Secret Management made easyCommit 2024 - Secret Management made easy
Commit 2024 - Secret Management made easyAlfredo García Lavilla
 
DevoxxFR 2024 Reproducible Builds with Apache Maven
DevoxxFR 2024 Reproducible Builds with Apache MavenDevoxxFR 2024 Reproducible Builds with Apache Maven
DevoxxFR 2024 Reproducible Builds with Apache MavenHervé Boutemy
 
How AI, OpenAI, and ChatGPT impact business and software.
How AI, OpenAI, and ChatGPT impact business and software.How AI, OpenAI, and ChatGPT impact business and software.
How AI, OpenAI, and ChatGPT impact business and software.Curtis Poe
 
Leverage Zilliz Serverless - Up to 50X Saving for Your Vector Storage Cost
Leverage Zilliz Serverless - Up to 50X Saving for Your Vector Storage CostLeverage Zilliz Serverless - Up to 50X Saving for Your Vector Storage Cost
Leverage Zilliz Serverless - Up to 50X Saving for Your Vector Storage CostZilliz
 
SAP Build Work Zone - Overview L2-L3.pptx
SAP Build Work Zone - Overview L2-L3.pptxSAP Build Work Zone - Overview L2-L3.pptx
SAP Build Work Zone - Overview L2-L3.pptxNavinnSomaal
 

Recently uploaded (20)

CloudStudio User manual (basic edition):
CloudStudio User manual (basic edition):CloudStudio User manual (basic edition):
CloudStudio User manual (basic edition):
 
Dev Dives: Streamline document processing with UiPath Studio Web
Dev Dives: Streamline document processing with UiPath Studio WebDev Dives: Streamline document processing with UiPath Studio Web
Dev Dives: Streamline document processing with UiPath Studio Web
 
The Ultimate Guide to Choosing WordPress Pros and Cons
The Ultimate Guide to Choosing WordPress Pros and ConsThe Ultimate Guide to Choosing WordPress Pros and Cons
The Ultimate Guide to Choosing WordPress Pros and Cons
 
Developer Data Modeling Mistakes: From Postgres to NoSQL
Developer Data Modeling Mistakes: From Postgres to NoSQLDeveloper Data Modeling Mistakes: From Postgres to NoSQL
Developer Data Modeling Mistakes: From Postgres to NoSQL
 
Story boards and shot lists for my a level piece
Story boards and shot lists for my a level pieceStory boards and shot lists for my a level piece
Story boards and shot lists for my a level piece
 
Merck Moving Beyond Passwords: FIDO Paris Seminar.pptx
Merck Moving Beyond Passwords: FIDO Paris Seminar.pptxMerck Moving Beyond Passwords: FIDO Paris Seminar.pptx
Merck Moving Beyond Passwords: FIDO Paris Seminar.pptx
 
Connect Wave/ connectwave Pitch Deck Presentation
Connect Wave/ connectwave Pitch Deck PresentationConnect Wave/ connectwave Pitch Deck Presentation
Connect Wave/ connectwave Pitch Deck Presentation
 
How to write a Business Continuity Plan
How to write a Business Continuity PlanHow to write a Business Continuity Plan
How to write a Business Continuity Plan
 
Powerpoint exploring the locations used in television show Time Clash
Powerpoint exploring the locations used in television show Time ClashPowerpoint exploring the locations used in television show Time Clash
Powerpoint exploring the locations used in television show Time Clash
 
Transcript: New from BookNet Canada for 2024: BNC CataList - Tech Forum 2024
Transcript: New from BookNet Canada for 2024: BNC CataList - Tech Forum 2024Transcript: New from BookNet Canada for 2024: BNC CataList - Tech Forum 2024
Transcript: New from BookNet Canada for 2024: BNC CataList - Tech Forum 2024
 
Human Factors of XR: Using Human Factors to Design XR Systems
Human Factors of XR: Using Human Factors to Design XR SystemsHuman Factors of XR: Using Human Factors to Design XR Systems
Human Factors of XR: Using Human Factors to Design XR Systems
 
Streamlining Python Development: A Guide to a Modern Project Setup
Streamlining Python Development: A Guide to a Modern Project SetupStreamlining Python Development: A Guide to a Modern Project Setup
Streamlining Python Development: A Guide to a Modern Project Setup
 
Tampa BSides - Chef's Tour of Microsoft Security Adoption Framework (SAF)
Tampa BSides - Chef's Tour of Microsoft Security Adoption Framework (SAF)Tampa BSides - Chef's Tour of Microsoft Security Adoption Framework (SAF)
Tampa BSides - Chef's Tour of Microsoft Security Adoption Framework (SAF)
 
Anypoint Exchange: It’s Not Just a Repo!
Anypoint Exchange: It’s Not Just a Repo!Anypoint Exchange: It’s Not Just a Repo!
Anypoint Exchange: It’s Not Just a Repo!
 
Commit 2024 - Secret Management made easy
Commit 2024 - Secret Management made easyCommit 2024 - Secret Management made easy
Commit 2024 - Secret Management made easy
 
DevoxxFR 2024 Reproducible Builds with Apache Maven
DevoxxFR 2024 Reproducible Builds with Apache MavenDevoxxFR 2024 Reproducible Builds with Apache Maven
DevoxxFR 2024 Reproducible Builds with Apache Maven
 
How AI, OpenAI, and ChatGPT impact business and software.
How AI, OpenAI, and ChatGPT impact business and software.How AI, OpenAI, and ChatGPT impact business and software.
How AI, OpenAI, and ChatGPT impact business and software.
 
Leverage Zilliz Serverless - Up to 50X Saving for Your Vector Storage Cost
Leverage Zilliz Serverless - Up to 50X Saving for Your Vector Storage CostLeverage Zilliz Serverless - Up to 50X Saving for Your Vector Storage Cost
Leverage Zilliz Serverless - Up to 50X Saving for Your Vector Storage Cost
 
SAP Build Work Zone - Overview L2-L3.pptx
SAP Build Work Zone - Overview L2-L3.pptxSAP Build Work Zone - Overview L2-L3.pptx
SAP Build Work Zone - Overview L2-L3.pptx
 
DMCC Future of Trade Web3 - Special Edition
DMCC Future of Trade Web3 - Special EditionDMCC Future of Trade Web3 - Special Edition
DMCC Future of Trade Web3 - Special Edition
 

ROS Ecosystem & Applications [HyphaROS] -- by HaoChih