Search icon
Arrow left icon
All Products
Best Sellers
New Releases
Books
Videos
Audiobooks
Learning Hub
Newsletters
Free Learning
Arrow right icon
Hands-On ROS for Robotics Programming

You're reading from  Hands-On ROS for Robotics Programming

Product type Book
Published in Feb 2020
Publisher Packt
ISBN-13 9781838551308
Pages 432 pages
Edition 1st Edition
Languages
Concepts
Author (1):
Bernardo Ronquillo Japón Bernardo Ronquillo Japón
Profile icon Bernardo Ronquillo Japón

Table of Contents (19) Chapters

Preface Section 1: Physical Robot Assembly and Testing
Assembling the Robot Unit Testing of GoPiGo3 Getting Started with ROS Section 2: Robot Simulation with Gazebo
Creating the Virtual Two-Wheeled ROS Robot Simulating Robot Behavior with Gazebo Section 3: Autonomous Navigation Using SLAM
Programming in ROS - Commands and Tools Robot Control and Simulation Virtual SLAM and Navigation Using Gazebo SLAM for Robot Navigation Section 4: Adaptive Robot Behavior Using Machine Learning
Applying Machine Learning in Robotics Machine Learning with OpenAI Gym Achieve a Goal through Reinforcement Learning Assessment Other Books You May Enjoy

Creating and running publisher and subscriber nodes

If you have understood how the requirement, distance-sensor.py, publisher script works, then the following subscriber script should be pretty straightforward to follow:

#!/usr/bin/env python

import rospy
from sensor_msgs.msg import Range

def callback(msg):
print msg.data
rospy.loginfo(rospy.get_caller_id() + 'GoPiGo3 measures distance %s mm', msg.data*1000)

rospy.init_node('distance_sensor_subscriber')

sub = rospy.Subscriber('distance_sensor/distance', Range, callback)

rospy.spin()

This snippet corresponds to the distance-sensor_subscriber.py file in the ./pkg_mygopigo/src folder of the code for this chapter. The main difference in the subscriber script is that, since we are listening to a topic, we do not need to specify a rate of execution. We simply loop forever with the following line:

rospy...
lock icon The rest of the chapter is locked
Register for a free Packt account to unlock a world of extra content!
A free Packt account unlocks extra newsletters, articles, discounted offers, and much more. Start advancing your knowledge today.
Unlock this book and the full library FREE for 7 days
Get unlimited access to 7000+ expert-authored eBooks and videos courses covering every tech area you can think of
Renews at $15.99/month. Cancel anytime}