7 #define LINEBUFFER_SIZE 8192    23                 istringstream lis(buf);
    32                 SensorMap::const_iterator it=smap.find(sensorname);
    55         is >> pose.
x >> pose.
y >> pose.
theta;
    56         is >> speed.
x >>speed.
theta;
    61         double timestamp, reltimestamp;
    63         is >> timestamp >>s >> reltimestamp;
    71                 string laser_type, start_angle, field_of_view, angular_resolution, maximum_range, accuracy, remission_mode;
    72                 is >> laser_type>> start_angle>> field_of_view>> angular_resolution>> maximum_range>> accuracy>> remission_mode;
    77         assert(size==rs->
beams().size());
    79         reading->resize(size);
    80         for (
unsigned int i=0; i<size; i++){
    85                 is >> reflectionBeams;
    87                 for (
int i=0; i<reflectionBeams; i++)
    91         is >> laserPose.
x >> laserPose.
y >> laserPose.
theta;
    93         is >> pose.
x >> pose.
y >> pose.
theta;
    94         reading->setPose(pose);
    97                 string laser_tv, laser_rv, forward_safety_dist, side_safty_dist, turn_axis;
    98                 is >> laser_tv >> laser_rv >> forward_safety_dist >> side_safty_dist >> turn_axis;
   104         double timestamp, reltimestamp;
   106         is >> timestamp >>s >> reltimestamp;
   107         reading->setTime(timestamp);
   120 LogSensorStream::operator bool()
 const{
   140 InputSensorStream::operator bool()
 const{
 const SensorMap & m_sensorMap
SensorStream(const SensorMap &sensorMap)
const std::vector< Beam > & beams() const
virtual SensorStream & operator>>(const SensorReading *&)
static SensorReading * parseReading(std::istream &is, const SensorMap &smap)
LogSensorStream(const SensorMap &sensorMap, const SensorLog *log)
static OdometryReading * parseOdometry(std::istream &is, const OdometrySensor *)
void setAcceleration(const OrientedPoint &acceleration)
void setSpeed(const OrientedPoint &speed)
std::map< std::string, Sensor * > SensorMap
void setPose(const OrientedPoint &pose)
SensorLog::const_iterator m_cursor
static RangeReading * parseRange(std::istream &is, const RangeSensor *)