Typedefs | Functions
openni_listener.cpp File Reference
#include "parameter_server.h"
#include "pcl/ros/conversions.h"
#include <pcl/common/distances.h>
#include <pcl/io/io.h>
#include <pcl/io/impl/pcd_io.hpp>
#include "pcl_ros/transforms.h"
#include "openni_listener.h"
#include <cv_bridge/cv_bridge.h>
#include <opencv2/imgproc/imgproc.hpp>
#include <iostream>
#include <sstream>
#include <algorithm>
#include <string>
#include <cv.h>
#include <sensor_msgs/PointCloud2.h>
#include <Eigen/Core>
#include "node.h"
#include "misc.h"
#include "features.h"
#include <rosbag/view.h>
#include <boost/foreach.hpp>
#include "scoped_timer.h"
#include <tf/transform_listener.h>
Include dependency graph for openni_listener.cpp:

Go to the source code of this file.

Typedefs

typedef
message_filters::Subscriber
< sensor_msgs::CameraInfo > 
cinfo_sub_type
typedef
message_filters::Subscriber
< sensor_msgs::Image > 
image_sub_type
typedef
message_filters::Subscriber
< nav_msgs::Odometry > 
odom_sub_type
typedef
message_filters::Subscriber
< sensor_msgs::PointCloud2 > 
pc_sub_type

Functions

void addTFMessageDirectlyToTransformer (tf::tfMessageConstPtr msg, tf::Transformer *transformer)
static void calculateDepthMask (cv::Mat_< uchar > &depth_img, const pointcloud_type::Ptr point_cloud)
static std::vector< std::string > createTopicsVector (const std::string &visua_tpc, const std::string &depth_tpc, const std::string &points_tpc, const std::string &cinfo_tpc, const std::string &odom_tpc, const std::string &tf_tpc)
bool readOneFile (const QString &qfilename, sensor_msgs::PointCloud2 &cloud)
bool readOneFile (const QString &qfilename, pointcloud_type::Ptr cloud)

Typedef Documentation

typedef message_filters::Subscriber<sensor_msgs::CameraInfo> cinfo_sub_type

Definition at line 56 of file openni_listener.cpp.

typedef message_filters::Subscriber<sensor_msgs::Image> image_sub_type

Definition at line 55 of file openni_listener.cpp.

typedef message_filters::Subscriber<nav_msgs::Odometry> odom_sub_type

Definition at line 58 of file openni_listener.cpp.

typedef message_filters::Subscriber<sensor_msgs::PointCloud2> pc_sub_type

Definition at line 57 of file openni_listener.cpp.


Function Documentation

void addTFMessageDirectlyToTransformer ( tf::tfMessageConstPtr  msg,
tf::Transformer transformer 
)

Helper for loadBag to circumvent ugly pointer mess if using tflistener by sending out tf messages instead of directly adding it to the "Transformer" base class of TransformListener

Definition at line 64 of file openni_listener.cpp.

static void calculateDepthMask ( cv::Mat_< uchar > &  depth_img,
const pointcloud_type::Ptr  point_cloud 
) [static]

Definition at line 519 of file openni_listener.cpp.

static std::vector<std::string> createTopicsVector ( const std::string &  visua_tpc,
const std::string &  depth_tpc,
const std::string &  points_tpc,
const std::string &  cinfo_tpc,
const std::string &  odom_tpc,
const std::string &  tf_tpc 
) [static]

Definition at line 193 of file openni_listener.cpp.

bool readOneFile ( const QString &  qfilename,
sensor_msgs::PointCloud2 &  cloud 
)

Definition at line 1017 of file openni_listener.cpp.

bool readOneFile ( const QString &  qfilename,
pointcloud_type::Ptr  cloud 
)

Definition at line 1037 of file openni_listener.cpp.



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