Classes | Typedefs | Functions
node.h File Reference
#include "ros/ros.h"
#include <vector>
#include <opencv2/core/core.hpp>
#include <opencv2/features2d/features2d.hpp>
#include <Eigen/Core>
#include <sensor_msgs/PointCloud2.h>
#include <sensor_msgs/CameraInfo.h>
#include "parameter_server.h"
#include <tf/transform_datatypes.h>
#include <QMutex>
#include "matching_result.h"
#include <Eigen/StdVector>
#include "header.h"
Include dependency graph for node.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  Node
 Holds the data for one graph node and provides functionality to compute relative transformations to other Nodes. More...

Typedefs

typedef std::vector
< Eigen::Vector4f,
Eigen::aligned_allocator
< Eigen::Vector4f > > 
std_vector_of_eigen_vector4f

Functions

void pairwiseObservationLikelihood (const Node *newer_node, const Node *older_node, MatchingResult &mr)
void squareroot_descriptor_space (cv::Mat &feature_descriptors)
 Compute the RootSIFT from SIFT according to Arandjelovic and Zisserman.

Typedef Documentation

typedef std::vector<Eigen::Vector4f, Eigen::aligned_allocator<Eigen::Vector4f> > std_vector_of_eigen_vector4f

Definition at line 57 of file node.h.


Function Documentation

void pairwiseObservationLikelihood ( const Node newer_node,
const Node older_node,
MatchingResult mr 
)

Definition at line 1518 of file node.cpp.

void squareroot_descriptor_space ( cv::Mat &  feature_descriptors)

Compute the RootSIFT from SIFT according to Arandjelovic and Zisserman.

Definition at line 1555 of file node.cpp.



rgbdslam_v2
Author(s): Felix Endres, Juergen Hess, Nikolas Engelhard
autogenerated on Thu Jun 6 2019 21:49:45