Functions | Variables
test_obj_to_pointcloud.cpp File Reference
#include <ros/ros.h>
#include <sensor_msgs/PointCloud2.h>
#include <sensor_msgs/point_cloud2_iterator.h>
#include <string>
#include <gtest/gtest.h>
Include dependency graph for test_obj_to_pointcloud.cpp:

Go to the source code of this file.

Functions

bool isOnBottomSurface (const float x, const float y, const float z)
 
bool isOnCorner (const float x, const float y, const float z)
 
bool isOnSideSurface (const float x, const float y, const float z)
 
int main (int argc, char **argv)
 
 TEST (ObjToPointCloud, PointCloud)
 

Variables

constexpr float TOLERANCE = 1e-6
 

Function Documentation

bool isOnBottomSurface ( const float  x,
const float  y,
const float  z 
)

Definition at line 40 of file test_obj_to_pointcloud.cpp.

bool isOnCorner ( const float  x,
const float  y,
const float  z 
)

Definition at line 52 of file test_obj_to_pointcloud.cpp.

bool isOnSideSurface ( const float  x,
const float  y,
const float  z 
)

Definition at line 46 of file test_obj_to_pointcloud.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 97 of file test_obj_to_pointcloud.cpp.

TEST ( ObjToPointCloud  ,
PointCloud   
)

Definition at line 59 of file test_obj_to_pointcloud.cpp.

Variable Documentation

constexpr float TOLERANCE = 1e-6

Definition at line 38 of file test_obj_to_pointcloud.cpp.



obj_to_pointcloud
Author(s): Atsushi Watanabe
autogenerated on Tue Jul 9 2019 04:59:59