cos.py
Go to the documentation of this file.
00001 #!/usr/bin/env python
00002 
00003 import roslib
00004 import rospy
00005 import math
00006 from std_msgs.msg import Float64
00007 from random import random
00008 def main():
00009     rospy.init_node("cos")
00010     pub = rospy.Publisher("/cos", Float64)
00011     counter = 0
00012     RESOLUTION = 100
00013     while not rospy.is_shutdown():
00014         if counter == RESOLUTION:
00015             counter = 0
00016         val = math.cos(2 * math.pi / RESOLUTION * counter)
00017         pub.publish(Float64(val))
00018         rospy.sleep(0.05)
00019         counter = counter + 1
00020 
00021 
00022 if __name__ == "__main__":
00023     main()


rwt_plot
Author(s): Ryohei Ueda
autogenerated on Thu Jun 6 2019 18:13:17