ROS Resources: Documentation | Support | Discussion Forum | Index | Service Status | ros @ Robotics Stack Exchange |
1 | initial version |
An example might look like this (roughly):
import rospy
from std_msgs.msg import Int32
class Echo(object):
def __init__(self):
self.value = 0
rospy.init_node('echoer')
self.pub = rospy.Publisher('/out_value', Int32, latch=True)
rospy.Subscriber('/in_value', Int32, self.update_value)
def update_value(self, msg):
self.value = msg.data
def run(self):
r = rospy.Rate(10)
while not rospy.is_shutdown():
self.pub.publish(self.value)
2 | No.2 Revision |
An example might look like this (roughly):
import rospy
from std_msgs.msg import Int32
class Echo(object):
def __init__(self):
self.value = 0
rospy.init_node('echoer')
self.pub = rospy.Publisher('/out_value', Int32, latch=True)
rospy.Subscriber('/in_value', Int32, self.update_value)
def update_value(self, msg):
self.value = msg.data
def run(self):
r = rospy.Rate(10)
while not rospy.is_shutdown():
self.pub.publish(self.value)
r.sleep()