talker.py
Go to the documentation of this file.
1 #!/usr/bin/env python
2 
3 import rospy
4 from std_msgs.msg import String
5 
6 def talker():
7  pub = rospy.Publisher('chatter', String, latch=True)
8  rospy.init_node('talker')
9  while not rospy.is_shutdown():
10  str = "dude"
11  rospy.loginfo(str)
12  pub.publish(String(str))
13  rospy.rostime.wallsleep(1.0)
14 
15 if __name__ == '__main__':
16  try:
17  talker()
18  except rospy.ROSInterruptException:
19  pass
Definition: talker.py:1
def talker()
Definition: talker.py:6


rocon_test
Author(s): Daniel Stonier
autogenerated on Mon Jun 10 2019 14:40:14