File: theora_image_transport/Packet.msg
Raw Message Definition
# ROS message adaptation of the ogg_packet struct from libogg,
# see http://www.xiph.org/ogg/doc/libogg/ogg_packet.html.
Header header # Original sensor_msgs/Image header
uint8[] data # Raw Theora packet data (combines packet and bytes fields from ogg_packet)
int32 b_o_s # Flag indicating whether this packet begins a logical bitstream
int32 e_o_s # Flag indicating whether this packet ends a bitstream
int64 granulepos # A number indicating the position of this packet in the decoded data
int64 packetno # Sequential number of this packet in the ogg bitstream
Compact Message Definition
std_msgs/Header header
uint8[] data
int32 b_o_s
int32 e_o_s
int64 granulepos
int64 packetno