5 from jsk_recognition_msgs.msg
import Object
6 from jsk_recognition_msgs.msg
import ObjectArray
12 objects = rospy.get_param(
'~objects')
13 self.
msg = ObjectArray()
16 genpy.message.fill_message_args(obj_msg, obj)
17 self.msg.objects.append(obj_msg)
19 latch = rospy.get_param(
'~latch',
False)
20 self.
_pub = rospy.Publisher(
'~output', ObjectArray, queue_size=1,
26 self.msg.header.stamp = event.current_real
27 self._pub.publish(self.
msg)
30 if __name__ ==
'__main__':
31 rospy.init_node(
'object_array_publisher')
def _timer_cb(self, event)