Go to the documentation of this file.00001
00002 import roslib; roslib.load_manifest('cob_controller_configuration_gazebo')
00003
00004 import rospy
00005
00006
00007
00008 from std_msgs.msg import Empty
00009
00010 class gazebo_topics():
00011
00012 def __init__(self):
00013
00014 self.joy_usage_pub = rospy.Publisher("/joy_usage", Empty)
00015 self.pc1_usage_pub = rospy.Publisher("/pc1_usage", Empty)
00016 self.pc2_usage_pub = rospy.Publisher("/pc2_usage", Empty)
00017 self.pc3_usage_pub = rospy.Publisher("/pc3_usage", Empty)
00018 self.wifi_status_pub = rospy.Publisher("/wifi_status", Empty)
00019
00020 rospy.sleep(0.5)
00021
00022
00023 if __name__ == "__main__":
00024 rospy.init_node('gazebo_topics')
00025 gt = gazebo_topics()
00026 rospy.loginfo("gazebo_topics running")
00027
00028 rate = rospy.Rate(1)
00029 while not rospy.is_shutdown():
00030 msg = Empty()
00031 gt.joy_usage_pub.publish(msg)
00032 gt.pc1_usage_pub.publish(msg)
00033 gt.pc2_usage_pub.publish(msg)
00034 gt.pc3_usage_pub.publish(msg)
00035 gt.wifi_status_pub.publish(msg)
00036 rate.sleep()
00037