SlideShare ist ein Scribd-Unternehmen logo
1 von 17
Downloaden Sie, um offline zu lesen
http://roboticvision.org/
ROS Intro/Tutorial
Juxi Leitner
<j.leitner@roboticvision.org>
http://Juxi.net/
Hands-onV
http://roboticvision.org/
from PHD Comics and Willow Garage
http://roboticvision.org/
Why ROS?
● abstraction
● distributed computation (multi thread, multi computer, multi robot)
● software reuse and rapid testing
http://roboticvision.org/
What is ROS?
● free and open source
● thin, multi-lingual, peer-to-peer
● tools-based
It is NOT a
● programming language or IDE
● (just a) library
● (full) operating system
http://roboticvision.org/
Mount the USB stick and install VirtualBox.
In VirtualBox go to Machine -> Add
 and select the
Ubuntu_14.04_ROS.vbox image from the stick.
How?
Try it out!
http://roboticvision.org/
We need three terminals to run the following commands:
> roscore
> rosrun turtlesim turtlesim_node
> rosrun turtlesim turtle_teleop_key
How?
Try it out!
http://roboticvision.org/
http://roboticvision.org/
ROS Concepts
● Master
● Nodes
● Messages
● Topics
● Services
● Actions
http://roboticvision.org/
Try it out!
Using the same commands from before:
> rosnode list > rostopic list
/rosout /rosout
/teleop_turtle /turtle1/cmd_vel
/turtlesim /turtle1/color_sensor
/turtle1/pose
> rosnode info /turtlesim
> rqt_graph
http://roboticvision.org/
Try it out!
How about the messages?
> rostopic echo /turtle1/cmd_vel
...
> rostopic info /turtle1/cmd_vel
Type: geometry_msgs/Twist
...
> rosmsg show geometry_msgs/Twist
...
http://roboticvision.org/
Logging & Playback
Try it out!
We need three terminals to run:
> rosbag record /turtle1/cmd_vel -O test
[ move the teleop-ed turtle 
]^C
> rosbag info test.bag
path: test.bag
duration: 0.6s
messages: 7
topics: /turtle1/cmd_vel 7 msgs : geometry_msgs/Twist
> rosbag play test.bag
http://roboticvision.org/
> mkdir -p ~/catkin_ws/src
> cd ~/catkin_ws/src
> catkin_init_workspace
> cd ~/catkin_ws
> catkin_make
> source devel/setup.bash
a flexible way of building your projects (CMake inspired)
ROS Workspaces
Try it out!
http://roboticvision.org/
We want you to send data (msgs),
from one running node to another!
#!/usr/bin/env python #!/usr/bin/env python
# Publisher # Publisher
import rospy import rospy
from std_msgs.msg import String from std_msgs.msg import String
... ...
Simple Demo
Try it out!
http://roboticvision.org/
#!/usr/bin/env python #!/usr/bin/env python
# Publisher # Publisher
import rospy import rospy
from std_msgs.msg import String from std_msgs.msg import String
def talker(): def callback(data):
pub = rospy.Publisher('chatter', String, queue_size=10) rospy.loginfo(rospy.get_caller_id() +
rospy.init_node('talker', anonymous=True) "I heard %s", data.data)
rate = rospy.Rate(10) # 10hz
while not rospy.is_shutdown(): def listener():
hello_str = "hello world %s" % rospy.get_time() rospy.init_node('listener', anonymous=True)
rospy.loginfo(hello_str) rospy.Subscriber("chatter", String,
callback)
pub.publish(hello_str) rospy.spin() # keeps python from exiting
rate.sleep()
if __name__ == '__main__': if __name__ == '__main__':
try: listener()
talker()
except rospy.ROSInterruptException:
pass
...
Simple Demo
http://roboticvision.org/
No, ROS is much, much more
● build system (catkin)
● coordinate frame transformations (tf)
● parameter server (rosparam)
● visualization (rviz)
● GUI & monitoring (rqt)
● ...
● your tool to do something awesomeℱ
That’s it?
http://roboticvision.org/
(A) Mobile Base
(B) Kinect 3D sensor
(C) Computing (eeePc)
(D) HW Structure
The TurtleBot
Learn TurtleBot and ROS
http://learn.turtlebot.com/
http://roboticvision.org/
Further Reading
● Morgan Quigley et al. (2009) ROS: an open-source Robot Operating System
● J. M. O'Kane. A Gentle Introduction to ROS: http://www.cse.sc.edu/~jokane/agitr/
● http://wiki.ros.org/ROS/StartGuide
● http://wiki.ros.org/ROS/Tutorials/WhereNext
● Lost? Ask us! And check http://wiki.ros.org & http://answers.ros.org
● http://robohow.eu/_media/meetings/first-integration-workshop/ros-best-practices.pdf

Weitere Àhnliche Inhalte

Was ist angesagt?

Sphinx autodoc - automated api documentation - PyCon.KR 2015
Sphinx autodoc - automated api documentation - PyCon.KR 2015Sphinx autodoc - automated api documentation - PyCon.KR 2015
Sphinx autodoc - automated api documentation - PyCon.KR 2015Takayuki Shimizukawa
 
Sphinx autodoc - automated API documentation (EuroPython 2015 in Bilbao)
Sphinx autodoc - automated API documentation (EuroPython 2015 in Bilbao)Sphinx autodoc - automated API documentation (EuroPython 2015 in Bilbao)
Sphinx autodoc - automated API documentation (EuroPython 2015 in Bilbao)Takayuki Shimizukawa
 
Fighting API Compatibility On Fluentd Using "Black Magic"
Fighting API Compatibility On Fluentd Using "Black Magic"Fighting API Compatibility On Fluentd Using "Black Magic"
Fighting API Compatibility On Fluentd Using "Black Magic"SATOSHI TAGOMORI
 
[2014 CodeEngn Conference 10] 정ꎑ욎 - ì•ˆë“œëĄœìŽë“œì—ì„œë„ 한ëȈ 후í‚č을 í•ŽëłŒêčŒ (Hooking on Android)
[2014 CodeEngn Conference 10] 정ꎑ욎 -  ì•ˆë“œëĄœìŽë“œì—ì„œë„ 한ëȈ 후í‚č을 í•ŽëłŒêčŒ (Hooking on Android)[2014 CodeEngn Conference 10] 정ꎑ욎 -  ì•ˆë“œëĄœìŽë“œì—ì„œë„ 한ëȈ 후í‚č을 í•ŽëłŒêčŒ (Hooking on Android)
[2014 CodeEngn Conference 10] 정ꎑ욎 - ì•ˆë“œëĄœìŽë“œì—ì„œë„ 한ëȈ 후í‚č을 í•ŽëłŒêčŒ (Hooking on Android)GangSeok Lee
 
"Đ Đ°Đ·ĐČОтОД ĐČДтĐșĐž PHP-7"
"Đ Đ°Đ·ĐČОтОД ĐČДтĐșĐž PHP-7""Đ Đ°Đ·ĐČОтОД ĐČДтĐșĐž PHP-7"
"Đ Đ°Đ·ĐČОтОД ĐČДтĐșĐž PHP-7"Badoo Development
 
Modern Black Mages Fighting in the Real World
Modern Black Mages Fighting in the Real WorldModern Black Mages Fighting in the Real World
Modern Black Mages Fighting in the Real WorldSATOSHI TAGOMORI
 
Fluentd Hacking Guide at RubyKaigi 2014
Fluentd Hacking Guide at RubyKaigi 2014Fluentd Hacking Guide at RubyKaigi 2014
Fluentd Hacking Guide at RubyKaigi 2014Naotoshi Seo
 
Middleware as Code with mruby
Middleware as Code with mrubyMiddleware as Code with mruby
Middleware as Code with mrubyHiroshi SHIBATA
 
[CCC-28c3] Post Memory Corruption Memory Analysis
[CCC-28c3] Post Memory Corruption Memory Analysis[CCC-28c3] Post Memory Corruption Memory Analysis
[CCC-28c3] Post Memory Corruption Memory AnalysisMoabi.com
 
A Recovering Java Developer Learns to Go
A Recovering Java Developer Learns to GoA Recovering Java Developer Learns to Go
A Recovering Java Developer Learns to GoMatt Stine
 
Fluentd meetup dive into fluent plugin (outdated)
Fluentd meetup dive into fluent plugin (outdated)Fluentd meetup dive into fluent plugin (outdated)
Fluentd meetup dive into fluent plugin (outdated)N Masahiro
 
PuppetConf 2014 Killer R10K Workflow With Notes
PuppetConf 2014 Killer R10K Workflow With NotesPuppetConf 2014 Killer R10K Workflow With Notes
PuppetConf 2014 Killer R10K Workflow With NotesPhil Zimmerman
 
PyCon Taiwan 2013 Tutorial
PyCon Taiwan 2013 TutorialPyCon Taiwan 2013 Tutorial
PyCon Taiwan 2013 TutorialJustin Lin
 
Thrift+scribećźžçŽ°ćˆ†ćžƒćŒæ—„ćż—æ”¶é›†ïŒŒćč¶äžŽlog4j集成
Thrift+scribećźžçŽ°ćˆ†ćžƒćŒæ—„ćż—æ”¶é›†ïŒŒćč¶äžŽlog4j集成Thrift+scribećźžçŽ°ćˆ†ćžƒćŒæ—„ćż—æ”¶é›†ïŒŒćč¶äžŽlog4j集成
Thrift+scribećźžçŽ°ćˆ†ćžƒćŒæ—„ćż—æ”¶é›†ïŒŒćč¶äžŽlog4j集成zhongbing liu
 
Native hook mechanism in Android Bionic linker
Native hook mechanism in Android Bionic linkerNative hook mechanism in Android Bionic linker
Native hook mechanism in Android Bionic linkerKevin Mai-Hsuan Chia
 
Large-scaled Deploy Over 100 Servers in 3 Minutes
Large-scaled Deploy Over 100 Servers in 3 MinutesLarge-scaled Deploy Over 100 Servers in 3 Minutes
Large-scaled Deploy Over 100 Servers in 3 MinutesHiroshi SHIBATA
 
Embedding Groovy in a Java Application
Embedding Groovy in a Java ApplicationEmbedding Groovy in a Java Application
Embedding Groovy in a Java ApplicationPaolo Predonzani
 
Convert your package to multibuild on Open Build Service
Convert your package to multibuild on Open Build ServiceConvert your package to multibuild on Open Build Service
Convert your package to multibuild on Open Build ServiceSUSE Labs Taipei
 
Infrastructure as code might be literally impossible
Infrastructure as code might be literally impossibleInfrastructure as code might be literally impossible
Infrastructure as code might be literally impossibleice799
 

Was ist angesagt? (20)

Sphinx autodoc - automated api documentation - PyCon.KR 2015
Sphinx autodoc - automated api documentation - PyCon.KR 2015Sphinx autodoc - automated api documentation - PyCon.KR 2015
Sphinx autodoc - automated api documentation - PyCon.KR 2015
 
PHP Development Tools
PHP  Development ToolsPHP  Development Tools
PHP Development Tools
 
Sphinx autodoc - automated API documentation (EuroPython 2015 in Bilbao)
Sphinx autodoc - automated API documentation (EuroPython 2015 in Bilbao)Sphinx autodoc - automated API documentation (EuroPython 2015 in Bilbao)
Sphinx autodoc - automated API documentation (EuroPython 2015 in Bilbao)
 
Fighting API Compatibility On Fluentd Using "Black Magic"
Fighting API Compatibility On Fluentd Using "Black Magic"Fighting API Compatibility On Fluentd Using "Black Magic"
Fighting API Compatibility On Fluentd Using "Black Magic"
 
[2014 CodeEngn Conference 10] 정ꎑ욎 - ì•ˆë“œëĄœìŽë“œì—ì„œë„ 한ëȈ 후í‚č을 í•ŽëłŒêčŒ (Hooking on Android)
[2014 CodeEngn Conference 10] 정ꎑ욎 -  ì•ˆë“œëĄœìŽë“œì—ì„œë„ 한ëȈ 후í‚č을 í•ŽëłŒêčŒ (Hooking on Android)[2014 CodeEngn Conference 10] 정ꎑ욎 -  ì•ˆë“œëĄœìŽë“œì—ì„œë„ 한ëȈ 후í‚č을 í•ŽëłŒêčŒ (Hooking on Android)
[2014 CodeEngn Conference 10] 정ꎑ욎 - ì•ˆë“œëĄœìŽë“œì—ì„œë„ 한ëȈ 후í‚č을 í•ŽëłŒêčŒ (Hooking on Android)
 
"Đ Đ°Đ·ĐČОтОД ĐČДтĐșĐž PHP-7"
"Đ Đ°Đ·ĐČОтОД ĐČДтĐșĐž PHP-7""Đ Đ°Đ·ĐČОтОД ĐČДтĐșĐž PHP-7"
"Đ Đ°Đ·ĐČОтОД ĐČДтĐșĐž PHP-7"
 
Modern Black Mages Fighting in the Real World
Modern Black Mages Fighting in the Real WorldModern Black Mages Fighting in the Real World
Modern Black Mages Fighting in the Real World
 
Fluentd Hacking Guide at RubyKaigi 2014
Fluentd Hacking Guide at RubyKaigi 2014Fluentd Hacking Guide at RubyKaigi 2014
Fluentd Hacking Guide at RubyKaigi 2014
 
Middleware as Code with mruby
Middleware as Code with mrubyMiddleware as Code with mruby
Middleware as Code with mruby
 
[CCC-28c3] Post Memory Corruption Memory Analysis
[CCC-28c3] Post Memory Corruption Memory Analysis[CCC-28c3] Post Memory Corruption Memory Analysis
[CCC-28c3] Post Memory Corruption Memory Analysis
 
A Recovering Java Developer Learns to Go
A Recovering Java Developer Learns to GoA Recovering Java Developer Learns to Go
A Recovering Java Developer Learns to Go
 
Fluentd meetup dive into fluent plugin (outdated)
Fluentd meetup dive into fluent plugin (outdated)Fluentd meetup dive into fluent plugin (outdated)
Fluentd meetup dive into fluent plugin (outdated)
 
PuppetConf 2014 Killer R10K Workflow With Notes
PuppetConf 2014 Killer R10K Workflow With NotesPuppetConf 2014 Killer R10K Workflow With Notes
PuppetConf 2014 Killer R10K Workflow With Notes
 
PyCon Taiwan 2013 Tutorial
PyCon Taiwan 2013 TutorialPyCon Taiwan 2013 Tutorial
PyCon Taiwan 2013 Tutorial
 
Thrift+scribećźžçŽ°ćˆ†ćžƒćŒæ—„ćż—æ”¶é›†ïŒŒćč¶äžŽlog4j集成
Thrift+scribećźžçŽ°ćˆ†ćžƒćŒæ—„ćż—æ”¶é›†ïŒŒćč¶äžŽlog4j集成Thrift+scribećźžçŽ°ćˆ†ćžƒćŒæ—„ćż—æ”¶é›†ïŒŒćč¶äžŽlog4j集成
Thrift+scribećźžçŽ°ćˆ†ćžƒćŒæ—„ćż—æ”¶é›†ïŒŒćč¶äžŽlog4j集成
 
Native hook mechanism in Android Bionic linker
Native hook mechanism in Android Bionic linkerNative hook mechanism in Android Bionic linker
Native hook mechanism in Android Bionic linker
 
Large-scaled Deploy Over 100 Servers in 3 Minutes
Large-scaled Deploy Over 100 Servers in 3 MinutesLarge-scaled Deploy Over 100 Servers in 3 Minutes
Large-scaled Deploy Over 100 Servers in 3 Minutes
 
Embedding Groovy in a Java Application
Embedding Groovy in a Java ApplicationEmbedding Groovy in a Java Application
Embedding Groovy in a Java Application
 
Convert your package to multibuild on Open Build Service
Convert your package to multibuild on Open Build ServiceConvert your package to multibuild on Open Build Service
Convert your package to multibuild on Open Build Service
 
Infrastructure as code might be literally impossible
Infrastructure as code might be literally impossibleInfrastructure as code might be literally impossible
Infrastructure as code might be literally impossible
 

Andere mochten auch

Introduction to ROS (Robot Operating System)
Introduction to ROS (Robot Operating System) Introduction to ROS (Robot Operating System)
Introduction to ROS (Robot Operating System) hvcoup
 
Robot operating systems (ros) overview & (1)
Robot operating systems (ros) overview & (1)Robot operating systems (ros) overview & (1)
Robot operating systems (ros) overview & (1)Piyush Chand
 
Ros based programming and visualization of quadrotor helicopters 110090139 a...
Ros based programming and visualization of quadrotor helicopters  110090139 a...Ros based programming and visualization of quadrotor helicopters  110090139 a...
Ros based programming and visualization of quadrotor helicopters 110090139 a...Atılay Mayadağ
 
ROS - Robotics Operation System
ROS - Robotics Operation SystemROS - Robotics Operation System
ROS - Robotics Operation Systemhudvin
 
An Introduction to ROS-Industrial
An Introduction to ROS-IndustrialAn Introduction to ROS-Industrial
An Introduction to ROS-IndustrialClay Flannigan
 
Gazebo, 9개의 íŒŒìŒëĄœ 간닚히 시작하는 로뮇 ì‹œëźŹë ˆìŽì…˜
Gazebo, 9개의 íŒŒìŒëĄœ 간닚히 시작하는 로뮇 ì‹œëźŹë ˆìŽì…˜Gazebo, 9개의 íŒŒìŒëĄœ 간닚히 시작하는 로뮇 ì‹œëźŹë ˆìŽì…˜
Gazebo, 9개의 íŒŒìŒëĄœ 간닚히 시작하는 로뮇 ì‹œëźŹë ˆìŽì…˜Seongjun Kim
 

Andere mochten auch (9)

Introduction to ROS (Robot Operating System)
Introduction to ROS (Robot Operating System) Introduction to ROS (Robot Operating System)
Introduction to ROS (Robot Operating System)
 
ROS distributed architecture
ROS  distributed architectureROS  distributed architecture
ROS distributed architecture
 
Robot operating systems (ros) overview & (1)
Robot operating systems (ros) overview & (1)Robot operating systems (ros) overview & (1)
Robot operating systems (ros) overview & (1)
 
Ros based programming and visualization of quadrotor helicopters 110090139 a...
Ros based programming and visualization of quadrotor helicopters  110090139 a...Ros based programming and visualization of quadrotor helicopters  110090139 a...
Ros based programming and visualization of quadrotor helicopters 110090139 a...
 
ROS - Robotics Operation System
ROS - Robotics Operation SystemROS - Robotics Operation System
ROS - Robotics Operation System
 
Imaging on embedded GPUs
Imaging on embedded GPUsImaging on embedded GPUs
Imaging on embedded GPUs
 
An Introduction to ROS-Industrial
An Introduction to ROS-IndustrialAn Introduction to ROS-Industrial
An Introduction to ROS-Industrial
 
Simulating TUM Drone 2.0 by ROS
Simulating TUM Drone 2.0  by ROSSimulating TUM Drone 2.0  by ROS
Simulating TUM Drone 2.0 by ROS
 
Gazebo, 9개의 íŒŒìŒëĄœ 간닚히 시작하는 로뮇 ì‹œëźŹë ˆìŽì…˜
Gazebo, 9개의 íŒŒìŒëĄœ 간닚히 시작하는 로뮇 ì‹œëźŹë ˆìŽì…˜Gazebo, 9개의 íŒŒìŒëĄœ 간닚히 시작하는 로뮇 ì‹œëźŹë ˆìŽì…˜
Gazebo, 9개의 íŒŒìŒëĄœ 간닚히 시작하는 로뮇 ì‹œëźŹë ˆìŽì…˜
 

Ähnlich wie ROS Hands-On Intro/Tutorial (Robotic Vision Summer School 2015) #RVSS #ACRV

An OpenShift Primer for Developers to get your Code into the Cloud (PTJUG)
An OpenShift Primer for Developers to get your Code into the Cloud (PTJUG)An OpenShift Primer for Developers to get your Code into the Cloud (PTJUG)
An OpenShift Primer for Developers to get your Code into the Cloud (PTJUG)Eric D. Schabell
 
Exploring the Internet of Things Using Ruby
Exploring the Internet of Things Using RubyExploring the Internet of Things Using Ruby
Exploring the Internet of Things Using RubyMike Hagedorn
 
Open shift
Open shiftOpen shift
Open shiftmarcolof
 
Porting your favourite cmdline tool to Android
Porting your favourite cmdline tool to AndroidPorting your favourite cmdline tool to Android
Porting your favourite cmdline tool to AndroidVlatko Kosturjak
 
Codemotion 2012 Rome - An OpenShift Primer
Codemotion 2012 Rome - An OpenShift PrimerCodemotion 2012 Rome - An OpenShift Primer
Codemotion 2012 Rome - An OpenShift PrimerEric D. Schabell
 
Shared Object images in Docker: What you need is what you want.
Shared Object images in Docker: What you need is what you want.Shared Object images in Docker: What you need is what you want.
Shared Object images in Docker: What you need is what you want.Workhorse Computing
 
Socket.io (part 1)
Socket.io (part 1)Socket.io (part 1)
Socket.io (part 1)Andrea Tarquini
 
Ros with docker 20151107
Ros with docker  20151107Ros with docker  20151107
Ros with docker 20151107Sejin Park
 
The internet of $h1t
The internet of $h1tThe internet of $h1t
The internet of $h1tAmit Serper
 
Docker for Development
Docker for DevelopmentDocker for Development
Docker for Developmentallingeek
 
Cape Cod Web Technology Meetup - 3
Cape Cod Web Technology Meetup - 3Cape Cod Web Technology Meetup - 3
Cape Cod Web Technology Meetup - 3Asher Martin
 
ROS2 on WebOS - Brian Shin(LG)
ROS2 on WebOS - Brian Shin(LG)ROS2 on WebOS - Brian Shin(LG)
ROS2 on WebOS - Brian Shin(LG)AI Robotics KR
 
Container (Docker) Orchestration Tools
Container (Docker) Orchestration ToolsContainer (Docker) Orchestration Tools
Container (Docker) Orchestration ToolsDhilipsiva DS
 
A Fabric/Puppet Build/Deploy System
A Fabric/Puppet Build/Deploy SystemA Fabric/Puppet Build/Deploy System
A Fabric/Puppet Build/Deploy Systemadrian_nye
 
aibo introduction at ROSCon2018@Madrid
aibo introduction at ROSCon2018@Madridaibo introduction at ROSCon2018@Madrid
aibo introduction at ROSCon2018@MadridTomoya Fujita
 
How to create multiprocess server on windows with ruby - rubykaigi2016 Ritta ...
How to create multiprocess server on windows with ruby - rubykaigi2016 Ritta ...How to create multiprocess server on windows with ruby - rubykaigi2016 Ritta ...
How to create multiprocess server on windows with ruby - rubykaigi2016 Ritta ...Ritta Narita
 
Software Quality Assurance Tooling - Wintersession 2024
Software Quality Assurance Tooling - Wintersession 2024Software Quality Assurance Tooling - Wintersession 2024
Software Quality Assurance Tooling - Wintersession 2024Henry Schreiner
 

Ähnlich wie ROS Hands-On Intro/Tutorial (Robotic Vision Summer School 2015) #RVSS #ACRV (20)

An OpenShift Primer for Developers to get your Code into the Cloud (PTJUG)
An OpenShift Primer for Developers to get your Code into the Cloud (PTJUG)An OpenShift Primer for Developers to get your Code into the Cloud (PTJUG)
An OpenShift Primer for Developers to get your Code into the Cloud (PTJUG)
 
Exploring the Internet of Things Using Ruby
Exploring the Internet of Things Using RubyExploring the Internet of Things Using Ruby
Exploring the Internet of Things Using Ruby
 
Open shift
Open shiftOpen shift
Open shift
 
6202942
62029426202942
6202942
 
Porting your favourite cmdline tool to Android
Porting your favourite cmdline tool to AndroidPorting your favourite cmdline tool to Android
Porting your favourite cmdline tool to Android
 
Codemotion 2012 Rome - An OpenShift Primer
Codemotion 2012 Rome - An OpenShift PrimerCodemotion 2012 Rome - An OpenShift Primer
Codemotion 2012 Rome - An OpenShift Primer
 
XRobots
XRobotsXRobots
XRobots
 
Shared Object images in Docker: What you need is what you want.
Shared Object images in Docker: What you need is what you want.Shared Object images in Docker: What you need is what you want.
Shared Object images in Docker: What you need is what you want.
 
Socket.io (part 1)
Socket.io (part 1)Socket.io (part 1)
Socket.io (part 1)
 
Ros with docker 20151107
Ros with docker  20151107Ros with docker  20151107
Ros with docker 20151107
 
The internet of $h1t
The internet of $h1tThe internet of $h1t
The internet of $h1t
 
Docker for Development
Docker for DevelopmentDocker for Development
Docker for Development
 
Cape Cod Web Technology Meetup - 3
Cape Cod Web Technology Meetup - 3Cape Cod Web Technology Meetup - 3
Cape Cod Web Technology Meetup - 3
 
ROS2 on WebOS - Brian Shin(LG)
ROS2 on WebOS - Brian Shin(LG)ROS2 on WebOS - Brian Shin(LG)
ROS2 on WebOS - Brian Shin(LG)
 
ROS and Unity.pdf
ROS and Unity.pdfROS and Unity.pdf
ROS and Unity.pdf
 
Container (Docker) Orchestration Tools
Container (Docker) Orchestration ToolsContainer (Docker) Orchestration Tools
Container (Docker) Orchestration Tools
 
A Fabric/Puppet Build/Deploy System
A Fabric/Puppet Build/Deploy SystemA Fabric/Puppet Build/Deploy System
A Fabric/Puppet Build/Deploy System
 
aibo introduction at ROSCon2018@Madrid
aibo introduction at ROSCon2018@Madridaibo introduction at ROSCon2018@Madrid
aibo introduction at ROSCon2018@Madrid
 
How to create multiprocess server on windows with ruby - rubykaigi2016 Ritta ...
How to create multiprocess server on windows with ruby - rubykaigi2016 Ritta ...How to create multiprocess server on windows with ruby - rubykaigi2016 Ritta ...
How to create multiprocess server on windows with ruby - rubykaigi2016 Ritta ...
 
Software Quality Assurance Tooling - Wintersession 2024
Software Quality Assurance Tooling - Wintersession 2024Software Quality Assurance Tooling - Wintersession 2024
Software Quality Assurance Tooling - Wintersession 2024
 

Mehr von Juxi Leitner

The Need For Robots To Grasp the World
The Need For Robots To Grasp the WorldThe Need For Robots To Grasp the World
The Need For Robots To Grasp the WorldJuxi Leitner
 
Robots that Grasp the World
Robots that Grasp the WorldRobots that Grasp the World
Robots that Grasp the WorldJuxi Leitner
 
Improving Robotic Manipulation with Vision and Learning @AmazonDevCentre Berlin
Improving Robotic Manipulation with Vision and Learning @AmazonDevCentre BerlinImproving Robotic Manipulation with Vision and Learning @AmazonDevCentre Berlin
Improving Robotic Manipulation with Vision and Learning @AmazonDevCentre BerlinJuxi Leitner
 
Cartman, how to win the amazon robotics challenge with robotic vision and dee...
Cartman, how to win the amazon robotics challenge with robotic vision and dee...Cartman, how to win the amazon robotics challenge with robotic vision and dee...
Cartman, how to win the amazon robotics challenge with robotic vision and dee...Juxi Leitner
 
Deep Reinforcement Learning | Amazon Robotics Challenge, Image Processing Lec...
Deep Reinforcement Learning | Amazon Robotics Challenge, Image Processing Lec...Deep Reinforcement Learning | Amazon Robotics Challenge, Image Processing Lec...
Deep Reinforcement Learning | Amazon Robotics Challenge, Image Processing Lec...Juxi Leitner
 
ACRV Picking Benchmark: how to benchmark pick and place robotics research
ACRV Picking Benchmark: how to benchmark pick and place robotics researchACRV Picking Benchmark: how to benchmark pick and place robotics research
ACRV Picking Benchmark: how to benchmark pick and place robotics researchJuxi Leitner
 
Team ACRV's experience at #AmazonPickingChallenge 2016
Team ACRV's experience at #AmazonPickingChallenge 2016Team ACRV's experience at #AmazonPickingChallenge 2016
Team ACRV's experience at #AmazonPickingChallenge 2016Juxi Leitner
 
(deep) reinforcement learning - CAB420
(deep) reinforcement learning - CAB420(deep) reinforcement learning - CAB420
(deep) reinforcement learning - CAB420Juxi Leitner
 
ACRV : Robotic Vision presentation in Lisbon at IST
ACRV : Robotic Vision presentation in Lisbon at ISTACRV : Robotic Vision presentation in Lisbon at IST
ACRV : Robotic Vision presentation in Lisbon at ISTJuxi Leitner
 
The Australian Centre for Robotic Vision (ACRV)
The Australian Centre for Robotic Vision (ACRV)The Australian Centre for Robotic Vision (ACRV)
The Australian Centre for Robotic Vision (ACRV)Juxi Leitner
 
How to place 6th in the Amazon Picking Challenge (ENB329, QUT)
How to place 6th in the Amazon Picking Challenge (ENB329, QUT)How to place 6th in the Amazon Picking Challenge (ENB329, QUT)
How to place 6th in the Amazon Picking Challenge (ENB329, QUT)Juxi Leitner
 
LunaRoo: Designing a Hopping Lunar Science Payload #space #exploration
LunaRoo: Designing a Hopping Lunar Science Payload #space #explorationLunaRoo: Designing a Hopping Lunar Science Payload #space #exploration
LunaRoo: Designing a Hopping Lunar Science Payload #space #explorationJuxi Leitner
 
Robotic Vision - Vision for Robotics #IEEE #QLD #CIS #Colloquium
Robotic Vision - Vision for Robotics #IEEE #QLD #CIS #ColloquiumRobotic Vision - Vision for Robotics #IEEE #QLD #CIS #Colloquium
Robotic Vision - Vision for Robotics #IEEE #QLD #CIS #ColloquiumJuxi Leitner
 
ACRV Research Fellow Intro/Tutorial [Vision and Action]
ACRV Research Fellow Intro/Tutorial [Vision and Action]ACRV Research Fellow Intro/Tutorial [Vision and Action]
ACRV Research Fellow Intro/Tutorial [Vision and Action]Juxi Leitner
 
From Vision to Actions - Towards Adaptive & Autonomous Humanoid Robots [PhD D...
From Vision to Actions - Towards Adaptive & Autonomous Humanoid Robots [PhD D...From Vision to Actions - Towards Adaptive & Autonomous Humanoid Robots [PhD D...
From Vision to Actions - Towards Adaptive & Autonomous Humanoid Robots [PhD D...Juxi Leitner
 
Reactive Reaching and Grasping on a Humanoid: Towards Closing the Action-Perc...
Reactive Reaching and Grasping on a Humanoid: Towards Closing the Action-Perc...Reactive Reaching and Grasping on a Humanoid: Towards Closing the Action-Perc...
Reactive Reaching and Grasping on a Humanoid: Towards Closing the Action-Perc...Juxi Leitner
 
Tele-operation of a Humanoid Robot, Using Operator Bio-data
Tele-operation of a Humanoid Robot, Using Operator Bio-dataTele-operation of a Humanoid Robot, Using Operator Bio-data
Tele-operation of a Humanoid Robot, Using Operator Bio-dataJuxi Leitner
 
Improving Robot Vision Models for Object Detection Through Interaction #ijcnn...
Improving Robot Vision Models for Object Detection Through Interaction #ijcnn...Improving Robot Vision Models for Object Detection Through Interaction #ijcnn...
Improving Robot Vision Models for Object Detection Through Interaction #ijcnn...Juxi Leitner
 
How does it feel to be a SpaceMaster? [Erasmus Mundus - ACE Talk]
How does it feel to be a SpaceMaster? [Erasmus Mundus - ACE Talk]How does it feel to be a SpaceMaster? [Erasmus Mundus - ACE Talk]
How does it feel to be a SpaceMaster? [Erasmus Mundus - ACE Talk]Juxi Leitner
 
Appetizer Talk Slides
Appetizer Talk SlidesAppetizer Talk Slides
Appetizer Talk SlidesJuxi Leitner
 

Mehr von Juxi Leitner (20)

The Need For Robots To Grasp the World
The Need For Robots To Grasp the WorldThe Need For Robots To Grasp the World
The Need For Robots To Grasp the World
 
Robots that Grasp the World
Robots that Grasp the WorldRobots that Grasp the World
Robots that Grasp the World
 
Improving Robotic Manipulation with Vision and Learning @AmazonDevCentre Berlin
Improving Robotic Manipulation with Vision and Learning @AmazonDevCentre BerlinImproving Robotic Manipulation with Vision and Learning @AmazonDevCentre Berlin
Improving Robotic Manipulation with Vision and Learning @AmazonDevCentre Berlin
 
Cartman, how to win the amazon robotics challenge with robotic vision and dee...
Cartman, how to win the amazon robotics challenge with robotic vision and dee...Cartman, how to win the amazon robotics challenge with robotic vision and dee...
Cartman, how to win the amazon robotics challenge with robotic vision and dee...
 
Deep Reinforcement Learning | Amazon Robotics Challenge, Image Processing Lec...
Deep Reinforcement Learning | Amazon Robotics Challenge, Image Processing Lec...Deep Reinforcement Learning | Amazon Robotics Challenge, Image Processing Lec...
Deep Reinforcement Learning | Amazon Robotics Challenge, Image Processing Lec...
 
ACRV Picking Benchmark: how to benchmark pick and place robotics research
ACRV Picking Benchmark: how to benchmark pick and place robotics researchACRV Picking Benchmark: how to benchmark pick and place robotics research
ACRV Picking Benchmark: how to benchmark pick and place robotics research
 
Team ACRV's experience at #AmazonPickingChallenge 2016
Team ACRV's experience at #AmazonPickingChallenge 2016Team ACRV's experience at #AmazonPickingChallenge 2016
Team ACRV's experience at #AmazonPickingChallenge 2016
 
(deep) reinforcement learning - CAB420
(deep) reinforcement learning - CAB420(deep) reinforcement learning - CAB420
(deep) reinforcement learning - CAB420
 
ACRV : Robotic Vision presentation in Lisbon at IST
ACRV : Robotic Vision presentation in Lisbon at ISTACRV : Robotic Vision presentation in Lisbon at IST
ACRV : Robotic Vision presentation in Lisbon at IST
 
The Australian Centre for Robotic Vision (ACRV)
The Australian Centre for Robotic Vision (ACRV)The Australian Centre for Robotic Vision (ACRV)
The Australian Centre for Robotic Vision (ACRV)
 
How to place 6th in the Amazon Picking Challenge (ENB329, QUT)
How to place 6th in the Amazon Picking Challenge (ENB329, QUT)How to place 6th in the Amazon Picking Challenge (ENB329, QUT)
How to place 6th in the Amazon Picking Challenge (ENB329, QUT)
 
LunaRoo: Designing a Hopping Lunar Science Payload #space #exploration
LunaRoo: Designing a Hopping Lunar Science Payload #space #explorationLunaRoo: Designing a Hopping Lunar Science Payload #space #exploration
LunaRoo: Designing a Hopping Lunar Science Payload #space #exploration
 
Robotic Vision - Vision for Robotics #IEEE #QLD #CIS #Colloquium
Robotic Vision - Vision for Robotics #IEEE #QLD #CIS #ColloquiumRobotic Vision - Vision for Robotics #IEEE #QLD #CIS #Colloquium
Robotic Vision - Vision for Robotics #IEEE #QLD #CIS #Colloquium
 
ACRV Research Fellow Intro/Tutorial [Vision and Action]
ACRV Research Fellow Intro/Tutorial [Vision and Action]ACRV Research Fellow Intro/Tutorial [Vision and Action]
ACRV Research Fellow Intro/Tutorial [Vision and Action]
 
From Vision to Actions - Towards Adaptive & Autonomous Humanoid Robots [PhD D...
From Vision to Actions - Towards Adaptive & Autonomous Humanoid Robots [PhD D...From Vision to Actions - Towards Adaptive & Autonomous Humanoid Robots [PhD D...
From Vision to Actions - Towards Adaptive & Autonomous Humanoid Robots [PhD D...
 
Reactive Reaching and Grasping on a Humanoid: Towards Closing the Action-Perc...
Reactive Reaching and Grasping on a Humanoid: Towards Closing the Action-Perc...Reactive Reaching and Grasping on a Humanoid: Towards Closing the Action-Perc...
Reactive Reaching and Grasping on a Humanoid: Towards Closing the Action-Perc...
 
Tele-operation of a Humanoid Robot, Using Operator Bio-data
Tele-operation of a Humanoid Robot, Using Operator Bio-dataTele-operation of a Humanoid Robot, Using Operator Bio-data
Tele-operation of a Humanoid Robot, Using Operator Bio-data
 
Improving Robot Vision Models for Object Detection Through Interaction #ijcnn...
Improving Robot Vision Models for Object Detection Through Interaction #ijcnn...Improving Robot Vision Models for Object Detection Through Interaction #ijcnn...
Improving Robot Vision Models for Object Detection Through Interaction #ijcnn...
 
How does it feel to be a SpaceMaster? [Erasmus Mundus - ACE Talk]
How does it feel to be a SpaceMaster? [Erasmus Mundus - ACE Talk]How does it feel to be a SpaceMaster? [Erasmus Mundus - ACE Talk]
How does it feel to be a SpaceMaster? [Erasmus Mundus - ACE Talk]
 
Appetizer Talk Slides
Appetizer Talk SlidesAppetizer Talk Slides
Appetizer Talk Slides
 

KĂŒrzlich hochgeladen

How to convert PDF to text with Nanonets
How to convert PDF to text with NanonetsHow to convert PDF to text with Nanonets
How to convert PDF to text with Nanonetsnaman860154
 
The Evolution of Money: Digital Transformation and CBDCs in Central Banking
The Evolution of Money: Digital Transformation and CBDCs in Central BankingThe Evolution of Money: Digital Transformation and CBDCs in Central Banking
The Evolution of Money: Digital Transformation and CBDCs in Central BankingSelcen Ozturkcan
 
Unblocking The Main Thread Solving ANRs and Frozen Frames
Unblocking The Main Thread Solving ANRs and Frozen FramesUnblocking The Main Thread Solving ANRs and Frozen Frames
Unblocking The Main Thread Solving ANRs and Frozen FramesSinan KOZAK
 
Kalyanpur ) Call Girls in Lucknow Finest Escorts Service 🍾 8923113531 🎰 Avail...
Kalyanpur ) Call Girls in Lucknow Finest Escorts Service 🍾 8923113531 🎰 Avail...Kalyanpur ) Call Girls in Lucknow Finest Escorts Service 🍾 8923113531 🎰 Avail...
Kalyanpur ) Call Girls in Lucknow Finest Escorts Service 🍾 8923113531 🎰 Avail...gurkirankumar98700
 
Breaking the Kubernetes Kill Chain: Host Path Mount
Breaking the Kubernetes Kill Chain: Host Path MountBreaking the Kubernetes Kill Chain: Host Path Mount
Breaking the Kubernetes Kill Chain: Host Path MountPuma Security, LLC
 
IAC 2024 - IA Fast Track to Search Focused AI Solutions
IAC 2024 - IA Fast Track to Search Focused AI SolutionsIAC 2024 - IA Fast Track to Search Focused AI Solutions
IAC 2024 - IA Fast Track to Search Focused AI SolutionsEnterprise Knowledge
 
Handwritten Text Recognition for manuscripts and early printed texts
Handwritten Text Recognition for manuscripts and early printed textsHandwritten Text Recognition for manuscripts and early printed texts
Handwritten Text Recognition for manuscripts and early printed textsMaria Levchenko
 
FULL ENJOY 🔝 8264348440 🔝 Call Girls in Diplomatic Enclave | Delhi
FULL ENJOY 🔝 8264348440 🔝 Call Girls in Diplomatic Enclave | DelhiFULL ENJOY 🔝 8264348440 🔝 Call Girls in Diplomatic Enclave | Delhi
FULL ENJOY 🔝 8264348440 🔝 Call Girls in Diplomatic Enclave | Delhisoniya singh
 
08448380779 Call Girls In Friends Colony Women Seeking Men
08448380779 Call Girls In Friends Colony Women Seeking Men08448380779 Call Girls In Friends Colony Women Seeking Men
08448380779 Call Girls In Friends Colony Women Seeking MenDelhi Call girls
 
Swan(sea) Song – personal research during my six years at Swansea ... and bey...
Swan(sea) Song – personal research during my six years at Swansea ... and bey...Swan(sea) Song – personal research during my six years at Swansea ... and bey...
Swan(sea) Song – personal research during my six years at Swansea ... and bey...Alan Dix
 
A Call to Action for Generative AI in 2024
A Call to Action for Generative AI in 2024A Call to Action for Generative AI in 2024
A Call to Action for Generative AI in 2024Results
 
Automating Business Process via MuleSoft Composer | Bangalore MuleSoft Meetup...
Automating Business Process via MuleSoft Composer | Bangalore MuleSoft Meetup...Automating Business Process via MuleSoft Composer | Bangalore MuleSoft Meetup...
Automating Business Process via MuleSoft Composer | Bangalore MuleSoft Meetup...shyamraj55
 
🐬 The future of MySQL is Postgres 🐘
🐬  The future of MySQL is Postgres   🐘🐬  The future of MySQL is Postgres   🐘
🐬 The future of MySQL is Postgres 🐘RTylerCroy
 
My Hashitalk Indonesia April 2024 Presentation
My Hashitalk Indonesia April 2024 PresentationMy Hashitalk Indonesia April 2024 Presentation
My Hashitalk Indonesia April 2024 PresentationRidwan Fadjar
 
Injustice - Developers Among Us (SciFiDevCon 2024)
Injustice - Developers Among Us (SciFiDevCon 2024)Injustice - Developers Among Us (SciFiDevCon 2024)
Injustice - Developers Among Us (SciFiDevCon 2024)Allon Mureinik
 
Transforming Data Streams with Kafka Connect: An Introduction to Single Messa...
Transforming Data Streams with Kafka Connect: An Introduction to Single Messa...Transforming Data Streams with Kafka Connect: An Introduction to Single Messa...
Transforming Data Streams with Kafka Connect: An Introduction to Single Messa...HostedbyConfluent
 
GenCyber Cyber Security Day Presentation
GenCyber Cyber Security Day PresentationGenCyber Cyber Security Day Presentation
GenCyber Cyber Security Day PresentationMichael W. Hawkins
 
Strategies for Unlocking Knowledge Management in Microsoft 365 in the Copilot...
Strategies for Unlocking Knowledge Management in Microsoft 365 in the Copilot...Strategies for Unlocking Knowledge Management in Microsoft 365 in the Copilot...
Strategies for Unlocking Knowledge Management in Microsoft 365 in the Copilot...Drew Madelung
 
Boost PC performance: How more available memory can improve productivity
Boost PC performance: How more available memory can improve productivityBoost PC performance: How more available memory can improve productivity
Boost PC performance: How more available memory can improve productivityPrincipled Technologies
 
The Role of Taxonomy and Ontology in Semantic Layers - Heather Hedden.pdf
The Role of Taxonomy and Ontology in Semantic Layers - Heather Hedden.pdfThe Role of Taxonomy and Ontology in Semantic Layers - Heather Hedden.pdf
The Role of Taxonomy and Ontology in Semantic Layers - Heather Hedden.pdfEnterprise Knowledge
 

KĂŒrzlich hochgeladen (20)

How to convert PDF to text with Nanonets
How to convert PDF to text with NanonetsHow to convert PDF to text with Nanonets
How to convert PDF to text with Nanonets
 
The Evolution of Money: Digital Transformation and CBDCs in Central Banking
The Evolution of Money: Digital Transformation and CBDCs in Central BankingThe Evolution of Money: Digital Transformation and CBDCs in Central Banking
The Evolution of Money: Digital Transformation and CBDCs in Central Banking
 
Unblocking The Main Thread Solving ANRs and Frozen Frames
Unblocking The Main Thread Solving ANRs and Frozen FramesUnblocking The Main Thread Solving ANRs and Frozen Frames
Unblocking The Main Thread Solving ANRs and Frozen Frames
 
Kalyanpur ) Call Girls in Lucknow Finest Escorts Service 🍾 8923113531 🎰 Avail...
Kalyanpur ) Call Girls in Lucknow Finest Escorts Service 🍾 8923113531 🎰 Avail...Kalyanpur ) Call Girls in Lucknow Finest Escorts Service 🍾 8923113531 🎰 Avail...
Kalyanpur ) Call Girls in Lucknow Finest Escorts Service 🍾 8923113531 🎰 Avail...
 
Breaking the Kubernetes Kill Chain: Host Path Mount
Breaking the Kubernetes Kill Chain: Host Path MountBreaking the Kubernetes Kill Chain: Host Path Mount
Breaking the Kubernetes Kill Chain: Host Path Mount
 
IAC 2024 - IA Fast Track to Search Focused AI Solutions
IAC 2024 - IA Fast Track to Search Focused AI SolutionsIAC 2024 - IA Fast Track to Search Focused AI Solutions
IAC 2024 - IA Fast Track to Search Focused AI Solutions
 
Handwritten Text Recognition for manuscripts and early printed texts
Handwritten Text Recognition for manuscripts and early printed textsHandwritten Text Recognition for manuscripts and early printed texts
Handwritten Text Recognition for manuscripts and early printed texts
 
FULL ENJOY 🔝 8264348440 🔝 Call Girls in Diplomatic Enclave | Delhi
FULL ENJOY 🔝 8264348440 🔝 Call Girls in Diplomatic Enclave | DelhiFULL ENJOY 🔝 8264348440 🔝 Call Girls in Diplomatic Enclave | Delhi
FULL ENJOY 🔝 8264348440 🔝 Call Girls in Diplomatic Enclave | Delhi
 
08448380779 Call Girls In Friends Colony Women Seeking Men
08448380779 Call Girls In Friends Colony Women Seeking Men08448380779 Call Girls In Friends Colony Women Seeking Men
08448380779 Call Girls In Friends Colony Women Seeking Men
 
Swan(sea) Song – personal research during my six years at Swansea ... and bey...
Swan(sea) Song – personal research during my six years at Swansea ... and bey...Swan(sea) Song – personal research during my six years at Swansea ... and bey...
Swan(sea) Song – personal research during my six years at Swansea ... and bey...
 
A Call to Action for Generative AI in 2024
A Call to Action for Generative AI in 2024A Call to Action for Generative AI in 2024
A Call to Action for Generative AI in 2024
 
Automating Business Process via MuleSoft Composer | Bangalore MuleSoft Meetup...
Automating Business Process via MuleSoft Composer | Bangalore MuleSoft Meetup...Automating Business Process via MuleSoft Composer | Bangalore MuleSoft Meetup...
Automating Business Process via MuleSoft Composer | Bangalore MuleSoft Meetup...
 
🐬 The future of MySQL is Postgres 🐘
🐬  The future of MySQL is Postgres   🐘🐬  The future of MySQL is Postgres   🐘
🐬 The future of MySQL is Postgres 🐘
 
My Hashitalk Indonesia April 2024 Presentation
My Hashitalk Indonesia April 2024 PresentationMy Hashitalk Indonesia April 2024 Presentation
My Hashitalk Indonesia April 2024 Presentation
 
Injustice - Developers Among Us (SciFiDevCon 2024)
Injustice - Developers Among Us (SciFiDevCon 2024)Injustice - Developers Among Us (SciFiDevCon 2024)
Injustice - Developers Among Us (SciFiDevCon 2024)
 
Transforming Data Streams with Kafka Connect: An Introduction to Single Messa...
Transforming Data Streams with Kafka Connect: An Introduction to Single Messa...Transforming Data Streams with Kafka Connect: An Introduction to Single Messa...
Transforming Data Streams with Kafka Connect: An Introduction to Single Messa...
 
GenCyber Cyber Security Day Presentation
GenCyber Cyber Security Day PresentationGenCyber Cyber Security Day Presentation
GenCyber Cyber Security Day Presentation
 
Strategies for Unlocking Knowledge Management in Microsoft 365 in the Copilot...
Strategies for Unlocking Knowledge Management in Microsoft 365 in the Copilot...Strategies for Unlocking Knowledge Management in Microsoft 365 in the Copilot...
Strategies for Unlocking Knowledge Management in Microsoft 365 in the Copilot...
 
Boost PC performance: How more available memory can improve productivity
Boost PC performance: How more available memory can improve productivityBoost PC performance: How more available memory can improve productivity
Boost PC performance: How more available memory can improve productivity
 
The Role of Taxonomy and Ontology in Semantic Layers - Heather Hedden.pdf
The Role of Taxonomy and Ontology in Semantic Layers - Heather Hedden.pdfThe Role of Taxonomy and Ontology in Semantic Layers - Heather Hedden.pdf
The Role of Taxonomy and Ontology in Semantic Layers - Heather Hedden.pdf
 

ROS Hands-On Intro/Tutorial (Robotic Vision Summer School 2015) #RVSS #ACRV