22         const sensor_msgs::PointCloud& msg, CSimplePointsMap& obj)
 
   24         const size_t N = msg.points.size();
 
   28         for (
size_t i = 0; i < N; i++)
 
   29                 obj.insertPoint(msg.points[i].x, msg.points[i].y, msg.points[i].z);
 
   44         sensor_msgs::PointCloud& msg)
 
   47         msg.header = msg_header;
 
   50         const size_t N = obj.size();
 
   52         for (
size_t i = 0; i < N; i++)
 
   54                 geometry_msgs::Point32& pt = msg.points[i];
 
   55                 obj.getPoint(i, pt.x, pt.y, pt.z);