Classes | Functions
slam_main.cpp File Reference

starts the program's main loop More...

#include <ros/ros.h>
#include <sensor_msgs/PointCloud2.h>
#include <sensor_msgs/Image.h>
#include <pcl/ros/conversions.h>
#include <pcl/point_cloud.h>
#include <cv_bridge/CvBridge.h>
#include <pcl/io/pcd_io.h>
#include <pcl/point_types.h>
#include <highgui.h>
#include <cv.h>
#include <boost/thread/mutex.hpp>
#include <pcl/features/feature.h>
#include <pcl/registration/registration.h>
#include <pcl/registration/transformation_estimation.h>
#include <pcl/common/transformation_from_correspondences.h>
#include <std_msgs/String.h>
#include <tf/transform_broadcaster.h>
#include <geometry_msgs/Point.h>
#include <cv_bridge/cv_bridge.h>
#include "re_kinect_object_detector/DetectionResult.h"
#include "recognitionmodel.h"
Include dependency graph for slam_main.cpp:

Go to the source code of this file.

Classes

class  ROSCom

Functions

int main (int argc, char *argv[])
tf::Transform tfFromEigen (Eigen::Matrix4f trans)
 convert libEigen matrix to a tf::Transform

Detailed Description

starts the program's main loop

This file is part of the RoboEarth ROS re_kinect_object_detector package.

It file was originally created for RoboEarth. The research leading to these results has received funding from the European Union Seventh Framework Programme FP7/2007-2013 under grant agreement no248942 RoboEarth.

Copyright (C) 2011 by Andreas Koch, University of Stuttgart

This program is free software: you can redistribute it and/or modify it under the terms of the GNU General Public License 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 General Public License for more details.

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

Author:
Andreas Koch
Version:
1.0
Date:
2011
RoboEarth.org_logo.gif

Definition in file slam_main.cpp.


Function Documentation

int main ( int  argc,
char *  argv[] 
)

Definition at line 214 of file slam_main.cpp.

tf::Transform tfFromEigen ( Eigen::Matrix4f  trans)

convert libEigen matrix to a tf::Transform

Definition at line 59 of file slam_main.cpp.



re_kinect_object_detector
Author(s): Andreas Koch
autogenerated on Sun Jan 5 2014 11:38:30