Classes | Defines | Functions | Variables
slam.cpp File Reference

Redistribution and use in source and binary forms, with or without modification, are permitted provided that the following conditions are met: More...

#include <ros/ros.h>
#include <rosbag/bag.h>
#include <rosbag/view.h>
#include <pcl/point_types.h>
#include <pcl/point_cloud.h>
#include <pcl/io/pcd_io.h>
#include <pcl/registration/transforms.h>
#include <cob_3d_mapping_slam/curved_polygons/debug_interface.h>
#include <cob_3d_mapping_slam/slam/context.h>
#include <cob_3d_mapping_slam/slam/node.h>
#include <cob_3d_mapping_slam/dof/tflink.h>
#include <cob_3d_mapping_slam/dof/dof_uncertainty.h>
#include <cob_3d_mapping_slam/dof/dof_variance.h>
#include <cob_3d_mapping_slam/slam/dummy/objctxt.h>
#include <cob_3d_mapping_slam/slam/dummy/registration.h>
#include <cob_3d_mapping_slam/slam/dummy/key.h>
#include <cob_3d_mapping_slam/slam/dummy/robot.h>
#include <cob_3d_mapping_slam/curved_polygons/objctxt.h>
#include <cob_3d_mapping_slam/curved_polygons/key.h>
#include <cob_3d_mapping_msgs/ShapeArray.h>
#include <cob_3d_mapping_msgs/CurvedPolygon_Array.h>
#include "gnuplot_i.hpp"
#include <gtest/gtest.h>
#include <boost/random/mersenne_twister.hpp>
#include <boost/random/uniform_real.hpp>
#include <boost/random/variate_generator.hpp>
#include <visualization_msgs/Marker.h>
#include <nav_msgs/Odometry.h>
Include dependency graph for slam.cpp:

Go to the source code of this file.

Classes

struct  SOdomotry_Data

Defines

#define CYCLES   100
#define DEBUG_

Functions

template<typename Matrix >
float MATRIX_DISTANCE (const Matrix &a, const Matrix &b, const float thr=0.05)

Variables

static const char * BAGFILES [][512]
static const char * GROUNDTRUTH [][512]

Detailed Description

Redistribution and use in source and binary forms, with or without modification, are permitted provided that the following conditions are met:

Note:
Copyright (c) 2012
Fraunhofer Institute for Manufacturing Engineering and Automation (IPA)

Project name: TODO FILL IN PROJECT NAME HERE
ROS stack name: TODO FILL IN STACK NAME HERE
ROS package name: TODO FILL IN PACKAGE NAME HERE
Author:
Author: TODO FILL IN AUTHOR NAME HERE
Supervised by: TODO FILL IN CO-AUTHOR NAME(S) HERE
Date:
Date of creation: TODO FILL IN DATE HERE

This program is free software: you can redistribute it and/or modify it under the terms of the GNU Lesser General Public License LGPL as published by the Free Software Foundation, either version 3 of the License, or (at your option) any later version.

This program is distributed in the hope that it will be useful, but WITHOUT ANY WARRANTY; without even the implied warranty of MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE. See the GNU Lesser General Public License LGPL for more details.

You should have received a copy of the GNU Lesser General Public License LGPL along with this program. If not, see <http://www.gnu.org/licenses/>.

Definition in file slam.cpp.


Define Documentation

#define CYCLES   100

Definition at line 104 of file slam.cpp.

#define DEBUG_

Definition at line 68 of file slam.cpp.


Function Documentation

template<typename Matrix >
float MATRIX_DISTANCE ( const Matrix &  a,
const Matrix &  b,
const float  thr = 0.05 
)

Definition at line 143 of file slam.cpp.


Variable Documentation

const char* BAGFILES[][512] [static]
Initial value:
{
                                    
                                    {
                                     
                                     
                                     
                                     
                                     
                                     
                                     
                                     
                                     "test/cp4_rgbd_dataset_freiburg2_rpy2.bag",
                                     
                                     
                                     
                                     
                                     
                                     
                                     
                                     
                                     
                                     
                                     
                                     (const char*)0}
}

Definition at line 105 of file slam.cpp.

const char* GROUNDTRUTH[][512] [static]
Initial value:
{
                                       {
                                        
                                        "test/rgbd_dataset_freiburg2_rpy-groundtruth.txt",
                                        
                                        
                                        0
                                       }
}

Definition at line 131 of file slam.cpp.



cob_3d_mapping_slam
Author(s): Joshua Hampp
autogenerated on Wed Aug 26 2015 11:04:51