Functions | Variables
test_obj_to_pointcloud.cpp File Reference
#include <cmath>
#include <string>
#include <ros/ros.h>
#include <sensor_msgs/PointCloud2.h>
#include <sensor_msgs/point_cloud2_iterator.h>
#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 42 of file test_obj_to_pointcloud.cpp.

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

Definition at line 54 of file test_obj_to_pointcloud.cpp.

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

Definition at line 48 of file test_obj_to_pointcloud.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 99 of file test_obj_to_pointcloud.cpp.

TEST ( ObjToPointCloud  ,
PointCloud   
)

Definition at line 61 of file test_obj_to_pointcloud.cpp.

Variable Documentation

constexpr float TOLERANCE = 1e-6

Definition at line 40 of file test_obj_to_pointcloud.cpp.



obj_to_pointcloud
Author(s): Atsushi Watanabe
autogenerated on Wed May 12 2021 02:20:34