Go to the documentation of this file.00001
00002
00003
00004
00005
00006
00007
00008
00009
00010
00011
00012
00013
00014
00015
00016
00017
00018
00019
00020
00021
00022
00023
00024
00025
00026
00027
00028
00029
00030
00031
00032
00033 """
00034 Player listens to messages from the timeline and publishes them to ROS.
00035 """
00036
00037 import rospy
00038 import rosgraph_msgs
00039
00040 from python_qt_binding.QtCore import QObject
00041
00042 CLOCK_TOPIC = "/clock"
00043
00044
00045 class Player(QObject):
00046
00047 """
00048 This object handles publishing messages as the playhead passes over their position
00049 """
00050
00051 def __init__(self, timeline):
00052 super(Player, self).__init__()
00053 self.timeline = timeline
00054
00055 self._publishing = set()
00056 self._publishers = {}
00057
00058 self._publish_clock = False
00059 self._last_clock = rosgraph_msgs.msg.Clock()
00060 self._resume = False
00061
00062 def resume(self):
00063 self._resume = True
00064
00065 def is_publishing(self, topic):
00066 return topic in self._publishing
00067
00068 def start_publishing(self, topic):
00069 if topic in self._publishing:
00070 return
00071 self._publishing.add(topic)
00072 self.timeline.add_listener(topic, self)
00073
00074 def stop_publishing(self, topic):
00075 if topic not in self._publishing:
00076 return
00077 self.timeline.remove_listener(topic, self)
00078
00079 if topic in self._publishers:
00080 self._publishers[topic].unregister()
00081 del self._publishers[topic]
00082
00083 self._publishing.remove(topic)
00084
00085 def start_clock_publishing(self):
00086 if CLOCK_TOPIC not in self._publishers:
00087
00088 self._publish_clock = self.create_publisher(CLOCK_TOPIC, rosgraph_msgs.msg.Clock())
00089
00090 def stop_clock_publishing(self):
00091 self._publish_clock = False
00092 if CLOCK_TOPIC in self._publishers:
00093 self._publishers[CLOCK_TOPIC].unregister()
00094 del self._publishers[CLOCK_TOPIC]
00095
00096 def stop(self):
00097 for topic in list(self._publishing):
00098 self.stop_publishing(topic)
00099 self.stop_clock_publishing()
00100
00101 def create_publisher(self, topic, msg):
00102 try:
00103 try:
00104 self._publishers[topic] = rospy.Publisher(topic, type(msg), queue_size=100)
00105 except TypeError:
00106 self._publishers[topic] = rospy.Publisher(topic, type(msg))
00107 return True
00108 except Exception as ex:
00109
00110 rospy.logerr('Error creating publisher on topic %s for type %s. \nError text: %s' %
00111 (topic, str(type(msg)), str(ex)))
00112 if topic != CLOCK_TOPIC:
00113 self.stop_publishing(topic)
00114 return False
00115
00116 def message_viewed(self, bag, msg_data):
00117 """
00118 When a message is viewed publish it
00119 :param bag: the bag the message is in, ''rosbag.bag''
00120 :param msg_data: tuple of the message data and topic info, ''(str, msg)''
00121 """
00122
00123 if self.timeline.play_speed <= 0.0:
00124 return
00125
00126 topic, msg, clock = msg_data
00127
00128
00129 if topic not in self._publishers:
00130 self.create_publisher(topic, msg)
00131
00132 if self._publish_clock:
00133 time_msg = rosgraph_msgs.msg.Clock()
00134 time_msg.clock = clock
00135 if self._resume or self._last_clock.clock < time_msg.clock:
00136 self._resume = False
00137 self._last_clock = time_msg
00138 self._publishers[CLOCK_TOPIC].publish(time_msg)
00139 self._publishers[topic].publish(msg)
00140
00141 def message_cleared(self):
00142 pass
00143
00144 def event(self, event):
00145 """
00146 This function will be called to process events posted by post_event
00147 it will call message_cleared or message_viewed with the relevant data
00148 """
00149 bag, msg_data = event.data
00150 if msg_data:
00151 self.message_viewed(bag, msg_data)
00152 else:
00153 self.message_cleared()
00154 return True