9 #define LINEBUFFER_SIZE 100000    19         for (iterator it=begin(); it!=end(); it++)
    20                 if (*it) 
delete (*it);
    24         for (iterator it=begin(); it!=end(); it++)
    25                 if (*it) 
delete (*it);
    31                 istringstream lis(buf);
    42                 SensorMap::const_iterator it=
m_sensorMap.find(sensorname);
    69         is >> pose.
x >> pose.
y >> pose.
theta;
    70         is >> speed.
x >>speed.
theta;
    80                 string laser_type, start_angle, field_of_view, angular_resolution, maximum_range, accuracy, remission_mode;
    81                 is >> laser_type>> start_angle>> field_of_view>> angular_resolution>> maximum_range>> accuracy >> remission_mode;
    86         assert(size==rs->
beams().size());
    90         reading->resize(size);
    91         for (
unsigned int i=0; i<size; i++){
    96                 is >> reflectionBeams;
    98                 for (
int i=0; i<reflectionBeams; i++)
   103         is >> laserPose.
x >> laserPose.
y >> laserPose.
theta;
   105         is >> pose.
x >> pose.
y >> pose.
theta; 
   106         reading->setPose(pose);
   109                 string laser_tv, laser_rv, forward_safety_dist, side_safty_dist, turn_axis;
   110                 is >> laser_tv >> laser_rv >> forward_safety_dist >> side_safty_dist >> turn_axis;
   126         for (const_iterator it=begin(); it!=end(); it++){
   127                 double lxmin=0., lxmax=0., lymin=0., lymax=0.;
   137                         lxmin=lxmax=rangeReading->
getPose().
x;
   138                         lymin=lymax=rangeReading->
getPose().
y;
   144                 xmin=xmin<lxmin?xmin:lxmin;
   145                 xmax=xmax>lxmax?xmax:lxmax;
   146                 ymin=ymin<lymin?lymin:lymin;
   147                 ymax=ymax>lymax?ymax:lymax;
 
const std::vector< Beam > & beams() const
void setAcceleration(const OrientedPoint &acceleration)
const SensorMap & m_sensorMap
void setSpeed(const OrientedPoint &speed)
std::istream & load(std::istream &is)
OdometryReading * parseOdometry(std::istream &is, const OdometrySensor *) const
std::map< std::string, Sensor * > SensorMap
void setPose(const OrientedPoint &pose)
const OrientedPoint & getPose() const
SensorLog(const SensorMap &)
OrientedPoint boundingBox(double &xmin, double &ymin, double &xmax, double &ymax) const
RangeReading * parseRange(std::istream &is, const RangeSensor *) const
const OrientedPoint & getPose() const