13<p> <b>Note:</b> <i>If you are displaying a local version of this page and you have not built the whole HTML documentation, the links above will be broken. Either build the documentation invoking <code>make documentation_html</code> or [browse it on-line](http://www.mrpt.org/).</i></p>
14
15<a name="1.3.2">
16 <h2>Version 1.3.2: Released 3-NOV-2015 </h2></a>
20 - `--list-images` now also works with 3D range scans
21 - Changes in libraries:
22 - The library mrpt-srba has been moved out of MRPT and now is an independent project: https://github.com/MRPT/srba
23 - \ref mrpt_base_grp
24 - mrpt::math::KDTreeCapable::TKDTreeSearchParams: Removed parameter nChecks, which was ignored by nanoflann anyway.
25 - \ref mrpt_hwdrivers_grp
26 - mrpt::hwdrivers::CCameraSensor: Implemented OpenNI2 support for CCameraSensor
27 - \ref mrpt_nav_grp
28 - mrpt::nav::CAbstractPTGBasedReactive: Maximum acceleration filter (SPEEDFILTER_TAU) now follows paths better (Thanks to Steven Butner, UCSB/ECE)
29 - Changes in build system:
30 - `FIND_PACKAGE(MRPT)` will return libraries in the var `MRPT_LIBRARIES`, following the CMake convention. The old variable name `MRPT_LIBS` will be also returned for backward compatibility.
31 - BUG FIXES:
32 - Fix excessive width of paths drawn by CMetricMapBuilderRBPF::drawCurrentEstimationToImage()
33 - Fix image distortion: k3 may be ignored. (Thanks to CBaiz)
34 - Fix Debian bugs.
35
36<hr>
37<a name="1.3.1">
38 <h2>Version 1.3.1: Released 18-JUL-2015 </h2></a>
39 - Changes in apps:
40 - [navlog-viewer](http://www.mrpt.org/list-of-mrpt-apps/application-navlog-viewer/): Now shows more information on navigation logs.
41 - New app [icp-slam-live](http://www.mrpt.org/list-of-mrpt-apps/application-icp-slam-live/): Real-time ICP-SLAM with a LIDAR sensor.
42 - Changes in libraries:
43 - \ref mrpt_base_grp
44 - New helper templates: mrpt::utils::int_select_by_bytecount<>, mrpt::utils::uint_select_by_bytecount<>
45 - New methods to evaluate SO(2), SO(3), SE(2) and SE(3) averages and weighted averages. See:
53 - New parameter mrpt::hwdrivers::CHokuyoURG::m_disable_firmware_timestamp to override faulty Hokuyo timestamps with PC time.
54 - mrpt::hwdrivers::CRoboPeakLidar::turnOn() and turnOff() now really implement turning on/off the RPLidar motor.
55 - \ref mrpt_maps_grp
56 - New method mrpt::maps::COccupancyGridMap2D::getAsPointCloud()
57 - \ref mrpt_nav_grp
58 - Removed old base class CPathPlanningMethod
59 - CPathPlanningCircularRobot => mrpt::nav::PlannerSimple2D: Class renamed (and better described) for consistency with other planners
60 - mrpt::nav::CReactiveNavigationSystem:
61 - Documentation has been added about all existing parameters, and template config files provided as starting points.
62 - The loadConfigFile() method with 2 config files has been deprecated favoring the newer, simpler single config file.
63 - The "ROBOT_NAME" parameter is no longer employed. A minor side effect (probably affecting no one) is that PTG cache files are no longer named differently for different robots.
64 - mrpt::nav::CParameterizedTrajectoryGenerator: New methods to save and load trajectories to binary streams. Used to debug in navlog-viewer.
65 - \ref mrpt_obs_grp
66 - mrpt::obs::CObservation3DRangeScan now supports pixel labels (semantic mapping, etc.)
67 - New class mrpt::obs::CObservationSkeleton to hold body tracking information (by Francisco Angel Moreno)
68 - mrpt::obs::CObservationIMU has new data fields and fields are better documented to reflect whether they refer to local/global coordinate frames
69 - \ref mrpt_vision_grp
70 - mrpt::vision::CImageGrabber_dc1394: Changed default Bayer filter from NEAREST to HQLINEAR
71 - BUG FIXES:
72 - Fix ocasional (false) failure of RANSAC unit tests due to their non-deterministic nature.
73 - Fix build error with MSVC 2010 in mrpt-hmtslam (Closes #127).
74 - Fixed potential wrong bounding box results in mrpt::maps::CPointsMap::boundingBox() when SSE2 optimization is enabled.
75 - mrpt::obs::CObservation6DFeatures: Fixed random crashes related to non-aligned memory in 32bit builds (Fixes #141)
76 - Fix Debian bug [#786349](https://bugs.debian.org/cgi-bin/bugreport.cgi?bug=786349) on Eigen2 support.
77 - mrpt::hwdrivers::CIMUXSens_MT4: Fix crash in destructor of objects not attached to a physical device.
78 - Fix wrong quaternion cross product when target variable is one of the operands. Also affected the += operator of mrpt::poses::CPose3DQuat (Fixes #148)
79 - mrpt::hwdrivers::CKinect with libfreenect driver: Fix potential memory corruption.
80 - Fix a bug in mrpt::tfest::se3_l2_robust() that led to it returning without trying to find a good consensus solution. It affected the demo app kinect-3d-slam (Fixes #156)
81 - Fix wrong feature points in CFeatureExtraction::extractFeaturesKLT() (Fixes #138)
82
83<hr>
84<a name="1.3.0">
85 <h2>Version 1.3.0: Released 12-JAN-2015 </h2></a>
86 - <b>Most important changes:</b>
87 - Classes in libraries \ref mrpt_obs_grp and \ref mrpt_maps_grp now belong to new namespaces (mrpt::obs, mrpt::maps) instead of the old mrpt::slam
88 - No more `using namespace`s polute MRPT headers. <b>Errors in user projects</b> missing `using namespace XXX` that might be formerly masked will now reveal. <b>This is a good thing</b>, though admitedly annoying...
89 - New library \ref mrpt_nav_grp, subsumming the old \ref mrpt_reactivenav_grp.
90 - New library \ref mrpt_tfest_grp, a refactor of the old \ref mrpt_scanmatching_grp.
91 - <b>Backwards compatible headers</b> have been provided to ease the transition of user code for all those library changes. Warning messages will be shown recommending deprecated replacements.
92 - <b>Detailed list of changes:</b>
93 - Lib changes:
94 - Clean up of the bad practice of `using namespace` in public scopes of headers. May lead to user code failing for missing `using namespace`s which were previously masked.
95 - Namespace "slam" deprecated in libraries mrpt-obs and mrpt-maps (used for historical reasons):
96 - New namespaces \ref mrpt_obs_grp and \ref mrpt_maps_grp.
97 - #include files moved from old paths <mrpt/slam/...> => <mrpt/{obs,maps}/...>
98 - Backward compatible headers added in <mrpt/slam/...> until mrpt 2.0.0
99 - New library \ref mrpt_nav_grp, subsumming the old mrpt-reactivenav (\ref mrpt_reactivenav_grp).
100 - \ref mrpt_reactivenav_grp is now a meta-library, depending on \ref mrpt_nav_grp.
101 - \ref mrpt_tfest_grp : Old library mrpt-scanmatching (\ref mrpt_scanmatching_grp) has been refactored, its API clean-up, and renamed \ref mrpt_tfest_grp
102 - \ref mrpt_scanmatching_grp is now a meta-library, depending on \ref mrpt_tfest_grp.
103 - These classes have been moved between libs for a more sensible organization:
107 - Many optimizations in function arguments (value vs ref). Forces ABI incompatibility with previous versions, hence the change to a new minor version number.
108 - Updated embedded version of Eigen to 3.2.3
109 - Kinect: Dropped support for the CL NUI API, which seems discontinued. Alternatives in use are libfreenect and OpenNI2.
110 - libfreenect is now detected in the system and used instead of compiling the embedded copy of it.
111 - Embedded copy of libfreenect has been updated to (23/oct/2014). It now supports "Kinect for Windows".
112 - More selective linking of .so files to avoid useless dependencies (Fixes #52).
113 - (Windows only) MRPT can now be safely built with libusb support (Freenect, Kinect,...) and it will run on systems without libusb installed, by means of /DELAYLOAD linking flags.
114 - More unit tests.
115 - Changes in classes:
116 - [mrpt-base]
117 - New function mrpt::math::angDistance()
118 - [mrpt-hwdrivers]
119 - mrpt::hwdrivers::CIMUXSens_MT4: (by Joe Burmeister for Suave Aerial Software)
120 - Upgrade to latest XSens SDK 4.2.1. Requires libudev-dev in Linux
121 - Add GPS observations to CIMUXSens_MT4 for Xsens devices like GTi-G-700 which have GPS
122 - mrpt::hwdrivers::CImageGrabber_dc1394: Length of ring buffer is now configurable via TCaptureOptions_dc1394::ring_buffer_size
123 - [mrpt-maps]
124 - Important refactor of internal code related to mrpt::maps::CMultiMetricMap:
125 - All maps (derived from mrpt::maps::CMetricMap) now have a more uniform interface.
126 - Each map now has a `MapDefinition` structure with all its parameters. See docs for mrpt::maps::TMetricMapInitializer
127 - Introduced mrpt::maps::TMapGenericParams to hold parameters shared in all maps.
128 - [mrpt-obs]
129 - CObservation::getDescriptionAsText(): New virtual method to obstain a textual description of observations. Refactoring of messy code previously in the RawLogViewer app.
130 - [mrpt-vision]
131 - mrpt::vision::CFeatureExtraction: Removed (unused) optional ROI parameter in detectors.
132 - BUG FIXES:
133 - mrpt::poses::CRobot2DPoseEstimator could estimate wrong angular velocities for orientations near +-180deg.
134 - mrpt::system::CDirectoryExplorer::sortByName() didn't sort in descending order
135 - Fixed crashes from MATLAB .mex files: mrpt::system::registerFatalExceptionHandlers() has no longer effect, and will be removed in future releases. (Thanks to Jesús Briales García for all the testing!)
136 - Fixed potential crash for Eigen unaligned memory access in 32bit builds in mrpt::slam::CGridMapAligner and other places ([Closes #94](https://github.com/MRPT/mrpt/issues/94))
137
138<hr>
139<a name="1.2.2">
140 <h2>Version 1.2.2: Released 12-SEP-2014 </h2></a>
143 - New menu "File" -> "Import" -> "3D model" which supports many standard formats (via mrpt::opengl::CAssimpModel)
144 - New classes:
145 - [mrpt-hwdrivers]
146 - mrpt::hwdrivers::CRoboPeakLidar to interface Robo Peak LIDAR scanners.
147 - [mrpt-opengl]
148 - mrpt::opengl::CAssimpModel for rendering complex 3D models (many supported formats) in OpenGL scenes.
149 - Changes in classes:
150 - Consistency in all "laser scan" classes: angular increments between rays are now FOV/(N-1) instead of FOV/N.
151 - [mrpt-base]
152 - New method mrpt::utils::CImage::loadTGA()
153 - *IMPORTANT*: Changed behavior of CSerializable/CObject macros (see bugfix below), introducing the new macros DEFINE_SERIALIZABLE_POST_*.
154 May require changes in user code if serializable classes are defined:
155 - Previous version:
156 \code
157 DEFINE_SERIALIZABLE_PRE_*(...)
158 class XXX {
159 DEFINE_SERIALIZABLE(XXX)
160 };
161 \endcode
162 - Must be changed in this version to:
163 \code
164 DEFINE_SERIALIZABLE_PRE_*(...)
165 class XXX {
166 DEFINE_SERIALIZABLE(XXX)
167 };
168 DEFINE_SERIALIZABLE_POST_*(...)
169 \endcode
170 - [mrpt-hwdrivers]
171 - Bumblebee2 Linux support in mrpt::hwdrivers::CImageGrabber_FlyCapture2 via Triclops (by Jesus Briales)
172 - [mrpt-maps]
173 - New method mrpt::maps::COccupancyGridMap2D::getRawMap()
174 - New method mrpt::maps::CColouredPointsMap::getPCLPointCloudXYZRGB()
175 - [mrpt-opengl]
176 - mrpt::opengl::CMyGLCanvasBase (affects all 3D rendering classes): better handling of internal timers for smoother updates while rendering in multithreading apps.
177 - [mrpt-srba]
178 - New method to recover the global coordinates graph-slam problem for a RBA map: mrpt::srba::RbaEngine::get_global_graphslam_problem() (see example [MRPT]\samples\srba-examples\srba-tutorials\tutorial-srba-how-to-recover-global-map.cpp)
179 - BUG FIXES:
180 - mrpt::utils::CImage constructor from a matrix crashed.
181 - Unit tests: Named semaphores are not tested anymore if it's detected that the kernel version doesn't support them (Fix Debian 758725).
184 - Valgrind: Fixed potential unaligned memory access warning in point clouds.
185 - Fix build error with AppleClang 5.1 (Closes #71).
186 - mrpt::utils::CClientTCPSocket: Use a connection success check that works on all platforms
187 - Important bug fixed regarding a missing dynamic_cast<> in smart pointers casting. See above possible implications in user code.
188 properly (Patch by Joe Burmeister).
189
190<hr>
191<a name="1.2.1">
192 <h2>Version 1.2.1: Released 10-JUL-2014 </h2></a>
193 - Changes in classes:
194 - [mrpt-base]
195 - All points and poses now have a method setToNaN(), e.g. mrpt::poses::CPose3D::setToNaN()
196 - [mrpt-hwdrivers]
197 - mrpt::hwdrivers::COpenNI2Sensor now has better support for opening several RGBD cameras (by Kenzaburo Miyawaki & Eduardo Fernandez)
198 - Build system:
199 - Fix compilation of SRBA with DEBUG_GARBAGE_FILL_ALL_NUMS=1
200 - Fix de-serialization error in mrpt::reactivenav::CLogFileRecord (and new unit tests added to avoid regressions).
201 - Several Debian bugs closed (see packaging/debian/changelog), including build errors in uncommon platforms (MIPS, kFreeBSD, etc.)
202
203<hr>
204<a name="1.2.0">
205 <h2>Version 1.2.0: Released 25-JUN-2014 </h2></a>
206 - <b>Most important changes:</b>
207 - Public header files (.h) have undergone a serious refactoring to minimize unnecesary dependencies and reduce compile time and memory as much as possible.
208 As a side effect, user code might need to add new #include<> lines. This change justifies the new minor version series 1.2.X.
209 - MRPT now cleanly builds in clang and OSX.
210 - Support for new camera drivers (OpenNI2, DUO3D).
215 - New operations: --export-odometry-txt, --recalc-odometry
216 - New flag: --rectify-centers-coincide
217 - New examples:
218 - kitti_dataset2rawlog
219 - New classes:
220 - [mrpt-base]
221 - mrpt::math::ContainerType<CONTAINER>::element_t to allow handling either Eigen or STL containers seamlessly.
222 - mrpt::utils::CConfigFilePrefixer
223 - [mrpt-hwdrivers]
224 - mrpt::hwdrivers::COpenNI2Sensor: Interface to OpenNI2 cameras, capable of reading from an array of OpenNI2 RGBD cameras (By Eduardo Fernandez)
225 - mrpt::hwdrivers::CDUO3DCamera: Interface to DUO3D cameras (By Francisco Angel Moreno)
226 - mrpt::hwdrivers::CGPS_NTRIP: A combination of GPS receiver + NTRIP receiver capable of submitting GGA frames to enable RTCM 3.0
227 - [mrpt-obs]
228 - mrpt::obs::CObservation6DFeatures
229 - Changes in classes:
230 - [mrpt-base]
231 - Robust kernel templates moved from mrpt::vision to mrpt::math. See mrpt::math::RobustKernel<>. Added unit tests for robust kernels.
232 - mrpt::poses::CPose3D has new SE(3) methods: mrpt::poses::CPose3D::jacob_dexpeD_de(), mrpt::poses::CPose3D::jacob_dAexpeD_de()
233 - More efficient mrpt::utils::OctetVectorToObject() (avoid memory copy).
234 - Fixed const-correctness of mrpt::utils::CImage::forceLoad() and mrpt::utils::CImage::unload()
235 - [mrpt-hwdrivers]
236 - mrpt::hwdrivers::CCameraSensor: Added a hook for user code to run before saving external image files: mrpt::hwdrivers::CCameraSensor::addPreSaveHook()
237 - mrpt::hwdrivers::CNationalInstrumentsDAQ now supports analog and digital outputs.
238 - New method mrpt::hwdrivers::CNTRIPClient::sendBackToServer()
239 - [mrpt-srba]
240 - Now also implements SE(3) relative graph-slam.
241 - [mrpt-vision]
242 - mrpt::vision::checkerBoardStereoCalibration: More robust handling of stereo calibration patterns. OpenCV sometimes detects corners in the wrong order between (left/right) images, so we detect the situation and fix it.
244 - Now enforces a consistent counterclockwise XYZ coordinate frame at each detected chessboard.
245 - Much more robust in distingishing quads of different sizes.
246 - Build system / public API:
247 - Fixes to build in OS X - [Patch](https://gist.github.com/randvoorhies/9283072) by Randolph Voorhies.
248 - Removed most "using namespace" from public headers, as good practice.
249 - Refactoring of MRPT headers.
250 - <mrpt/utils/stl_extensions.h> has been split into:
251 - <mrpt/utils/stl_serialization.h>
252 - <mrpt/utils/circular_buffer.h>
253 - <mrpt/utils/list_searchable.h>
254 - <mrpt/utils/bimap.h>
255 - <mrpt/utils/map_as_vector.h>
256 - <mrpt/utils/traits_map.h>
257 - <mrpt/utils/stl_serialization.h>
258 - <mrpt/utils/printf_vector.h>
259 - <mrpt/utils/stl_containers_utils.h>
260 - <mrpt/utils/ci_less.h>
261 - Deleted methods and functions:
262 - mrpt::system::breakpoint()
263 - mrpt::vector_float is now mrpt::math::CVectorFloat, mrpt::vector_double is mrpt::math::CVectorDouble, for name consistency. Also, using Eigen::VectorXf is preferred for new code.
264 - mrpt::CImage::rectifyImage() with parameters as separate vectors.
265 - mrpt::maps::CPointsMap::getPoint() with mrpt::poses::CPoint3D arguments.
266 - mrpt::vision::correctDistortion() -> use CImage method instead
267 - All previous deprecated functions.
268 - Embedded Eigen updated to version 3.2.1 [(commit)](https://github.com/MRPT/mrpt/commit/47913da94a27e98a9115f85b2a530b6c14a10b8f) [(commit)](https://github.com/MRPT/mrpt/commit/33258761d3b75bf133d38aecb257c64e4d76b21e)
269 - BUG FIXES:
270 - RawlogViewer app: Fixed abort while converting SF->obs.only datasets when there is no odometry.
271 - mrpt::obs::CSensoryFrame: The cached point map is now invalidated with any change to the list of observations so it's rebuild upon next call.
272 - New implementation of mrpt::synch::CSemaphore avoids crashes in OS X - by Randolph Voorhies.
273 - mrpt::opengl::CArrow was always drawn of normalized length.
274 - FlyCapture2 monocular & stereo cameras could return an incorrect timestamp (only in Linux?).
275 - mrpt::system::createDirectory() returned false (error) when the directory already existed.
276 - mrpt::vision::CStereoRectifyMap::rectify() didn't update the left & right camera poses inside mrpt::obs::CObservationStereoImages objects while rectifying.
277 - RawLogViewer: Operation "convert to SF format" didn't take into account odometry observations.
278 - Fix build errors with GCC 4.9
279 - Fix crash of mrpt::hwdrivers::CIMUXSens_MT4's destructor when it fails to scan and open a device.
280 - Fix potential crash in mrpt::slam::data_association_full_covariance with JCBB when no individually compatible matching exists [(commit)](https://github.com/MRPT/mrpt/commit/482472ebd80a3484dce63d294b1ac4e8f001e1eb)
281
282<hr>
283 <a name="1.1.0">
284 <h2>Version 1.1.0: Released 22-FEB-2014 </h2></a>
292 - mrpt::hwdrivers::CIMUXSens_MT4 : Support for 4th generation xSens MT IMU devices.
293 - mrpt::hwdrivers::CNationalInstrumentsDAQ: Support for acquisition boards compatible with National Instruments DAQmx Base - [(commit)](https://github.com/MRPT/mrpt/commit/a82a7e37997cfb77e7ee9e903bdb2a55e3040b35).
294 - mrpt::hwdrivers::CImageGrabber_FlyCapture2: Support for Point Grey Research's cameras via the FlyCapture2 libray - [(commits)](https://github.com/MRPT/mrpt/pull/5/commits).
295 - [mrpt-maps]
296 - There are now two versions of octomaps (by Mariano Jaimez Tarifa/Jose Luis Blanco) - [(commit)](http://code.google.com/p/mrpt/source/detail?r=3443)
300 - mrpt::obs::CObservationRawDAQ, a placeholder for raw and generic measurements from data acquisition devices. - [(commit)](http://code.google.com/p/mrpt/source/detail?r=3459)
301 - [mrpt-opengl]
302 - mrpt::opengl::CMeshFast, an open gl object that draws a "mesh" as a structured point cloud which is faster to render (by Mariano Jaimez Tarifa). -[(commit)](https://github.com/MRPT/mrpt/commit/9306bb4a585387d4c85b3f6e41dd2cbe5a354e80)
303 - mrpt::opengl::CVectorField2D, an opengl object that shows a 2D Vector Field (by Mariano Jaimez Tarifa). - [(commit)](http://code.google.com/p/mrpt/source/detail?r=3461)
304 - [mrpt-reactivenav]
305 - mrpt::reactivenav::CAbstractPTGBasedReactive, as part of a large code refactoring of these classes: [(commit)](https://github.com/MRPT/mrpt/pull/4)
309 - mrpt::vision::CDifodo, a class which implements visual odometry based on depth images and the "range flow constraint equation". (by Mariano Jaimez Tarifa) - [(commit)](https://github.com/MRPT/mrpt/commit/e6ab5595f70cb889d07658c0b540c27e495a1cfb)
310 - Changes in classes:
311 - Clean up and slight optimization of metric map matching API: - [(commit)](http://code.google.com/p/mrpt/source/detail?r=3446)
318 - mrpt::maps::CPointsMap::TInsertionOptions now have methods to save/load from binary streams, making more maintainable the serialization of point maps - [(commit)](https://github.com/MRPT/mrpt/commit/544d439c3462228b07344142de68e5bc10c1a2e3)
319 - New options in point maps: mrpt::maps::CPointsMap::TInsertionOptions::insertInvalidPoints - [(commit)](https://github.com/MRPT/mrpt/pull/8)
320 - mrpt::obs::CObservationIMU now includes data fields for 3D magnetometers and altimeters. - [(commit)](http://code.google.com/p/mrpt/source/detail?r=3451)
321 - Method renamed mrpt::utils::CEnhancedMetaFile::selectVectorTextFont() to avoid shadowing mrpt::utils::CCanvas::selectTextFont()
322 - mrpt::reactivenav::CParameterizedTrajectoryGenerator: New methods:
323 - mrpt::reactivenav::CParameterizedTrajectoryGenerator::inverseMap_WS2TP() for inverse look-up of WS to TP space - [(commit)](https://github.com/MRPT/mrpt/commit/4d04ef50e3dea581bed6287d4ea6593034c47da3)
325 - Changed the signature of mrpt::reactivenav::build_PTG_collision_grids() to become more generic for 2D & 2.5D PTGs - [(commit)](https://github.com/MRPT/mrpt/commit/7bd68e49a4ba3bf08f194678787816c65de1d685)
326 - Deleted classes:
327 - mrpt::utils::CEvent, which was actually unimplemented (!)
328 - mrpt::hwdrivers::CInterfaceNI845x has been deleted. It didn't offer features enough to justify a class.
336 - Fixed building against OpenCV 3.0.0 (GIT head)
337 - Updated to the latest nanoflann 1.1.7.
338 - Updated to Eigen 3.2.0 - [(commit)](http://code.google.com/p/mrpt/source/detail?r=3455)
339 - Binary packages for Windows now include .pdb files to help debugging with Visual Studio.
340 - BUG FIXES:
341 - Fixed potential infinity loop in mrpt::math::make_vector<1,T>()
342 - Fixed build error with GCC when experimental parallelization is enabled. [(commit)](http://code.google.com/p/mrpt/source/detail?r=3441)
343 - mrpt::reactivenav::CReactiveNavigationSystem complained about missing config variables ROBOTMODEL_TAU & ROBOTMODEL_DELAY, which were removed in MRPT 1.0.2 - [(commit)](http://code.google.com/p/mrpt/source/detail?r=3452)
344 - Fixed potential mem alignment errors (Eigen's UnalignedArrayAssert) in SRBA for 32bit builds. [(commit)](http://code.google.com/p/mrpt/source/detail?r=3457)
345 - mrpt::topography::geodeticToENU_WGS84() and related functions used a local +Z axis aligned to the line towards the Earth center; now the Z axis points normally to the ellipsoid surface. The difference with the previous behavior is small but may be of a few millimeters for each meter from the reference point. [(commit)](http://code.google.com/p/mrpt/source/detail?r=3473)
346 - Potential crash when setting mpPolygon::setPoints() with empty vectors - [(commit)](http://code.google.com/p/mrpt/source/detail?r=3478)
347 - mrpt::reactivenav::CReactiveNavigationSystem and mrpt::reactivenav::CReactiveNavigationSystem3D didn't obey the "enableConsoleOutput" constructor flag - [(commit)](https://github.com/MRPT/mrpt/commit/db7b0e76506af2c24f119a28443a1e8f1a217861)
348 - mrpt::synch::CSemaphore::waitForSignal() : Fixed error when thread got an external signal [(commit)](https://github.com/MRPT/mrpt/commit/511e95f03480537ff18ad2cad178c504b1cfbb53)
349
350 <hr>
351 <a name="1.0.2">
352 <h2>Version 1.0.2: Released 2-AUG-2013 (SVN 3435) </h2></a>
357 - New operations: --list-timestamps, --remap-timestamps, --export-2d-scans-txt, --export-imu-txt
358 - New classes:
359 - [mrpt-base]
360 - mrpt::poses::CPose3DRotVec is now fully implemented (By Francisco Angel Moreno).
361 - [mrpt-opengl]
362 - mrpt::opengl::CLight - OpenGL scenes now allow customization of OpenGL lighting. See also new lighting methods in mrpt::opengl::COpenGLViewport - <a href="http://code.google.com/p/mrpt/source/detail?r=3409" >r3409</a>
370 - Generic particle filter classes now allow directly resampling to a dynamic number of particles. Affected methods: - <a href="http://code.google.com/p/mrpt/source/detail?r=3381" >r3381</a>
373 - New method: CImage::loadFromXPM() - <a href="http://code.google.com/p/mrpt/source/detail?r=3397" >r3397</a>
374 - [mrpt-maps]
375 - mrpt::maps::COctoMap now exposes the inner octomap::OcTree object. See example samples/octomap_simple - <a href="http://code.google.com/p/mrpt/source/detail?r=4304" >r4304</a>
376 - [mrpt-openg]
377 - mrpt::opengl::CBox now be also rendered as a solid box + line borders. See mrpt::opengl::CBox::enableBoxBorder()
380 - Added new coloring scheme to mrpt::opengl::COctoMapVoxels::visualization_mode_t : "FIXED"
381 - By default, light effects are disabled in this object, because shadows aren't computed anyway and the effect isn't pleasant.
382 - Voxels cubes are sorted in ascending Z order so the visual effect is correct when rendering with transparency.
383 - [mrpt-reactivenav]
384 - mrpt::reactivenav::CParameterizedTrajectoryGenerator: The "low pass filter" has been removed since it wasn't practical and was never used; thus, parameters "TAU" and "DELAY" has been removed. - <a href="http://code.google.com/p/mrpt/source/detail?r=3395" >r3395</a>
385 - Methods removed since they weren't implemented in any derived class and there are no plans for doing it.
389 - Updated to nanoflann 1.1.7: ICP is ~5% faster.
390 - More unit tests:
391 - [mrpt-base] geometry module.
392 - BUG FIXES:
393 - CTimeLogger::registerUserMeasure() ignored the enable/disable state of the logger - <a href="http://code.google.com/p/mrpt/source/detail?r=3382" >r3382</a>
394 - mrpt-srba: SEGFAULT in 32bit builds due to missing MRPT_MAKE_ALIGNED_OPERATOR_NEW - <a href="http://code.google.com/p/mrpt/source/detail?r=3429" >r3429</a>
395
396 <br/>
397 <hr>
398 <a name="1.0.1">
399 <h2>Version 1.0.1: Released 12-MAY-2013 (SVN 3370) </h2></a>
421 - mrpt::maps::COccupancyGridMap2D now also evalutes likelihoods for sonar-like observations (mrpt::obs::CObservationRange), allowing particle-filter localization with these sensors - <a href="http://code.google.com/p/mrpt/source/detail?r=3330" >r3330</a>
422 - New method mrpt::slam::CRandomFieldGridMap2D::insertIndividualReading()
423 - [mrpt-kinematics]
424 - mrpt::kinematics::CKinematicChain: Now allows changing the orientation of the first DOF (X,Y,Z).
425 - Removed stuff:
426 - Backwards-compatibility typedef mrpt::vision::TKLTFeatureStatus has been removed. Replace with mrpt::vision::TFeatureTrackStatus
427 - KLT-specific values for mrpt::vision::TFeatureTrackStatus has been removed, since they were not used in detected features anyway.
428 - Build system:
429 - Fixed a potential build error if including FFMPEG's <time.h> instead of the standard header - <a href="http://code.google.com/p/mrpt/source/detail?r=3316" >r3316</a>
430 - Fixed determination of GCC version for all GCC builds - <a href="http://code.google.com/p/mrpt/source/detail?r=3324" >r3324</a>
431 - Updated to Eigen 3.1.3 - <a href="http://code.google.com/p/mrpt/source/detail?r=3349" >r3349</a>
432 - Updated to nanoflann 1.1.5
433 - BUG FIXES:
434 - Unit tests "SchurTests" for mrpt-srba incorrectly reported errors due to an improperly initialized reference to a local variable - <a href="http://code.google.com/p/mrpt/source/detail?r=3318" >r3318</a>
439 <h2>Version 1.0.0: Released 1-MAR-2013 (SVN 3287) </h2></a>
440 - <b>Most important changes:</b>
441 - New library with a flexible implementation of Sparser Relative Bundle Adjustment (RBA), as presented in ICRA 2013: <a href="http://www.mrpt.org/srba" >mrpt-srba</a>.
442 - New library for Plane-based Maps: <a href="group__mrpt__pbmap__grp.html" >mrpt-pbmap</a> (also presented in ICRA 2013).
443 - Some MRPT modules are now header-only libraries.
444 - Support for a new Octomap metric map, via the octomap library. See mrpt::maps::COctoMap and detailed changes below.
445 - Support for importing/exporting point clouds in the standard LAS format (Look for liblas below).
446 - Better support for custom builds of MRPT (selective building of individual apps and libs, etc.)
447 - Ready for Visual Studio 2012 and GCC 4.7
448 - From now on, MRPT is released under the "New BSD" license.
449 - Many bug fixes.
450 - <b>Detailed list of changes:</b>
451 - New apps:
452 - <a href="http://www.mrpt.org/Application:srba-slam" >srba-slam</a>: A command-line frontend for the Relative Bundle Adjustment engine in mrpt-srba.
454 - <a href="http://www.mrpt.org/Application:robotic-arm-kinematics" >robotic-arm-kinematics</a>: A GUI for experimenting with Denavit-Hartenberg parameters.
459 - Import sequence of images as rawlog: Didn't detect "png" file extension as images - <a href="http://code.google.com/p/mrpt/source/detail?r=2940" >r2940</a> - Closes <a href="http://code.google.com/p/mrpt/issues/detail?id=34" >#34</a>
460 - The GUI toolbar has been ported from wxWidget's ToolBar to sets of wxCustomButton's to avoid visualization problems in wx 2.9.X - <a href="http://code.google.com/p/mrpt/source/detail?r=2950" >r2950</a>
464 - The GUI toolbar has been ported from wxWidget's ToolBar to sets of wxCustomButton's to avoid visualization problems in wx 2.9.X - <a href="http://code.google.com/p/mrpt/source/detail?r=2952" >r2952</a>
465 - Added a new menu: "File -> Import -> From LAS file..." - <a href="http://code.google.com/p/mrpt/source/detail?r=3244" >r3244</a>
466 - <a href="http://www.mrpt.org/Application%3Agrid-matching" >grid-matching</a>: new argument "--aligner" to select aligner method - <a href="http://code.google.com/p/mrpt/source/detail?r=3021" >r3021</a>
467 - New classes:
468 - [mrpt-base]
469 - mrpt::math::MatrixBlockSparseCols, a templated column-indexed efficient storage of block-sparse Jacobian or Hessian matrices, together with other arbitrary information - <a href="http://code.google.com/p/mrpt/source/detail?r=2995" >r2995</a>
480 - CFeatureTracker_FAST and CFeatureTracker_PatchMatch have been removed since they didn't work robustly. Replace with mrpt::vision::CFeatureTracker_KL
481 - New libraries:
482 - [mrpt-kinematics] See mrpt::kinematics
483 - [mrpt-pbmap] See <a href="group__mrpt__pbmap__grp.html" >mrpt-pbmap</a>.
484 - [mrpt-srba] See <a href="http://www.mrpt.org/srba" >mrpt-srba</a>.
485 - Changes in libraries:
486 - These libs are now header-only: <a href="http://code.google.com/p/mrpt/source/detail?r=3035" >r3035</a>, <a href="http://code.google.com/p/mrpt/source/detail?r=3045" >r3045</a>
487 - [mrpt-bayes]
488 - [mrpt-graphs]
489 - [mrpt-graphslam]
490 - Integration of the Octomap C++ library (new BSD License) by Kai M. Wurm et al.: <a href="http://code.google.com/p/mrpt/source/detail?r=3081" >r3081</a>, <a href="http://code.google.com/p/mrpt/source/detail?r=3083" >r3083</a>, <a href="http://code.google.com/p/mrpt/source/detail?r=3084" >r3084</a>, <a href="http://code.google.com/p/mrpt/source/detail?r=3086" >r3086</a>, <a href="http://code.google.com/p/mrpt/source/detail?r=3087" >r3087</a>, <a href="http://code.google.com/p/mrpt/source/detail?r=3088" >r3088</a>, <a href="http://code.google.com/p/mrpt/source/detail?r=3093" >r3093</a>
491 - The main new classes are mrpt::maps::COctoMap & mrpt::opengl::COctoMapVoxels
492 - mrpt::maps::CMultiMetricMap now allows the seamless integration of octomaps in many MRPT map building or localization algorithms.
493 - New example: samples/octomap_simple
494 - Changes in classes:
495 - [mrpt-base]
496 - Eigen::MatrixBase<Derived>::loadFromTextFile(), and all MRPT derived matrix classes, are now much faster loading huge matrices from text files - <a href="http://code.google.com/p/mrpt/source/detail?r=2997" >r2997</a>
497 - The typedef Eigen::MatrixBase<Derived>::typename of MRPT's plugin to Eigen classes has been REMOVED, to avoid conflicts with some part of Eigen's sparse classes. Use Matrix::Scalar instead - <a href="http://code.google.com/p/mrpt/source/detail?r=3065" >r3065</a>
498 - New method mrpt::poses::CPose3DQuat::inverse()
499 - New methods mrpt::poses::SE_traits::pseudo_exp()
500 - mrpt::utils::CTimeLogger:
501 - New method mrpt::utils::CTimeLogger::getStats() for programatic execution time stats analysis - <a href="http://code.google.com/p/mrpt/source/detail?r=2998" >r2998</a>
502 - New method mrpt::utils::CTimeLogger::registerUserMeasure() for making stats of user-providen values - <a href="http://code.google.com/p/mrpt/source/detail?r=3005" >r3005</a>
503 - mrpt::utils::map_as_vector<> can be now customized to use different underlying STL containers for storage - <a href="http://code.google.com/p/mrpt/source/detail?r=3001" >r3001</a>
504 - mrpt::utils::CDynamicGrid::setSize() now also accepts a "fill_value" argument.
505 - Added method mrpt::math::TPoint2D::norm() for consistency with mrpt::math::TPoint3D
506 - Better support for saving (and not only loading) plain text configuration files, including commented files with default values of all existing parameters: - <a href="http://code.google.com/p/mrpt/source/detail?r=2954" >r2954</a>
507 - All mrpt::utils::CConfigFileBase::write() now have an extended signature for formatting.
508 - mrpt::utils::CLoadableOptions::dumpToTextStream() is no longer pure virtual: it now relies on mrpt::utils::CLoadableOptions::saveToConfigFile()
509 - mrpt::utils::CStream::Seek() now supports files larger than 2GB by using uint64_t instead of long (still see issue report for another patch required for MSVC2010) - (Closes <a href="http://code.google.com/p/mrpt/issues/detail?id=39" >issue 39</a>, thanks Robert Schattschneider) - <a href="http://code.google.com/p/mrpt/source/detail?r=3042" >r3042</a>
510 - mrpt::utils::TTypeName<> moved to its own header <mrpt/utils/TTypeName.h> while refactoring <mrpt/utils/CSerializable.h> - <a href="http://code.google.com/p/mrpt/source/detail?r=3044" >r3044</a>
511 - mrpt::utils::CConfigFileBase::write() now has signatures for "uint32_t" and "uint64_t" in both 32 and 64bit builds, instead of relying of the "size_t" type. This was done to fix build errors in some GCC versions under 32bits.
512 - mrpt::poses::CPose2D now caches the cos() and sin() of phi, with a huge performance improvement in most common operations.
513 - [mrpt-bayes]
514 - mrpt::bayes::CKalmanFilterCapable (and all EKF-SLAM methods based on it) are now much faster. The implementation now exploits the sparsity of the Jacobian (~25% faster in a test 6D EKF-SLAM dataset) - <a href="http://code.google.com/p/mrpt/source/detail?r=3059" >r3059</a>, <a href="http://code.google.com/p/mrpt/source/detail?r=3060" >r3060</a>, <a href="http://code.google.com/p/mrpt/source/detail?r=3061" >r3061</a>
515 - mrpt::bayes::CParticleFilterCapable now makes use of the Curiously Recurring Template Pattern (CRTP) design instead of ugly #define macros - <a href="http://code.google.com/p/mrpt/source/detail?r=3182" >r3182</a>
516 - [mrpt-graphs]
517 - mrpt::graphs::CNetworkOfPoses2D, mrpt::graphs::CNetworkOfPoses3D,... and so on, are now all typedef's instead of classes, since serialization is now implemented as pure templatized code, thus avoiding the need to declare derived auxiliary classes - <a href="http://code.google.com/p/mrpt/source/detail?r=3044" >r3044</a>
518 - [mrpt-gui]
519 - mrpt::gui::CDisplayWindow3D::addTextMessage() (and other opengl text routines) now allows drawing text with a shadow effect - <a href="http://code.google.com/p/mrpt/source/detail?r=3007" >r3007</a>
520 - [mrpt-hwdrivers]
521 - New method mrpt::hwdrivers::CActivMediaRobotBase::areMotorsEnabled()
522 - mrpt::hwdrivers::CGenericSensor (and all derived classes) now allocate objects aligned in memory with MRPT_MAKE_ALIGNED_OPERATOR_NEW
523 - New static method mrpt::hwdrivers::CGPSInterface::parse_NMEA()
524 - [mrpt-maps]
525 - Better integration of point cloud classes with PCL: - <a href="http://code.google.com/p/mrpt/source/detail?r=2943" >r2943</a>
529 - Point cloud loading & saving in the standard ASPRS LiDAR LAS format (if liblas is installed in the system, see http://www.liblas.org/ ). See also the ready-to-use import menu in SceneViewer3D - <a href="http://code.google.com/p/mrpt/source/detail?r=3244" >r3244</a>
530 - mrpt::maps::CPointsMap::loadLASFile()
531 - mrpt::maps::CPointsMap::saveLASFile()
532 - Integration of wind measurements in gas-concentration maps (by Javier G. Monroy) - <a href="http://code.google.com/p/mrpt/source/detail?r=3050" >r3050</a>
533 - [mrpt-obs]
534 - New method mrpt::obs::CObservationGPS::clear()
535 - [mrpt-opengl]
536 - Evaluation of bounding box of opengl objects. New methods: - <a href="http://code.google.com/p/mrpt/source/detail?r=3026" >r3026</a>
540 - mrpt::opengl::COctreePointRenderer::octree_get_graphics_boundingboxes() has a new flag to draw solid boxes at each leaf node - <a href="http://code.google.com/p/mrpt/source/detail?r=3033" >r3033</a>
541 - mrpt::opengl::COpenGLViewport has a new set of "global OpenGL switches" that affect the rendering of entire scenes - <a href="http://code.google.com/p/mrpt/source/detail?r=3185" >r3185</a>
542 - Classes drawing lines now by default enable anti-aliasing (can be disabled by the programmer): - <a href="http://code.google.com/p/mrpt/source/detail?r=3185" >r3185</a>
547 - Much code of mrpt::reactivenav classes have undergone a clean-up, slight optimizations and a translation of old Spanish names/comments to English - <a href="http://code.google.com/p/mrpt/source/detail?r=2939" >r2939</a>, <a href="http://code.google.com/p/mrpt/source/detail?r=2942" >r2942</a>, <a href="http://code.google.com/p/mrpt/source/detail?r=2958" >r2958</a>, <a href="http://code.google.com/p/mrpt/source/detail?r=3091" >r3091</a>
548 - mrpt::reactivenav::CParameterizedTrajectoryGenerator::CColisionGrid now has a more maintainable binary serialization format - <a href="http://code.google.com/p/mrpt/source/detail?r=2939" >r2939</a>
549 - mrpt::reactivenav::CParameterizedTrajectoryGenerator::debugDumpInFiles() now also saves text files which can be used to visualize PTGs from MATLAB (see scripts/viewPTG.m) - <a href="http://code.google.com/p/mrpt/source/detail?r=3009" >r3009</a>
550 - mrpt::reactivenav::CHolonomicVFF and mrpt::reactivenav::CHolonomicND now have more configurable parameters, loadable from config files. See their documentation.
551 - Repulsive forces from obstacles in mrpt::reactivenav::CHolonomicVFF are now automatically normalized wrt the density of the 360deg view of obstacles and forces follow a "1/range" law instead of the old "exp(-range)".
552 - Solved a stability issue in C-S paths, in mrpt::reactivenav::CPTG5 (By Mariano Jaimez Tarifa) - <a href="http://code.google.com/p/mrpt/source/detail?r=3085" >r3085</a>
555 - Changed behavior not to allow features to appear in duplicated pairings.
556 - Added a consistency test to avoid seeding RANSAC with an inconsistent initial model.
557 - [mrpt-slam]
558 - mrpt::slam::CMetricMapBuilderICP now does not integrate the small pose changes due to odometry and/or relocalization when considering the distance and angle thresholds. This means that fewer map updates are now done for the same ICP-SLAM parameters, which should lead to "less noisy" maps.
559 - New functions:
560 - [mrpt-base]
561 - mrpt::utils::abs_diff()
562 - mrpt::system::getMRPTLicense()
563 - mrpt::system::getFileModificationTime()
564 - mrpt::math::noncentralChi2PDF_CDF() is now exposed (was private)
573 - Update to Eigen 3.1.2 - <a href="http://code.google.com/p/mrpt/source/detail?r=3064" >r3064</a>
574 - MRPT's root "CMakeLists.txt" has undergone a big refactoring and cleanup - <a href="http://code.google.com/p/mrpt/source/detail?r=2961" >r2961</a>
575 - Backward compatible "mrpt-core" has been removed as a fake lib for which to search with CMake from user programs - <a href="http://code.google.com/p/mrpt/source/detail?r=2961" >r2961</a>
576 - More system libs are detected in Linux (libclang-dev, lib3ds-dev), discarding embedded versions then - <a href="http://code.google.com/p/mrpt/source/detail?r=2963" >r2963</a> - <a href="http://code.google.com/p/mrpt/issues/detail?id=17" >Closes #17</a>
577 - Automatic detection of supported SIMD extensions (SSE*) from CMake (only for Linux OS) - <a href="http://code.google.com/p/mrpt/source/detail?r=3013" >r3013</a>
578 - Fixed building with Visual Studio 2012 (MSVC11) - <a href="http://code.google.com/p/mrpt/source/detail?r=3017" >r3017</a>
579 - MRPT now allows defining header-only libraries with the define_mrpt_lib_header_only() macro - <a href="http://code.google.com/p/mrpt/source/detail?r=3034" >r3034</a>, <a href="http://code.google.com/p/mrpt/source/detail?r=3035" >r3035</a>
580 - More unit tests:
581 - for all probability distribution functions in mrpt::math,
582 - for the parser in mrpt::hwdrivers::CGPSInterface::parse_NMEA()
583 - for the octomap map
584 - for serialization/deserealization of many classes.
585 - Added new documentation page: <a href="env-vars.html" >environment variables</a>.
586 - Removed the build flag "MRPT_BACKCOMPATIB_08X".
587 - Fixes for building under Mac OSX: <a href="http://code.google.com/p/mrpt/source/detail?r=3181" >r3181</a>
588 - Enable some c++11 features if the compiler supports them - <a href="http://code.google.com/p/mrpt/source/detail?r=3273" >r3273</a>
589 - BUG FIXES:
590 - Build: Fixed detection of OpenCV 2.4.2+ installed in the system via CMake config file instead of pkg-config, which seems to be broken. - <a href="http://code.google.com/p/mrpt/source/detail?r=3019" >r3019</a>
591 - [mrpt-base] The iterator returned by end() in all MRPT vectors and matrices (based on Eigen) pointed to the last element, not to the (now correct) next position after the last element - <a href="http://code.google.com/p/mrpt/source/detail?r=2941" >r2941</a>
592 - [mrpt-base] mrpt::dynamicsize_vector::resize() performed a memory reallocation even if given the current size, due to an inherited behavior from Eigen. It is not the expected behavior, so it has been fixed. - <a href="http://code.google.com/p/mrpt/source/detail?r=3003" >r3003</a>
593 - [mrpt-base] Wrong computation of normPDF() values for the multidimensional cases. Closes <a href="http://code.google.com/p/mrpt/issues/detail?id=46" >#46</a> - <a href="http://code.google.com/p/mrpt/source/detail?r=3068" >r3068</a>
594 - [mrpt-base] mrpt::poses::CPoint::asString() confused the 2D and 3D cases (Thanks Cipri!)
595 - [mrpt-base] Fixed errors in de-serialization of mrpt::utils::CPointPDFSOG and mrpt::maps::CReflectivityGridMap2D
596 - [mrpt-base] mrpt::math::KDTreeCapable::kdTreeRadiusSearch2D() always returned 0 matched.
597 - [mrpt-graphs] Fixed bug in RecursiveSpectralPartition (Thanks to Edu!) - <a href="http://code.google.com/p/mrpt/source/detail?r=3026" >r3026</a>
598 - [mrpt-hwdrivers] Fixed potential SEGFAULT in mrpt::hwdrivers::CGPSInterface (Thanks K.Miyawaki for <a href="http://www.mrpt.org/node/2474" >reporting</a>)
599 - [mrpt-hwdrivers] Fixed communications to LMS 1xx scanners (Thanks Henry! See http://code.google.com/p/mrpt/issues/detail?id=49 )
600 - [mrpt-maps] mrpt::maps::COccupancyGridMap2D::getAs3DObject() returned cells with an occupancy of exactly "0" as transparent - <a href="http://code.google.com/p/mrpt/source/detail?r=2957" >r2957</a>
601 - [mrpt-maps] Fixed saving the correct point colors in mrpt::maps::CColouredPointsMap::savePCDFile() (Thanks Mariano!) - <a href="http://code.google.com/p/mrpt/source/detail?r=3090" >r3090</a>
602 - [mrpt-maps] In CPointsMap::computeMatchingWith3D. Fixed matching two 3D point clouds as each correspondence was inserted twice into the output vector. (By Paco) - <a href="http://code.google.com/p/mrpt/source/detail?r=3162" >r3162</a>
603 - [mrpt-opengl] Fixed a potential bug: after deserializing an object based on a display-list (most of them), it won't update in the opengl view.
604 - [mrpt-reactivenav] Class mrpt::reactivenav::CHolonomicVFF was not exported in Windows DLL's (Thanks Mariano for noticing!).
605 - [mrpt-reactivenav] Fixed wrong computation of obstacles force fields in mrpt::reactivenav::CHolonomicVFF (Thanks Mariano for noticing!) - <a href="http://code.google.com/p/mrpt/source/detail?r=2953" >r2953</a>
606 - [mrpt-reactivenav] Precomputed collision grids could be loaded in mrpt::reactivenav::CParameterizedTrajectoryGenerator even for different robot parameters/shape: now it correctly detects such situations and recompute when needed - <a href="http://code.google.com/p/mrpt/source/detail?r=2939" >r2939</a> - Closes <a href="http://code.google.com/p/mrpt/issues/detail?id=33" >#33</a>
607 - [mrpt-reactivenav] ND algorithm: Fixed bugs of "last gap is never evaluated" and wrong composition of representative direction for some gaps (By Mariano) - <a href="http://code.google.com/p/mrpt/source/detail?r=3056" >r3056</a>
615 - <a href="http://www.mrpt.org/Application:kinect-stereo-calibrate" >kinect-stereo-calibrate</a>: A GUI tool for calibrating RGB+D and/or stereo cameras, including live Kinect capturing.
616 - Removed applications:
617 - stereo-calib-gui: it's now superseded by kinect-stereo-gui. The old command line tool is still useful, so it's still there as the example "stereo-calib-opencv".
620 - Added a new option (SHOW_LASER_SCANS_3D in config files) to draw laser scans in the live 3D view - <a href="http://code.google.com/p/mrpt/source/detail?r=2881" >r2881</a>
626 - New menu for generating high-resolution renders of any scene directly to imag files - <a href="http://code.google.com/p/mrpt/source/detail?r=2775" >r2775</a>
627 - Many new menus for selective selecting objects and applying operations on them - <a href="http://code.google.com/p/mrpt/source/detail?r=2776" >r2776</a>
628 - stereo-calib-gui: Now generates a report with detailed and clear results from stereo calibration and allows the user to change most parameters interactively - <a href="http://code.google.com/p/mrpt/source/detail?r=2801" >r2801</a>
629 - <a href="http://www.mrpt.org/Application:kinect-3d-view" >kinect-3d-view</a>: New key command: press '9' to grab selected snapshots to disk - <a href="http://code.google.com/p/mrpt/source/detail?r=2890" >r2890</a>
630 - Kinect stuff:
631 - [mrpt-hwdrivers]
632 - mrpt::hwdrivers::CKinect now decodes Bayer color using OpenCV instead of default freenect - <a href="http://code.google.com/p/mrpt/source/detail?r=2721" >r2721</a>, <a href="http://code.google.com/p/mrpt/source/detail?r=2762" >r2762</a>
633 - mrpt::hwdrivers::CKinect no longer forces a horizontal tilt at start up by default, what may be annoying (if required, set "initial_tilt_angle") - <a href="http://code.google.com/p/mrpt/source/detail?r=2722" >r2722</a>
634 - mrpt::hwdrivers::CKinect now loads Kinect calibration files in a format compatible with stereo cameras. See http://www.mrpt.org/Kinect_calibration
635 - [mrpt-obs]
636 - New method mrpt::obs::CObservation3DRangeScan::convertTo2DScan() allows simulating a "fake 2D laser scanner" from a Kinect. See the example: http://www.mrpt.org/Example_Kinect_To_2D_laser_scan
637 - [mrpt-vision]
638 - New function mrpt::vision::checkerBoardStereoCalibration() to calibrate stereo and RGB+D cameras. See also the program <a href="http://www.mrpt.org/Application:kinect-stereo-calibrate" >kinect-stereo-calibrate</a>:
639 - New classes:
640 - [mrpt-gui]
641 - New event generated by GUI windows: mrpt::gui::mrptEventWindowClosed
642 - [mrpt-hwdrivers]
643 - mrpt::hwdrivers::CRaePID: A new interface to PID gas sensing devices (by Emil Khatib, University of Malaga) - <a href="http://code.google.com/p/mrpt/source/detail?r=2841" >r2841</a>
644 - [mrpt-opengl]
645 - New classes for representing confidence intervals (ellipsoids) in transformed spaces - <a href="http://code.google.com/p/mrpt/source/detail?r=2783" >r2783</a>