Namespaces | Defines | Typedefs | Functions | Variables
SRUtils.cpp File Reference
#include "shape_reconstruction/SRUtils.h"
#include <opencv2/imgproc/imgproc.hpp>
#include <opencv2/video/tracking.hpp>
#include <opencv2/highgui/highgui.hpp>
#include "shape_reconstruction/RangeImagePlanar.hpp"
Include dependency graph for SRUtils.cpp:

Go to the source code of this file.

Namespaces

namespace  omip

Defines

#define FILTER_LEN   11
#define FILTER_RAD   5
#define FILTER_SIZE   121
#define MAX_UCHAR   255
#define PI   3.14159

Typedefs

typedef unsigned char uint8_t

Functions

void omip::calc_pyr_sizes (int *heights, int *widths, int *pyr_offsets)
void omip::cbf (uint8_t *depth, uint8_t *intensity, bool *mask, uint8_t *result, double *sigma_s, double *sigma_r)
void omip::cbf_cpu (const float *depth, const float *intensity, bool *is_missing, bool *valid_in, bool *valid_out, float *result, const int *abs_inds, const int *offsets, const float *gaussian_space, int height, int width, float sigma_s, float sigma_r, int numThreads, int idx)
void omip::create_offset_array (int *offsets_h, int img_height)
void omip::create_spatial_gaussian (float sigma_s, float *gaussian_h)
void omip::DepthImage2CvImage (const cv::Mat &depth_image_raw, sensor_msgs::ImagePtr &depth_msg)
void omip::drawOptFlowMap (const cv::Mat &flow, cv::Mat &cflowmap, int step, double scale, const cv::Scalar &color)
void omip::drawOpticalFlowModule (const cv::Mat &optical_flow, cv::Mat &optical_flow_module)
cv::Mat omip::fill_depth_cbf (cv::Mat imgRgb, cv::Mat imgDepthAbs, double *spaceSigmas, double *rangeSigmas)
void omip::fillNaNsCBF (const sensor_msgs::Image &color_img, const cv::Mat &depth_img, cv::Mat &filled_depth_img, ros::Time query_time)
void omip::filter_at_scale (float *depth_h, float *intensity_h, bool *mask_h, bool *valid_h, float *result_h, int *abs_inds_to_filter_h, int height, int width, float sigma_s, float sigma_r)
int omip::get_missing_pixel_coords (int height, int width, bool *mask, int *abs_inds_to_filter_h)
int omip::get_pyr_size (int *heights, int *widths)
void omip::Image8u2Indices (const cv::Mat &image_8u, pcl::PointIndices::Ptr indices_ptr)
void omip::Indices2Image8u (const std::vector< int > &indices, cv::Mat &image_8u)
void omip::OrganizedPC2ColorMap (const SRPointCloud::Ptr organized_pc, cv::Mat &color_map_mat)
void omip::OrganizedPC2DepthMap (const SRPointCloud::Ptr organized_pc, cv::Mat &depth_map_mat)
void omip::OrganizedPC2DepthMapAlternative (const SRPointCloud::Ptr organized_pc, const cv::Ptr< cv::Mat > &depth_map_mat_ptr)
void omip::RangeImagePlanar2DepthMap (const pcl::RangeImagePlanar::Ptr &rip, cv::Mat &depth_map_mat)
void omip::RangeImagePlanar2PointCloud (const pcl::RangeImagePlanar::Ptr &rip, SRPointCloud::Ptr &pc)
void omip::removeDuplicateIndices (std::vector< int > &vec)
static void omip::savePGM (bool *imf, const char *name, int height, int width)
static void omip::savePGM (float *imf, const char *name, int height, int width)
void omip::toc (const char *message, clock_t start)
void omip::UnorganizedPC2DepthMap (const SRPointCloud::Ptr &organized_pc, const int &width, const int &height, cv::Mat &depth_map,::shape_reconstruction::RangeImagePlanar::Ptr &rip, const float &noiseLevel=0.f, const float &minRange=0.5f)
void omip::upsample_cpu (float *depth_dst, bool *mask_dst, bool *valid_dst, float *depth_src, float *result_src, bool *mask_src, bool *valid_src, int height_src, int width_src, int height_dst, int width_dst, int dst_img_ind)

Variables

cv::Mat omip::filled_img_full
ros::Time omip::previous_query_time

Define Documentation

#define FILTER_LEN   11

Definition at line 223 of file SRUtils.cpp.

#define FILTER_RAD   5

Definition at line 222 of file SRUtils.cpp.

#define FILTER_SIZE   121

Definition at line 224 of file SRUtils.cpp.

#define MAX_UCHAR   255

Definition at line 219 of file SRUtils.cpp.

#define PI   3.14159

Definition at line 217 of file SRUtils.cpp.


Typedef Documentation

typedef unsigned char uint8_t

Definition at line 10 of file SRUtils.cpp.



shape_reconstruction
Author(s): Roberto Martín-Martín
autogenerated on Sat Jun 8 2019 18:38:55