9 #include <mrpt/utils/CConfigFile.h> 10 #include <mrpt/utils/CFileGZInputStream.h> 11 #include <mrpt/utils/CFileGZOutputStream.h> 12 #include <mrpt/system/os.h> 13 #include <mrpt/system/string_utils.h> 14 #include <mrpt/system/filesystem.h> 15 #include <mrpt/slam/CRangeBearingKFSLAM2D.h> 17 #include <mrpt/math/ops_containers.h> 18 #include <mrpt/opengl/CGridPlaneXY.h> 19 #include <mrpt/opengl/CSetOfLines.h> 20 #include <mrpt/opengl/stock_objects.h> 22 #include <mrpt/gui/CDisplayWindow3D.h> 24 #include <mrpt/version.h> 25 #if MRPT_VERSION >= 0x130 26 #include <mrpt/obs/CActionRobotMovement2D.h> 27 #include <mrpt/obs/CActionCollection.h> 28 #include <mrpt/obs/CObservationOdometry.h> 29 #include <mrpt/obs/CSensoryFrame.h> 30 #include <mrpt/maps/CMultiMetricMap.h> 31 #include <mrpt/obs/CObservationBearingRange.h> 32 #include <mrpt/obs/CRawlog.h> 33 using namespace mrpt::maps;
34 using namespace mrpt::obs;
36 #include <mrpt/slam/CActionRobotMovement2D.h> 37 #include <mrpt/slam/CActionCollection.h> 38 #include <mrpt/slam/CObservationOdometry.h> 39 #include <mrpt/slam/CSensoryFrame.h> 40 #include <mrpt/slam/CMultiMetricMap.h> 41 #include <mrpt/slam/CObservationBearingRange.h> 42 #include <mrpt/slam/CRawlog.h> 80 void landmark_to_3d(
const CRangeBearingKFSLAM2D::KFArray_FEAT &lm, TPoint3D &p);
86 void read_iniFile(std::string ini_filename);
93 void observation(CSensoryFrame::Ptr _sf, CObservationOdometry::Ptr _odometry);
101 CSensoryFrame::Ptr
sf;
109 std::vector<mrpt::math::TPoint2D>
LMs_;
110 std::map<unsigned int, CLandmark::TLandmarkID>
LM_IDs_;
114 mrpt::gui::CDisplayWindow3D::Ptr
win3d;
bool use_motion_model_default_options_
used default odom_params
CVectorDouble fullState_
full state vector
CMatrixDouble fullCov_
full covariance matrix
CPosePDFGaussian robotPose_
current robot pose
mrpt::poses::CPose2D odomLastObservation_
last observation of odometry
std::vector< mrpt::math::TPoint2D > LMs_
vector of the landmarks
std::map< unsigned int, CLandmark::TLandmarkID > LM_IDs_
vector of the landmarks ID
CRangeBearingKFSLAM2D mapping
EKF slam 2d class.
bool CAMERA_3DSCENE_FOLLOWS_ROBOT
mrpt::system::TTimeStamp timeLastUpdate_
last update of the pose and map
The EKFslam class provides EKF SLAM 2d from MRPT libraries.
vector< TPose3D > meanPath
mrpt::gui::CDisplayWindow3D::Ptr win3d
MRPT window.
CActionRobotMovement2D::TMotionModelOptions motion_model_default_options_
used if there are is not odom
CActionRobotMovement2D::TMotionModelOptions motion_model_options_
used with odom value motion noise
CActionCollection::Ptr action
actions
CSensoryFrame::Ptr sf
observations