Main file for the GraphSlamEngine.
Given a dataset of measurements build a graph of nodes (keyframes) and constraints (edges) and solve it to find an estimation of the actual robot trajectory.
// TODO - change this description The template arguments are listed below:
Definition at line 191 of file CGraphSlamEngine.h.
#include <mrpt/graphslam/CGraphSlamEngine.h>
Classes | |
struct | TRGBDInfoFileParams |
Struct responsible for keeping the parameters of the .info file in RGBD related datasets. More... | |
Public Types | |
typedef std::map< std::string, mrpt::utils::CFileOutputStream * > | fstreams_out |
Handy typedefs. More... | |
typedef std::map< std::string, mrpt::utils::CFileOutputStream * >::iterator | fstreams_out_it |
Map for iterating over output file streams. More... | |
typedef GRAPH_T::constraint_t | constraint_t |
Type of graph constraints. More... | |
typedef GRAPH_T::constraint_t::type_value | pose_t |
Type of underlying poses (2D/3D). More... | |
typedef GRAPH_T::global_pose_t | global_pose_t |
typedef std::map< mrpt::utils::TNodeID, mrpt::obs::CObservation2DRangeScanPtr > | nodes_to_scans2D_t |
Public Member Functions | |
CGraphSlamEngine (const std::string &config_file, const std::string &rawlog_fname="", const std::string &fname_GT="", mrpt::graphslam::CWindowManager *win_manager=NULL, mrpt::graphslam::deciders::CNodeRegistrationDecider< GRAPH_T > *node_reg=NULL, mrpt::graphslam::deciders::CEdgeRegistrationDecider< GRAPH_T > *edge_reg=NULL, mrpt::graphslam::optimizers::CGraphSlamOptimizer< GRAPH_T > *optimizer=NULL) | |
Constructor of CGraphSlamEngine class template. More... | |
virtual | ~CGraphSlamEngine () |
Default Destructor. More... | |
global_pose_t | getCurrentRobotPosEstimation () const |
Query CGraphSlamEngine instance for the current estimated robot position. More... | |
virtual void | getRobotEstimatedTrajectory (typename GRAPH_T::global_poses_t *graph_poses) const |
virtual void | getNodeIDsOfEstimatedTrajectory (std::set< mrpt::utils::TNodeID > *nodes_set) const |
Return the list of nodeIDs which make up robot trajectory. More... | |
void | saveGraph (const std::string *fname_in=NULL) const |
Wrapper method around the GRAPH_T::saveToTextFile method. More... | |
void | save3DScene (const std::string *fname_in=NULL) const |
Wrapper method around the COpenGLScene::saveToFile method. More... | |
void | loadParams (const std::string &fname) |
Read the configuration variables from the .ini file specified by the user. More... | |
void | getParamsAsString (std::string *params_out) const |
Fill in the provided string with the class configuration parameters. More... | |
std::string | getParamsAsString () const |
Wrapper around getParamsAsString. More... | |
void | printParams () const |
Print the problem parameters to the console for verification. More... | |
bool | execGraphSlamStep (mrpt::obs::CObservationPtr &observation, size_t &rawlog_entry) |
Wrapper method around _execGraphSlamStep. More... | |
virtual bool | _execGraphSlamStep (mrpt::obs::CActionCollectionPtr &action, mrpt::obs::CSensoryFramePtr &observations, mrpt::obs::CObservationPtr &observation, size_t &rawlog_entry) |
Main class method responsible for parsing each measurement and for executing graphSLAM. More... | |
const GRAPH_T & | getGraph () const |
Return a reference to the underlying GRAPH_T instance. More... | |
std::string | getRawlogFname () |
Return the filename of the used rawlog file. More... | |
void | generateReportFiles (const std::string &output_dir_fname_in) |
Generate and write to a corresponding report for each of the respective self/decider/optimizer classes. More... | |
void | getDeformationEnergyVector (std::vector< double > *vec_out) const |
Fill the given vector with the deformation energy values computed for the SLAM evaluation metric. More... | |
bool | getGraphSlamStats (std::map< std::string, int > *node_stats, std::map< std::string, int > *edge_stats, mrpt::system::TTimeStamp *timestamp=NULL) |
Fill the given maps with stats regarding the overall execution of graphslam. More... | |
Map computation and acquisition methods | |
Fill the given map based on the observations that have been recorded so far. | |
void | getMap (mrpt::maps::COccupancyGridMap2DPtr map, mrpt::system::TTimeStamp *acquisition_time=NULL) const |
void | getMap (mrpt::maps::COctoMapPtr map, mrpt::system::TTimeStamp *acquisition_time=NULL) const |
void | computeMap () const |
Compute the map of the environment based on the recorded measurements. More... | |
pause/resume execution | |
bool | isPaused () const |
void | togglePause () |
void | resumeExec () const |
void | pauseExec () |
Static Public Member Functions | |
ground-truth parsing methods | |
static void | readGTFile (const std::string &fname_GT, std::vector< mrpt::poses::CPose2D > *gt_poses, std::vector< mrpt::system::TTimeStamp > *gt_timestamps=NULL) |
Parse the ground truth .txt file and fill in the corresponding gt_poses vector. More... | |
static void | readGTFile (const std::string &fname_GT, std::vector< mrpt::poses::CPose3D > *gt_poses, std::vector< mrpt::system::TTimeStamp > *gt_timestamps=NULL) |
static void | readGTFileRGBD_TUM (const std::string &fname_GT, std::vector< mrpt::poses::CPose2D > *gt_poses, std::vector< mrpt::system::TTimeStamp > *gt_timestamps=NULL) |
Parse the ground truth .txt file and fill in the corresponding m_GT_poses vector. More... | |
Protected Member Functions | |
void | initClass () |
General initialization method to call from the Class Constructors. More... | |
void | initResultsFile (const std::string &fname) |
Automate the creation and initialization of a results file relevant to the application. More... | |
void | getDescriptiveReport (std::string *report_str) const |
Fill the provided string with a detailed report of the class state. More... | |
void | initCurrPosViewport () |
void | initGTVisualization () |
void | initOdometryVisualization () |
void | initEstimatedTrajectoryVisualization () |
void | initSlamMetricVisualization () |
void | decimateLaserScan (mrpt::obs::CObservation2DRangeScan &laser_scan_in, mrpt::obs::CObservation2DRangeScan *laser_scan_out, const int keep_every_n_entries=2) |
Cut down on the size of the given laser scan. More... | |
void | alignOpticalWithMRPTFrame () |
void | queryObserverForEvents () |
Query the observer instance for any user events. More... | |
void | computeSlamMetric (mrpt::utils::TNodeID nodeID, size_t gt_index) |
Compare the SLAM result (estimated trajectory) with the GT path. More... | |
void | dumpVisibilityErrorMsg (std::string viz_flag, int sleep_time=500) |
Wrapper method that used for printing error messages in a consistent manner. More... | |
mrpt::opengl::CSetOfObjectsPtr | setCurrentPositionModel (const std::string &model_name, const mrpt::utils::TColor &model_color=mrpt::utils::TColor(0, 0, 0), const size_t model_size=1, const pose_t &init_pose=pose_t()) |
Set the opengl model that indicates the latest position of the trajectory at hand. More... | |
virtual void | monitorNodeRegistration (bool registered=false, std::string class_name="Class") |
Assert that the given nodes number matches the registered graph nodes, otherwise throw exception. More... | |
void | execDijkstraNodesEstimation () |
Wrapper around the GRAPH_T::dijkstra_nodes_estimate. More... | |
Initialization of Visuals | |
Methods used for initializing various visualization features relevant to the application at hand. If the visual feature is specified by the user (via the .ini file) and if it is relevant to the application then the corresponding method is called in the initClass class method | |
void | initVisualization () |
void | initRangeImageViewport () |
void | initIntensityImageViewport () |
mrpt::opengl::CSetOfObjectsPtr | initRobotModelVisualization () |
mrpt::opengl::CSetOfObjectsPtr | initRobotModelVisualizationInternal (const mrpt::poses::CPose2D &p_unused) |
Method to help overcome the partial template specialization restriction of C++. More... | |
mrpt::opengl::CSetOfObjectsPtr | initRobotModelVisualizationInternal (const mrpt::poses::CPose3D &p_unused) |
Update of Visuals | |
Methods used for updating various visualization features relevant to the application at hand. If relevant to the application at hand update is periodically scheduled inside the execGraphSlam method | |
void | updateAllVisuals () |
Wrapper around the deciders/optimizer updateVisuals methods. More... | |
void | updateRangeImageViewport () |
In RGB-D TUM Datasets update the Range image displayed in a seperate viewport. More... | |
void | updateIntensityImageViewport () |
In RGB-D TUM Datasets update the Intensity image displayed in a seperate viewport. More... | |
virtual void | updateCurrPosViewport () |
Update the viewport responsible for displaying the graph-building procedure in the estimated position of the robot. More... | |
virtual mrpt::poses::CPose3D | getLSPoseForGridMapVisualization (const mrpt::utils::TNodeID nodeID) const |
return the 3D Pose of a LaserScan that is to be visualized. More... | |
virtual void | setObjectPropsFromNodeID (const mrpt::utils::TNodeID nodeID, mrpt::opengl::CSetOfObjectsPtr &viz_object) |
Set the properties of the map visual object based on the nodeID that it was produced by. More... | |
void | initMapVisualization () |
void | updateMapVisualization (const std::map< mrpt::utils::TNodeID, mrpt::obs::CObservation2DRangeScanPtr > &nodes_to_laser_scans2D, bool full_update=false) |
Update the map visualization based on the current graphSLAM state. More... | |
void | updateGTVisualization () |
Display the next ground truth position in the visualization window. More... | |
void | updateOdometryVisualization () |
Update odometry-only cloud with latest odometry estimation. More... | |
void | updateEstimatedTrajectoryVisualization (bool full_update=false) |
Update the Esstimated robot trajectory with the latest estimated robot position. More... | |
void | updateSlamMetricVisualization () |
Update the displayPlots window with the new information with regards to the metric. More... | |
Toggling of Visuals | |
Methods used for toggling various visualization features relevant to the application at hand. | |
void | toggleOdometryVisualization () |
void | toggleGTVisualization () |
void | toggleMapVisualization () |
void | toggleEstimatedTrajectoryVisualization () |
Static Protected Member Functions | |
static mrpt::system::TTimeStamp | getTimeStamp (const mrpt::obs::CActionCollectionPtr action, const mrpt::obs::CSensoryFramePtr observations, const mrpt::obs::CObservationPtr observation) |
Fill the TTimestamp in a consistent manner. More... | |
Class specific supplementary functions. | |
static double | accumulateAngleDiffs (const mrpt::poses::CPose2D &p1, const mrpt::poses::CPose2D &p2) |
static double | accumulateAngleDiffs (const mrpt::poses::CPose3D &p1, const mrpt::poses::CPose3D &p2) |
Protected Attributes | |
mrpt::utils::CTimeLogger | m_time_logger |
Time logger instance. More... | |
GRAPH_T | m_graph |
The graph object to be built and optimized. More... | |
const bool | m_enable_visuals |
Determine if we are to enable visualization support or not. More... | |
std::string | m_config_fname |
std::string | m_rawlog_fname |
Rawlog file from which to read the measurements. More... | |
std::string | m_fname_GT |
size_t | m_GT_poses_index |
Counter for reading back the GT_poses. More... | |
size_t | m_GT_poses_step |
Rate at which to read the GT poses. More... | |
bool | m_user_decides_about_output_dir |
bool | m_has_read_config |
bool | m_observation_only_dataset |
fstreams_out | m_out_streams |
keeps track of the out fstreams so that they can be closed (if still open) in the class Dtor. More... | |
bool | m_is_paused |
Indicated if program is temporarily paused by the user. More... | |
const std::string | m_paused_message |
Message to be displayed while paused. More... | |
mrpt::graphslam::detail::CEdgeCounter | m_edge_counter |
Instance to keep track of all the edges + visualization related operations. More... | |
bool | m_use_GT |
Flag for specifying if we are going to use ground truth data at all. More... | |
std::vector< pose_t > | m_odometry_poses |
std::vector< pose_t > | m_GT_poses |
std::string | m_GT_file_format |
nodes_to_scans2D_t | m_nodes_to_laser_scans2D |
Map of NodeIDs to their corresponding LaserScans. More... | |
mrpt::obs::CObservation2DRangeScanPtr | m_last_laser_scan2D |
Last laser scan that the current class instance received. More... | |
mrpt::obs::CObservation2DRangeScanPtr | m_first_laser_scan2D |
First recorded laser scan - assigned to the root. More... | |
mrpt::obs::CObservation3DRangeScanPtr | m_last_laser_scan3D |
Last laser scan that the current class instance received. More... | |
mrpt::math::CMatrixDouble33 | m_rot_TUM_to_MRPT |
size_t | m_robot_model_size |
How big are the robots going to be in the scene. More... | |
mrpt::utils::TNodeID | m_nodeID_max |
Internal counter for querying for the number of nodeIDs. More... | |
mrpt::synch::CCriticalSection | m_graph_section |
Mark graph modification/accessing explicitly for multithreaded implementation. More... | |
std::string | m_img_external_storage_dir |
std::string | m_img_prev_path_base |
struct mrpt::graphslam::CGraphSlamEngine::TRGBDInfoFileParams | m_info_params |
double | m_dataset_grab_time |
Time it took to record the dataset. More... | |
mrpt::system::TTimeStamp | m_init_timestamp |
First recorded timestamp in the dataset. More... | |
mrpt::system::TTimeStamp | m_curr_timestamp |
Current dataset timestamp. More... | |
pose_t | m_curr_odometry_only_pose |
Current robot position based solely on odometry. More... | |
bool | m_request_to_exit |
Indicate whether the user wants to exit the application (e.g. More... | |
std::string | m_class_name |
bool | m_is_first_time_node_reg |
Track the first node registration occurance. More... | |
std::vector< std::string > | m_supported_constraint_types |
MRPT CNetworkOfPoses constraint classes that are currently supported. More... | |
std::string | m_current_constraint_type |
Type of constraint currently in use. More... | |
Decider/Optimizer instances. Delegating the GRAPH_T tasks to these | |
classes makes up for a modular and configurable design | |
mrpt::graphslam::deciders::CNodeRegistrationDecider< GRAPH_T > * | m_node_reg |
mrpt::graphslam::deciders::CEdgeRegistrationDecider< GRAPH_T > * | m_edge_reg |
mrpt::graphslam::optimizers::CGraphSlamOptimizer< GRAPH_T > * | m_optimizer |
Visualization - related objects | |
mrpt::graphslam::CWindowManager * | m_win_manager |
mrpt::gui::CDisplayWindow3D * | m_win |
mrpt::graphslam::CWindowObserver * | m_win_observer |
mrpt::gui::CDisplayWindowPlots * | m_win_plot |
DisplayPlots instance for visualizing the evolution of the SLAM metric. More... | |
Visualization - related flags | |
Flags for visualizing various trajectories/objects of interest. These are set from the .ini configuration file. The actual visualization of these objects can be overriden if the user issues the corresponding keystrokes in the CDisplayWindow3D. In order for them to have any effect, a pointer to CDisplayWindow3D has to be given first. | |
bool | m_visualize_odometry_poses |
bool | m_visualize_GT |
bool | m_visualize_map |
bool | m_visualize_estimated_trajectory |
bool | m_visualize_SLAM_metric |
bool | m_enable_curr_pos_viewport |
bool | m_enable_intensity_viewport |
bool | m_enable_range_viewport |
textMessage - related Parameters | |
Parameters relevant to the textMessages appearing in the visualization window. These are divided into
| |
double | m_offset_x_left |
Offset from the left side of the canvas. More... | |
double | m_offset_y_odometry |
double | m_offset_y_GT |
double | m_offset_y_estimated_traj |
double | m_offset_y_timestamp |
double | m_offset_y_current_constraint_type |
double | m_offset_y_paused_message |
int | m_text_index_odometry |
int | m_text_index_GT |
int | m_text_index_estimated_traj |
int | m_text_index_timestamp |
int | m_text_index_current_constraint_type |
int | m_text_index_paused_message |
User available keystrokes | |
Keystrokes for toggling the corresponding objects in the CDisplayWindow upon user press | |
std::string | m_keystroke_pause_exec |
std::string | m_keystroke_odometry |
std::string | m_keystroke_GT |
std::string | m_keystroke_estimated_trajectory |
std::string | m_keystroke_map |
Trajectories colors | |
mrpt::utils::TColor | m_odometry_color |
mrpt::utils::TColor | m_GT_color |
mrpt::utils::TColor | m_estimated_traj_color |
mrpt::utils::TColor | m_optimized_map_color |
mrpt::utils::TColor | m_current_constraint_type_color |
Slam Metric related variables | |
std::map< mrpt::utils::TNodeID, size_t > | m_nodeID_to_gt_indices |
Map from nodeIDs to their corresponding closest GT pose index. More... | |
double | m_curr_deformation_energy |
std::vector< double > | m_deformation_energy_vec |
Map-related objects | |
Cached version and corresponding flag of map | |
mrpt::maps::COccupancyGridMap2DPtr | m_gridmap_cached |
mrpt::maps::CSimpleMap | m_simple_map_cached |
Acquired map in CSimpleMap representation. More... | |
mrpt::maps::COctoMapPtr | m_octomap_cached |
bool | m_map_is_cached |
Indicates if the map is cached. More... | |
mrpt::system::TTimeStamp | m_map_acq_time |
Timestamp at which the map was computed. More... | |
Static Protected Attributes | |
static const std::string | header_sep = std::string(80, '-') |
Separator string to be used in debugging messages. More... | |
static const std::string | report_sep = std::string(2, '\n') |
typedef GRAPH_T::constraint_t mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::constraint_t |
Type of graph constraints.
Definition at line 202 of file CGraphSlamEngine.h.
typedef std::map<std::string, mrpt::utils::CFileOutputStream*> mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::fstreams_out |
Handy typedefs.
Map for managing output file streams.
Definition at line 197 of file CGraphSlamEngine.h.
typedef std::map<std::string, mrpt::utils::CFileOutputStream*>::iterator mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::fstreams_out_it |
Map for iterating over output file streams.
Definition at line 199 of file CGraphSlamEngine.h.
typedef GRAPH_T::global_pose_t mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::global_pose_t |
Definition at line 205 of file CGraphSlamEngine.h.
typedef std::map< mrpt::utils::TNodeID, mrpt::obs::CObservation2DRangeScanPtr> mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::nodes_to_scans2D_t |
Definition at line 208 of file CGraphSlamEngine.h.
typedef GRAPH_T::constraint_t::type_value mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::pose_t |
Type of underlying poses (2D/3D).
Definition at line 204 of file CGraphSlamEngine.h.
mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::CGraphSlamEngine | ( | const std::string & | config_file, |
const std::string & | rawlog_fname = "" , |
||
const std::string & | fname_GT = "" , |
||
mrpt::graphslam::CWindowManager * | win_manager = NULL , |
||
mrpt::graphslam::deciders::CNodeRegistrationDecider< GRAPH_T > * | node_reg = NULL , |
||
mrpt::graphslam::deciders::CEdgeRegistrationDecider< GRAPH_T > * | edge_reg = NULL , |
||
mrpt::graphslam::optimizers::CGraphSlamOptimizer< GRAPH_T > * | optimizer = NULL |
||
) |
Constructor of CGraphSlamEngine class template.
// TODO - remove the deprecated arguments
[in] | config_file | .ini file containing the configuration parameters for the CGraphSlamEngine as well as the deciders/optimizer classes that CGraphSlamEngine is using |
[in] | win_manager | CwindowManager instance that includes a pointer to a CDisplayWindow3D and a CWindowObserver instance for properly interacting with the display window |
[in] | rawlog_fname | .rawlog dataset file, containing the robot measurements. CGraphSlamEngine supports both MRPT rwalog formats but in order for graphSLAM to work as expected the rawlog foromat has to be supported by the every decider/optimizer class that CGraphSlamEngine makes use of. |
[in] | fname_GT | Textfile containing the ground truth path of the robot. Currently the class can read ground truth files corresponding either to RGBD - TUM datasets or to rawlog files generated with the GridMapNavSimul MRPT application. // TODO add the deciders/optimizer |
Definition at line 24 of file CGraphSlamEngine_impl.h.
References mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::initClass().
|
virtual |
Default Destructor.
Definition at line 58 of file CGraphSlamEngine_impl.h.
References MRPT_LOG_DEBUG_STREAM, MRPT_LOG_INFO_STREAM, and mrpt::system::strCmpI().
|
virtual |
Main class method responsible for parsing each measurement and for executing graphSLAM.
Definition at line 498 of file CGraphSlamEngine_impl.h.
References ASSERT_, ASSERTMSG_, mrpt::format(), mrpt::system::getCurrentTime(), INVALID_TIMESTAMP, IS_CLASS, MRPT_END, MRPT_LOG_DEBUG_STREAM, MRPT_LOG_ERROR_STREAM, MRPT_START, mrpt::system::strCmpI(), THROW_EXCEPTION, mrpt::system::timeDifference(), and mrpt::system::timeToString().
|
staticprotected |
Definition at line 2411 of file CGraphSlamEngine_impl.h.
References mrpt::poses::CPose2D::phi(), and mrpt::math::wrapToPi().
|
staticprotected |
Definition at line 2417 of file CGraphSlamEngine_impl.h.
References mrpt::poses::CPose3D::pitch(), mrpt::poses::CPose3D::roll(), mrpt::math::wrapToPi(), and mrpt::poses::CPose3D::yaw().
|
protected |
Definition at line 1485 of file CGraphSlamEngine_impl.h.
References ASSERT_, DEG2RAD, MRPT_END, MRPT_LOG_DEBUG_STREAM, and MRPT_START.
|
inline |
Compute the map of the environment based on the recorded measurements.
Definition at line 893 of file CGraphSlamEngine_impl.h.
References ASSERTMSG_, mrpt::format(), MRPT_END, MRPT_START, mrpt::system::now(), and THROW_EXCEPTION.
|
protected |
Compare the SLAM result (estimated trajectory) with the GT path.
See A Comparison of SLAM Algorithms Based on a Graph of Relations for more details on this.
Definition at line 2337 of file CGraphSlamEngine_impl.h.
References MRPT_END, MRPT_LOG_DEBUG_STREAM, and MRPT_START.
|
protected |
Cut down on the size of the given laser scan.
Handy for reducing the size of the resulting mrpt::opengl::CSetOfObjects that would be inserted in the visualization scene. Increase the decimation rate - keep-every_n_entries - to reduce the computational cost of updating the map visualization
Definition at line 1894 of file CGraphSlamEngine_impl.h.
References mrpt::obs::CObservation2DRangeScan::loadFromVectors(), MRPT_END, MRPT_START, mrpt::obs::CObservation2DRangeScan::scan, mrpt::utils::ContainerReadOnlyProxyAccessor< STLCONTAINER >::size(), and mrpt::obs::CObservation2DRangeScan::validRange.
|
protected |
Wrapper method that used for printing error messages in a consistent manner.
Makes use of the COutputLogger instance. Prints error message when toggling illegal visual features in the display window
Definition at line 1699 of file CGraphSlamEngine_impl.h.
References MRPT_END, MRPT_LOG_ERROR_STREAM, MRPT_START, and mrpt::system::sleep().
|
protected |
Wrapper around the GRAPH_T::dijkstra_nodes_estimate.
Update the global position of the nodes
Definition at line 807 of file CGraphSlamEngine_impl.h.
bool mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::execGraphSlamStep | ( | mrpt::obs::CObservationPtr & | observation, |
size_t & | rawlog_entry | ||
) |
Wrapper method around _execGraphSlamStep.
Handy for not having to specify any action/observations objects
Definition at line 485 of file CGraphSlamEngine_impl.h.
void mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::generateReportFiles | ( | const std::string & | output_dir_fname_in | ) |
Generate and write to a corresponding report for each of the respective self/decider/optimizer classes.
[in] | output_dir_fname | directory name to generate the files in. Directory must be crated prior to this call |
Definition at line 2569 of file CGraphSlamEngine_impl.h.
References ASSERTMSG_, mrpt::system::directoryExists(), mrpt::format(), MRPT_END, MRPT_LOG_INFO_STREAM, and MRPT_START.
GRAPH_T::global_pose_t mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getCurrentRobotPosEstimation | ( | ) | const |
Query CGraphSlamEngine instance for the current estimated robot position.
Definition at line 94 of file CGraphSlamEngine_impl.h.
References MRPT_END, and MRPT_START.
void mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getDeformationEnergyVector | ( | std::vector< double > * | vec_out | ) | const |
Fill the given vector with the deformation energy values computed for the SLAM evaluation metric.
[out] | vec_out | deformation energy vector to be filled |
Definition at line 2660 of file CGraphSlamEngine_impl.h.
References ASSERT_, MRPT_END, and MRPT_START.
|
protected |
Fill the provided string with a detailed report of the class state.
Report includes the following:
Definition at line 2487 of file CGraphSlamEngine_impl.h.
References MRPT_END, and MRPT_START.
|
inline |
Return a reference to the underlying GRAPH_T instance.
Definition at line 361 of file CGraphSlamEngine.h.
References mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::m_graph.
bool mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getGraphSlamStats | ( | std::map< std::string, int > * | node_stats, |
std::map< std::string, int > * | edge_stats, | ||
mrpt::system::TTimeStamp * | timestamp = NULL |
||
) |
Fill the given maps with stats regarding the overall execution of graphslam.
Definition at line 2531 of file CGraphSlamEngine_impl.h.
References ASSERTMSG_, MRPT_END, and MRPT_START.
|
protectedvirtual |
return the 3D Pose of a LaserScan that is to be visualized.
Used during the computeMap call for the occupancy gridmap
Definition at line 1750 of file CGraphSlamEngine_impl.h.
void mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getMap | ( | mrpt::maps::COccupancyGridMap2DPtr | map, |
mrpt::system::TTimeStamp * | acquisition_time = NULL |
||
) | const |
Definition at line 849 of file CGraphSlamEngine_impl.h.
References ASSERT_, mrpt::maps::COccupancyGridMap2D::Create(), MRPT_END, and MRPT_START.
void mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getMap | ( | mrpt::maps::COctoMapPtr | map, |
mrpt::system::TTimeStamp * | acquisition_time = NULL |
||
) | const |
Definition at line 872 of file CGraphSlamEngine_impl.h.
References ASSERT_, MRPT_END, MRPT_START, and THROW_EXCEPTION.
|
virtual |
Return the list of nodeIDs which make up robot trajectory.
Definition at line 114 of file CGraphSlamEngine_impl.h.
References ASSERT_, MRPT_END, and MRPT_START.
void mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getParamsAsString | ( | std::string * | params_out | ) | const |
Fill in the provided string with the class configuration parameters.
Definition at line 1036 of file CGraphSlamEngine_impl.h.
References ASSERT_, MRPT_END, and MRPT_START.
std::string mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getParamsAsString | ( | ) | const |
Wrapper around getParamsAsString.
Returns the generated string instead of passing it as an argument to the call
Definition at line 1026 of file CGraphSlamEngine_impl.h.
References MRPT_END, and MRPT_START.
|
inline |
Return the filename of the used rawlog file.
Definition at line 363 of file CGraphSlamEngine.h.
References mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::m_rawlog_fname.
|
virtual |
Definition at line 104 of file CGraphSlamEngine_impl.h.
References ASSERT_, MRPT_END, and MRPT_START.
|
staticprotected |
Fill the TTimestamp in a consistent manner.
Method can be used in both MRPT Rawlog formats
[in] | action_ptr | Pointer to the action (action-observations format) |
[in] | observations | Pointer to list of observations (action-observations format) |
[in] | observation | Pointer to single observation (observation-only format) |
Definition at line 1714 of file CGraphSlamEngine_impl.h.
References ASSERTMSG_, INVALID_TIMESTAMP, MRPT_END, and MRPT_START.
|
protected |
General initialization method to call from the Class Constructors.
Definition at line 124 of file CGraphSlamEngine_impl.h.
References ASSERT_, mrpt::maps::COctoMap::Create(), mrpt::maps::COccupancyGridMap2D::Create(), mrpt::system::extractFileDirectory(), mrpt::system::extractFileName(), mrpt::utils::find(), INVALID_NODEID, INVALID_TIMESTAMP, MRPT_END, MRPT_LOG_INFO_STREAM, MRPT_LOG_WARN_STREAM, MRPT_START, mrpt::system::pause(), mrpt::system::strCmpI(), and THROW_EXCEPTION.
Referenced by mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::CGraphSlamEngine().
|
protected |
Definition at line 1261 of file CGraphSlamEngine_impl.h.
References ASSERT_, MRPT_END, and MRPT_START.
|
protected |
Definition at line 2074 of file CGraphSlamEngine_impl.h.
References ASSERT_, mrpt::mrpt::format(), MRPT_END, and MRPT_START.
|
protected |
Definition at line 1920 of file CGraphSlamEngine_impl.h.
References ASSERT_, mrpt::mrpt::format(), MRPT_END, and MRPT_START.
|
protected |
Definition at line 1198 of file CGraphSlamEngine_impl.h.
References ASSERT_, MRPT_END, and MRPT_START.
|
protected |
Definition at line 1756 of file CGraphSlamEngine_impl.h.
|
protected |
Definition at line 2000 of file CGraphSlamEngine_impl.h.
References ASSERT_, mrpt::mrpt::format(), MRPT_END, and MRPT_START.
|
protected |
Definition at line 1135 of file CGraphSlamEngine_impl.h.
References ASSERT_, MRPT_END, and MRPT_START.
|
protected |
Automate the creation and initialization of a results file relevant to the application.
Open the file (corresponding to the provided filename) and write an introductory message.
Definition at line 1096 of file CGraphSlamEngine_impl.h.
References ASSERTMSG_, mrpt::system::dateTimeToString(), mrpt::system::fileNameStripInvalidChars(), mrpt::mrpt::format(), mrpt::system::getCurrentLocalTime(), mrpt::system::getCurrentTime(), MRPT_END, MRPT_LOG_INFO_STREAM, and MRPT_START.
|
protected |
Definition at line 1241 of file CGraphSlamEngine_impl.h.
|
protected |
Method to help overcome the partial template specialization restriction of C++.
Apply polymorphism by overloading function arguments instead
Definition at line 1248 of file CGraphSlamEngine_impl.h.
References mrpt::opengl::stock_objects::RobotPioneer().
|
protected |
Definition at line 1255 of file CGraphSlamEngine_impl.h.
References mrpt::opengl::stock_objects::CornerXYZ().
|
protected |
Definition at line 2431 of file CGraphSlamEngine_impl.h.
References ASSERT_, MRPT_END, MRPT_LOG_DEBUG_STREAM, and MRPT_START.
|
protected |
|
inline |
Definition at line 444 of file CGraphSlamEngine.h.
References mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::m_is_paused.
Referenced by mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::pauseExec(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::resumeExec(), and mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::togglePause().
void mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::loadParams | ( | const std::string & | fname | ) |
Read the configuration variables from the .ini file specified by the user.
Method is automatically called, upon CGraphSlamEngine initialization
Definition at line 944 of file CGraphSlamEngine_impl.h.
References ASSERTMSG_, mrpt::system::fileExists(), mrpt::mrpt::format(), MRPT_END, MRPT_LOG_INFO_STREAM, MRPT_START, mrpt::utils::CConfigFileBase::read_bool(), mrpt::utils::CConfigFileBase::read_int(), and mrpt::utils::CConfigFileBase::read_string().
|
protectedvirtual |
Assert that the given nodes number matches the registered graph nodes, otherwise throw exception.
logic_error if the expected node count mismatches with the graph current node count.
Definition at line 818 of file CGraphSlamEngine_impl.h.
References ASSERTMSG_, mrpt::format(), INVALID_NODEID, MRPT_END, MRPT_LOG_ERROR_STREAM, MRPT_START, and THROW_EXCEPTION.
|
inline |
Definition at line 469 of file CGraphSlamEngine.h.
References mrpt::gui::CDisplayWindow3D::addTextMessage(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::isPaused(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::m_enable_visuals, mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::m_is_paused, mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::m_keystroke_pause_exec, mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::m_paused_message, mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::m_text_index_paused_message, mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::m_win, MRPT_LOG_WARN_STREAM, mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::queryObserverForEvents(), mrpt::system::sleep(), and mrpt::system::upperCase().
Referenced by mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::togglePause().
void mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::printParams | ( | ) | const |
Print the problem parameters to the console for verification.
Method is a wrapper around CGraphSlamEngine::getParamsAsString method
Definition at line 1084 of file CGraphSlamEngine_impl.h.
References MRPT_END, and MRPT_START.
|
inlineprotected |
Query the observer instance for any user events.
Query the given observer for any events (keystrokes, mouse clicks, that may have occurred in the CDisplayWindow3D and fill in the corresponding class variables
Definition at line 1539 of file CGraphSlamEngine_impl.h.
References ASSERT_, ASSERTMSG_, MRPT_END, and MRPT_START.
Referenced by mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::pauseExec().
|
static |
Parse the ground truth .txt file and fill in the corresponding gt_poses vector.
It is assumed that the rawlog, thererfore the groundtruth file has been generated using the GridMapNavSimul MRPT application. If not user should abide the ground-truth file format to that of the files generated by the GridMapNavSimul app.
[in] | fname_GT | Ground truth filename from which the measurements are to be read |
[out] | gt_poses | std::vector which is to contain the 2D ground truth poses. |
[out] | gt_timestamps | std::vector which is to contain the timestamps for the corresponding ground truth poses. Ignore this argument if timestamps are not needed. |
Definition at line 1313 of file CGraphSlamEngine_impl.h.
References ASSERTMSG_, mrpt::utils::CFileInputStream::close(), mrpt::system::fileExists(), mrpt::utils::CFileInputStream::fileOpenCorrectly(), mrpt::format(), MRPT_END, MRPT_START, mrpt::utils::CFileInputStream::readLine(), and mrpt::system::tokenize().
|
static |
Definition at line 1364 of file CGraphSlamEngine_impl.h.
References THROW_EXCEPTION.
|
static |
Parse the ground truth .txt file and fill in the corresponding m_GT_poses vector.
The poses returned are given with regards to the MRPT reference frame.
It is assumed that the groundtruth file has been generated using the rgbd_dataset2rawlog MRPT tool.
[in] | fname_GT | Ground truth filename from which the measurements are to be read |
[out] | gt_poses | std::vector which is to contain the 2D ground truth poses. |
[out] | gt_timestamps | std::vector which is to contain the timestamps for the corresponding ground truth poses. Ignore this argument if timestamps are not needed. |
Definition at line 1372 of file CGraphSlamEngine_impl.h.
References ASSERTMSG_, mrpt::utils::CFileInputStream::close(), mrpt::system::fileExists(), mrpt::utils::CFileInputStream::fileOpenCorrectly(), mrpt::format(), MRPT_END, MRPT_START, mrpt::math::CQuaternion< T >::r(), mrpt::utils::CFileInputStream::readLine(), mrpt::math::CQuaternion< T >::rpy(), mrpt::system::tokenize(), mrpt::math::CQuaternion< T >::x(), mrpt::math::CQuaternion< T >::y(), and mrpt::math::CQuaternion< T >::z().
|
inline |
Definition at line 456 of file CGraphSlamEngine.h.
References mrpt::gui::CDisplayWindow3D::addTextMessage(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::isPaused(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::m_enable_visuals, mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::m_is_paused, mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::m_text_index_paused_message, mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::m_win, and MRPT_LOG_INFO_STREAM.
Referenced by mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::togglePause().
void mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::save3DScene | ( | const std::string * | fname_in = NULL | ) | const |
Wrapper method around the COpenGLScene::saveToFile method.
[in] | Name | of the generated graph file - Defaults to "output_graph" if not set by the user |
Definition at line 2293 of file CGraphSlamEngine_impl.h.
References ASSERTMSG_, MRPT_END, MRPT_LOG_DEBUG_STREAM, MRPT_LOG_ERROR_STREAM, MRPT_LOG_INFO_STREAM, and MRPT_START.
void mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::saveGraph | ( | const std::string * | fname_in = NULL | ) | const |
Wrapper method around the GRAPH_T::saveToTextFile method.
Method saves the graph in the format used by TORO & HoG-man strategies
[in] | fname_in | Name of the generated graph file - Defaults to "output_graph" if not set by the user |
Definition at line 2272 of file CGraphSlamEngine_impl.h.
References MRPT_END, MRPT_LOG_INFO_STREAM, and MRPT_START.
|
protected |
Set the opengl model that indicates the latest position of the trajectory at hand.
[in] | model_name | Name of the resulting opengl object. |
[in] | model_color | Color of the object. |
[in] | model_size | Scaling of the object. |
[in] | init_pose | Initial position of the object. |
Definition at line 2639 of file CGraphSlamEngine_impl.h.
References ASSERTMSG_, and model.
|
protectedvirtual |
Set the properties of the map visual object based on the nodeID that it was produced by.
Derived classes may override this method if they want to have different visual properties (color, shape etc.) for different nodeIDs.
Definition at line 1885 of file CGraphSlamEngine_impl.h.
References MRPT_END, and MRPT_START.
|
protected |
Definition at line 1672 of file CGraphSlamEngine_impl.h.
References ASSERT_, MRPT_END, MRPT_LOG_INFO_STREAM, and MRPT_START.
|
protected |
Definition at line 1607 of file CGraphSlamEngine_impl.h.
References ASSERT_, MRPT_END, MRPT_LOG_INFO_STREAM, and MRPT_START.
|
protected |
Definition at line 1634 of file CGraphSlamEngine_impl.h.
References ASSERT_, MRPT_END, MRPT_LOG_INFO_STREAM, and MRPT_START.
|
protected |
Definition at line 1581 of file CGraphSlamEngine_impl.h.
References ASSERT_, MRPT_END, MRPT_LOG_INFO_STREAM, and MRPT_START.
|
inline |
Definition at line 448 of file CGraphSlamEngine.h.
References mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::isPaused(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::pauseExec(), and mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::resumeExec().
|
protected |
Wrapper around the deciders/optimizer updateVisuals methods.
Definition at line 1155 of file CGraphSlamEngine_impl.h.
References MRPT_END, and MRPT_START.
|
inlineprotectedvirtual |
Update the viewport responsible for displaying the graph-building procedure in the estimated position of the robot.
Definition at line 1290 of file CGraphSlamEngine_impl.h.
References ASSERT_, MRPT_END, MRPT_LOG_DEBUG_STREAM, and MRPT_START.
|
protected |
Update the Esstimated robot trajectory with the latest estimated robot position.
Update CSetOfLines visualization object with the latest graph node position. If full update is asked, method clears the CSetOfLines object and redraws all the lines based on the updated (optimized) positions of the nodes
Definition at line 2123 of file CGraphSlamEngine_impl.h.
References ASSERT_, MRPT_END, and MRPT_START.
|
protected |
Display the next ground truth position in the visualization window.
Definition at line 1967 of file CGraphSlamEngine_impl.h.
References ASSERT_, MRPT_END, and MRPT_START.
|
protected |
In RGB-D TUM Datasets update the Intensity image displayed in a seperate viewport.
Definition at line 1217 of file CGraphSlamEngine_impl.h.
References ASSERT_, MRPT_END, and MRPT_START.
|
protected |
Update the map visualization based on the current graphSLAM state.
Map is produced by arranging the range scans based on the estimated robot trajectory.
Definition at line 1768 of file CGraphSlamEngine_impl.h.
References ASSERT_, mrpt::maps::CPointsMap::getAs3DObject(), mrpt::maps::CMetricMap::insertObservation(), MRPT_END, MRPT_LOG_DEBUG_STREAM, MRPT_START, mrpt::utils::CTicTac::Tac(), and mrpt::utils::CTicTac::Tic().
|
protected |
Update odometry-only cloud with latest odometry estimation.
Definition at line 2043 of file CGraphSlamEngine_impl.h.
References ASSERT_, ASSERTMSG_, MRPT_END, and MRPT_START.
|
protected |
In RGB-D TUM Datasets update the Range image displayed in a seperate viewport.
Definition at line 1169 of file CGraphSlamEngine_impl.h.
References ASSERT_, MRPT_END, and MRPT_START.
|
protected |
Update the displayPlots window with the new information with regards to the metric.
Definition at line 2455 of file CGraphSlamEngine_impl.h.
References ASSERT_, MRPT_END, and MRPT_START.
|
staticprotected |
Separator string to be used in debugging messages.
Definition at line 1013 of file CGraphSlamEngine.h.
|
protected |
Definition at line 996 of file CGraphSlamEngine.h.
|
protected |
Definition at line 760 of file CGraphSlamEngine.h.
|
protected |
Definition at line 929 of file CGraphSlamEngine.h.
|
protected |
Current robot position based solely on odometry.
Definition at line 969 of file CGraphSlamEngine.h.
|
protected |
Current dataset timestamp.
Definition at line 967 of file CGraphSlamEngine.h.
|
protected |
Type of constraint currently in use.
Definition at line 1009 of file CGraphSlamEngine.h.
|
protected |
Definition at line 898 of file CGraphSlamEngine.h.
|
protected |
Time it took to record the dataset.
Processing time should (at least) be equal to the grab time for the algorithm to run in real-time
Definition at line 962 of file CGraphSlamEngine.h.
|
protected |
Definition at line 930 of file CGraphSlamEngine.h.
|
protected |
Instance to keep track of all the edges + visualization related operations.
Definition at line 865 of file CGraphSlamEngine.h.
|
protected |
Definition at line 753 of file CGraphSlamEngine.h.
|
protected |
Definition at line 810 of file CGraphSlamEngine.h.
|
protected |
Definition at line 811 of file CGraphSlamEngine.h.
|
protected |
Definition at line 812 of file CGraphSlamEngine.h.
|
protected |
Determine if we are to enable visualization support or not.
Definition at line 758 of file CGraphSlamEngine.h.
Referenced by mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::pauseExec(), and mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::resumeExec().
|
protected |
Definition at line 896 of file CGraphSlamEngine.h.
|
protected |
First recorded laser scan - assigned to the root.
Definition at line 887 of file CGraphSlamEngine.h.
|
protected |
Definition at line 768 of file CGraphSlamEngine.h.
|
protected |
The graph object to be built and optimized.
Definition at line 746 of file CGraphSlamEngine.h.
Referenced by mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getGraph().
|
protected |
Mark graph modification/accessing explicitly for multithreaded implementation.
Definition at line 915 of file CGraphSlamEngine.h.
|
mutableprotected |
Definition at line 980 of file CGraphSlamEngine.h.
|
protected |
Definition at line 895 of file CGraphSlamEngine.h.
|
protected |
Definition at line 878 of file CGraphSlamEngine.h.
|
protected |
Definition at line 876 of file CGraphSlamEngine.h.
|
protected |
Counter for reading back the GT_poses.
Definition at line 771 of file CGraphSlamEngine.h.
|
protected |
Rate at which to read the GT poses.
Definition at line 773 of file CGraphSlamEngine.h.
|
protected |
Definition at line 777 of file CGraphSlamEngine.h.
|
protected |
Definition at line 919 of file CGraphSlamEngine.h.
|
protected |
Definition at line 920 of file CGraphSlamEngine.h.
|
protected |
|
protected |
First recorded timestamp in the dataset.
Definition at line 965 of file CGraphSlamEngine.h.
|
protected |
Track the first node registration occurance.
Handy so that we can assign a measurement to the root node as well.
Definition at line 1001 of file CGraphSlamEngine.h.
|
mutableprotected |
Indicated if program is temporarily paused by the user.
Definition at line 817 of file CGraphSlamEngine.h.
Referenced by mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::isPaused(), mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::pauseExec(), and mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::resumeExec().
|
protected |
Definition at line 858 of file CGraphSlamEngine.h.
|
protected |
Definition at line 857 of file CGraphSlamEngine.h.
|
protected |
Definition at line 859 of file CGraphSlamEngine.h.
|
protected |
Definition at line 856 of file CGraphSlamEngine.h.
|
protected |
Definition at line 855 of file CGraphSlamEngine.h.
Referenced by mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::pauseExec().
|
protected |
Last laser scan that the current class instance received.
Definition at line 885 of file CGraphSlamEngine.h.
|
protected |
Last laser scan that the current class instance received.
Definition at line 890 of file CGraphSlamEngine.h.
|
mutableprotected |
Timestamp at which the map was computed.
Definition at line 993 of file CGraphSlamEngine.h.
|
mutableprotected |
Indicates if the map is cached.
Definition at line 988 of file CGraphSlamEngine.h.
|
protected |
Definition at line 752 of file CGraphSlamEngine.h.
|
protected |
Internal counter for querying for the number of nodeIDs.
Handy for not locking the m_graph resource
Definition at line 911 of file CGraphSlamEngine.h.
|
protected |
Map from nodeIDs to their corresponding closest GT pose index.
Keep track of the nodeIDs instead of the node positions as the latter are about to change in the Edge Registration / Loop closing procedures
Definition at line 928 of file CGraphSlamEngine.h.
|
protected |
Map of NodeIDs to their corresponding LaserScans.
Definition at line 882 of file CGraphSlamEngine.h.
|
protected |
Definition at line 778 of file CGraphSlamEngine.h.
|
mutableprotected |
Definition at line 983 of file CGraphSlamEngine.h.
|
protected |
Definition at line 894 of file CGraphSlamEngine.h.
|
protected |
Definition at line 875 of file CGraphSlamEngine.h.
|
protected |
Offset from the left side of the canvas.
Common for all the messages that are displayed on that side.
Definition at line 833 of file CGraphSlamEngine.h.
|
protected |
Definition at line 839 of file CGraphSlamEngine.h.
|
protected |
Definition at line 837 of file CGraphSlamEngine.h.
|
protected |
Definition at line 836 of file CGraphSlamEngine.h.
|
protected |
Definition at line 835 of file CGraphSlamEngine.h.
|
protected |
Definition at line 840 of file CGraphSlamEngine.h.
|
protected |
Definition at line 838 of file CGraphSlamEngine.h.
|
protected |
Definition at line 897 of file CGraphSlamEngine.h.
|
protected |
Definition at line 754 of file CGraphSlamEngine.h.
|
protected |
keeps track of the out fstreams so that they can be closed (if still open) in the class Dtor.
Definition at line 783 of file CGraphSlamEngine.h.
|
protected |
Message to be displayed while paused.
Definition at line 820 of file CGraphSlamEngine.h.
Referenced by mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::pauseExec().
|
protected |
Rawlog file from which to read the measurements.
If string is empty, process is to be run online
Definition at line 766 of file CGraphSlamEngine.h.
Referenced by mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::getRawlogFname().
|
protected |
Indicate whether the user wants to exit the application (e.g.
pressed by pressign ctrl-c)
Definition at line 974 of file CGraphSlamEngine.h.
|
protected |
How big are the robots going to be in the scene.
Definition at line 906 of file CGraphSlamEngine.h.
|
protected |
Definition at line 904 of file CGraphSlamEngine.h.
|
mutableprotected |
Acquired map in CSimpleMap representation.
Definition at line 982 of file CGraphSlamEngine.h.
|
protected |
MRPT CNetworkOfPoses constraint classes that are currently supported.
Definition at line 1006 of file CGraphSlamEngine.h.
|
protected |
Definition at line 846 of file CGraphSlamEngine.h.
|
protected |
Definition at line 844 of file CGraphSlamEngine.h.
|
protected |
Definition at line 843 of file CGraphSlamEngine.h.
|
protected |
Definition at line 842 of file CGraphSlamEngine.h.
|
protected |
Definition at line 847 of file CGraphSlamEngine.h.
Referenced by mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::pauseExec(), and mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::resumeExec().
|
protected |
Definition at line 845 of file CGraphSlamEngine.h.
|
protected |
Time logger instance.
Definition at line 743 of file CGraphSlamEngine.h.
|
protected |
Flag for specifying if we are going to use ground truth data at all.
This is set to true either if the evolution of the SLAM metric or the ground truth visualization is set to true.
Definition at line 872 of file CGraphSlamEngine.h.
|
protected |
Definition at line 775 of file CGraphSlamEngine.h.
|
protected |
Definition at line 808 of file CGraphSlamEngine.h.
|
protected |
Definition at line 806 of file CGraphSlamEngine.h.
|
protected |
Definition at line 807 of file CGraphSlamEngine.h.
|
protected |
Definition at line 805 of file CGraphSlamEngine.h.
|
protected |
Definition at line 809 of file CGraphSlamEngine.h.
|
protected |
Definition at line 788 of file CGraphSlamEngine.h.
Referenced by mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::pauseExec(), and mrpt::graphslam::CGraphSlamEngine< GRAPH_T >::resumeExec().
|
protected |
Definition at line 787 of file CGraphSlamEngine.h.
|
protected |
Definition at line 789 of file CGraphSlamEngine.h.
|
protected |
DisplayPlots instance for visualizing the evolution of the SLAM metric.
Definition at line 793 of file CGraphSlamEngine.h.
|
staticprotected |
Definition at line 1014 of file CGraphSlamEngine.h.
Page generated by Doxygen 1.8.14 for MRPT 1.5.9 Git: 690a4699f Wed Apr 15 19:29:53 2020 +0200 at miƩ abr 15 19:30:12 CEST 2020 |