int64_publisher.py
Go to the documentation of this file.
00001 #!/usr/bin/env python
00002 from ros import rospy
00003 from ros import std_msgs
00004 import std_msgs.msg
00005 
00006 def publisher():
00007   rospy.init_node('int64_publisher')
00008   pub = rospy.Publisher('int64_in', std_msgs.msg.Int64)
00009   i = 0
00010   r = rospy.Rate(10)
00011   m = std_msgs.msg.Int64(i)
00012   while not rospy.is_shutdown():
00013     pub.publish(m)
00014     i += 1
00015     m.data = i
00016     r.sleep()
00017 
00018 if __name__ == '__main__':
00019   publisher()


rosjava_core
Author(s):
autogenerated on Wed Aug 26 2015 16:06:49