SlideShare una empresa de Scribd logo
1 de 17
Descargar para leer sin conexión
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

Más contenido relacionado

La actualidad más candente

Embedding Groovy in a Java Application
Embedding Groovy in a Java ApplicationEmbedding Groovy in a Java Application
Embedding Groovy in a Java Application
Paolo Predonzani
 

La actualidad más candente (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
 

Destacado

ROS - Robotics Operation System
ROS - Robotics Operation SystemROS - Robotics Operation System
ROS - Robotics Operation System
hudvin
 
An Introduction to ROS-Industrial
An Introduction to ROS-IndustrialAn Introduction to ROS-Industrial
An Introduction to ROS-Industrial
Clay Flannigan
 

Destacado (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개의 파일로 간단히 시작하는 로봇 시뮬레이션
 

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

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
 

Similar a 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
 

Más de 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
 
Appetizer Talk Slides
Appetizer Talk SlidesAppetizer Talk Slides
Appetizer Talk Slides
Juxi Leitner
 

Más de 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
 

Último

Why Teams call analytics are critical to your entire business
Why Teams call analytics are critical to your entire businessWhy Teams call analytics are critical to your entire business
Why Teams call analytics are critical to your entire business
panagenda
 

Último (20)

Emergent Methods: Multi-lingual narrative tracking in the news - real-time ex...
Emergent Methods: Multi-lingual narrative tracking in the news - real-time ex...Emergent Methods: Multi-lingual narrative tracking in the news - real-time ex...
Emergent Methods: Multi-lingual narrative tracking in the news - real-time ex...
 
"I see eyes in my soup": How Delivery Hero implemented the safety system for ...
"I see eyes in my soup": How Delivery Hero implemented the safety system for ..."I see eyes in my soup": How Delivery Hero implemented the safety system for ...
"I see eyes in my soup": How Delivery Hero implemented the safety system for ...
 
ProductAnonymous-April2024-WinProductDiscovery-MelissaKlemke
ProductAnonymous-April2024-WinProductDiscovery-MelissaKlemkeProductAnonymous-April2024-WinProductDiscovery-MelissaKlemke
ProductAnonymous-April2024-WinProductDiscovery-MelissaKlemke
 
Ransomware_Q4_2023. The report. [EN].pdf
Ransomware_Q4_2023. The report. [EN].pdfRansomware_Q4_2023. The report. [EN].pdf
Ransomware_Q4_2023. The report. [EN].pdf
 
Apidays Singapore 2024 - Modernizing Securities Finance by Madhu Subbu
Apidays Singapore 2024 - Modernizing Securities Finance by Madhu SubbuApidays Singapore 2024 - Modernizing Securities Finance by Madhu Subbu
Apidays Singapore 2024 - Modernizing Securities Finance by Madhu Subbu
 
Boost Fertility New Invention Ups Success Rates.pdf
Boost Fertility New Invention Ups Success Rates.pdfBoost Fertility New Invention Ups Success Rates.pdf
Boost Fertility New Invention Ups Success Rates.pdf
 
Why Teams call analytics are critical to your entire business
Why Teams call analytics are critical to your entire businessWhy Teams call analytics are critical to your entire business
Why Teams call analytics are critical to your entire business
 
A Year of the Servo Reboot: Where Are We Now?
A Year of the Servo Reboot: Where Are We Now?A Year of the Servo Reboot: Where Are We Now?
A Year of the Servo Reboot: Where Are We Now?
 
ICT role in 21st century education and its challenges
ICT role in 21st century education and its challengesICT role in 21st century education and its challenges
ICT role in 21st century education and its challenges
 
Polkadot JAM Slides - Token2049 - By Dr. Gavin Wood
Polkadot JAM Slides - Token2049 - By Dr. Gavin WoodPolkadot JAM Slides - Token2049 - By Dr. Gavin Wood
Polkadot JAM Slides - Token2049 - By Dr. Gavin Wood
 
DBX First Quarter 2024 Investor Presentation
DBX First Quarter 2024 Investor PresentationDBX First Quarter 2024 Investor Presentation
DBX First Quarter 2024 Investor Presentation
 
FWD Group - Insurer Innovation Award 2024
FWD Group - Insurer Innovation Award 2024FWD Group - Insurer Innovation Award 2024
FWD Group - Insurer Innovation Award 2024
 
presentation ICT roal in 21st century education
presentation ICT roal in 21st century educationpresentation ICT roal in 21st century education
presentation ICT roal in 21st century education
 
EMPOWERMENT TECHNOLOGY GRADE 11 QUARTER 2 REVIEWER
EMPOWERMENT TECHNOLOGY GRADE 11 QUARTER 2 REVIEWEREMPOWERMENT TECHNOLOGY GRADE 11 QUARTER 2 REVIEWER
EMPOWERMENT TECHNOLOGY GRADE 11 QUARTER 2 REVIEWER
 
AXA XL - Insurer Innovation Award Americas 2024
AXA XL - Insurer Innovation Award Americas 2024AXA XL - Insurer Innovation Award Americas 2024
AXA XL - Insurer Innovation Award Americas 2024
 
Apidays New York 2024 - The value of a flexible API Management solution for O...
Apidays New York 2024 - The value of a flexible API Management solution for O...Apidays New York 2024 - The value of a flexible API Management solution for O...
Apidays New York 2024 - The value of a flexible API Management solution for O...
 
Apidays Singapore 2024 - Building Digital Trust in a Digital Economy by Veron...
Apidays Singapore 2024 - Building Digital Trust in a Digital Economy by Veron...Apidays Singapore 2024 - Building Digital Trust in a Digital Economy by Veron...
Apidays Singapore 2024 - Building Digital Trust in a Digital Economy by Veron...
 
MS Copilot expands with MS Graph connectors
MS Copilot expands with MS Graph connectorsMS Copilot expands with MS Graph connectors
MS Copilot expands with MS Graph connectors
 
Apidays New York 2024 - Scaling API-first by Ian Reasor and Radu Cotescu, Adobe
Apidays New York 2024 - Scaling API-first by Ian Reasor and Radu Cotescu, AdobeApidays New York 2024 - Scaling API-first by Ian Reasor and Radu Cotescu, Adobe
Apidays New York 2024 - Scaling API-first by Ian Reasor and Radu Cotescu, Adobe
 
Exploring the Future Potential of AI-Enabled Smartphone Processors
Exploring the Future Potential of AI-Enabled Smartphone ProcessorsExploring the Future Potential of AI-Enabled Smartphone Processors
Exploring the Future Potential of AI-Enabled Smartphone Processors
 

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