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];
bool mrpt2ros(const CObservationGPS &obj, const std_msgs::Header &msg_header, sensor_msgs::NavSatFix &msg)
virtual void reserve(size_t newLength) MRPT_OVERRIDE
File includes methods for converting CNetworkOfPoses*DInf <=> NetworkOfPoses message types...
void insertPoint(float x, float y, float z=0)
unsigned long getPoint(size_t index, float &x, float &y, float &z) const
bool ros2mrpt(const sensor_msgs::NavSatFix &msg, CObservationGPS &obj)