#include "Eigen/Core"
#include "Eigen/Geometry"
#include <map>
#include <string>
#include <sstream>
#include <fstream>
#include <iostream>
#include <cstdio>
#include <cstdlib>
#include <ctime>
#include "boost/foreach.hpp"
#include "message_filters/subscriber.h"
#include "message_filters/time_synchronizer.h"
#include "sensor_msgs/PointCloud2.h"
#include "tf/tfMessage.h"
#include "tf2/buffer_core.h"
#include "rosbag/bag.h"
#include "rosbag/query.h"
#include "rosbag/view.h"
#include "sensor_msgs/CameraInfo.h"
#include <argtable2.h>
#include <regex.h>
#include "pointmatcher/PointMatcher.h"
#include "pointmatcher/Timer.h"
#include "pointmatcher_ros/point_cloud.h"
#include "icp_chain_creation.h"
Go to the source code of this file.
Classes | |
struct | Datum |
Defines | |
#define | EIGEN2_SUPPORT_STAGE30_FULL_EIGEN3_API |
Typedefs | |
typedef vector< Datum > | Data |
typedef map< string, string > | Params |
Functions | |
template<typename T > | |
T | getParam (const std::string &name, const T &defaultValue) |
template<typename T > | |
T | getParam (const std::string &name) |
bool | hasParam (const std::string &name) |
int | main (int argc, char **argv) |
TP | msgTransformToTP (const geometry_msgs::Transform &transform) |
void | openWriteFile (ofstream &stream, arg_file *file, const int errorVal) |
void | reloadParamsFromLine (ifstream &ifs) |
TP | T_k_to_v (TP::Identity(4, 4)) |
TP | T_v_to_k (TP::Identity(4, 4)) |
Variables | |
Params | params |
Definition at line 2 of file matcher_bag.cpp.
Definition at line 129 of file matcher_bag.cpp.
Definition at line 33 of file matcher_bag.cpp.
T getParam | ( | const std::string & | name, |
const T & | defaultValue | ||
) |
Definition at line 45 of file matcher_bag.cpp.
T getParam | ( | const std::string & | name | ) |
Definition at line 64 of file matcher_bag.cpp.
bool hasParam | ( | const std::string & | name | ) |
Definition at line 39 of file matcher_bag.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 144 of file matcher_bag.cpp.
TP msgTransformToTP | ( | const geometry_msgs::Transform & | transform | ) |
Definition at line 134 of file matcher_bag.cpp.
void openWriteFile | ( | ofstream & | stream, |
arg_file * | file, | ||
const int | errorVal | ||
) |
Definition at line 105 of file matcher_bag.cpp.
void reloadParamsFromLine | ( | ifstream & | ifs | ) |
Definition at line 82 of file matcher_bag.cpp.
Definition at line 37 of file matcher_bag.cpp.