Typedefs | Functions | Variables
services_clients.cpp File Reference
#include <actionlib/client/simple_action_client.h>
#include <eigen_conversions/eigen_msg.h>
#include <ram_msgs/AdditiveManufacturingTrajectory.h>
#include <ram_path_planning/contours.hpp>
#include <ram_path_planning/donghong_ding.hpp>
#include <ram_path_planning/ContoursAction.h>
#include <ram_path_planning/DonghongDingAction.h>
#include <ros/package.h>
#include <ros/ros.h>
#include <gtest/gtest.h>
Include dependency graph for services_clients.cpp:

Go to the source code of this file.

Typedefs

typedef actionlib::SimpleActionClient< ram_path_planning::ContoursAction > ContoursActionClient
 
typedef actionlib::SimpleActionClient< ram_path_planning::DonghongDingAction > DonghongDingActionClient
 

Functions

int main (int argc, char **argv)
 
 TEST (TestSuite, testSrvExistence)
 
 TEST (TestSuite, testPolygonWithinternalContoursDongHongDing)
 
 TEST (TestSuite, testIntersectedPolygonsDongHongDing)
 
 TEST (TestSuite, testConvexPolygonDongHongDing)
 
 TEST (TestSuite, testConcavePolygonBigDongHongDing)
 
 TEST (TestSuite, testConcavePolygonSmallDongHongDing)
 
 TEST (TestSuite, testStarDongHongDing)
 
 TEST (TestSuite, testSTLFileTwistedPyramidDongHongDing)
 MESHES. More...
 
 TEST (TestSuite, testPLYFileTwistedPyramidDongHongDing)
 
 TEST (TestSuite, testOBJFileTwistedPyramidDongHongDing)
 
 TEST (TestSuite, testPLYFileTwoTwistedPyramidsDongHongDing)
 
 TEST (TestSuite, testConeTruncatedDongHongDing)
 
 TEST (TestSuite, testDomeDongHongDing)
 
 TEST (TestSuite, testInversedPyramidDongHongDing)
 
 TEST (TestSuite, testSTLCubeNonZSlicingDongHongDing)
 
 TEST (TestSuite, testPolygonWithinternalContours)
 
 TEST (TestSuite, testIntersectedPolygonsContours)
 
 TEST (TestSuite, testConvexPolygonContours)
 
 TEST (TestSuite, testStarContours)
 
 TEST (TestSuite, testSTLFileTwistedPyramidContours)
 MESHES. More...
 
 TEST (TestSuite, testPLYFileTwoTwistedPyramidsContours)
 

Variables

std::unique_ptr< ContoursActionClientcontours_ac
 
std::unique_ptr< DonghongDingActionClientdonghong_ding_ac
 
std::unique_ptr< ros::NodeHandlenh
 
bool use_gui
 

Typedef Documentation

typedef actionlib::SimpleActionClient<ram_path_planning::ContoursAction> ContoursActionClient

Definition at line 17 of file services_clients.cpp.

typedef actionlib::SimpleActionClient<ram_path_planning::DonghongDingAction> DonghongDingActionClient

Definition at line 16 of file services_clients.cpp.

Function Documentation

int main ( int  argc,
char **  argv 
)

Definition at line 400 of file services_clients.cpp.

TEST ( TestSuite  ,
testSrvExistence   
)

Definition at line 24 of file services_clients.cpp.

TEST ( TestSuite  ,
testPolygonWithinternalContoursDongHongDing   
)

Donghong Ding Algorithm YAML

Definition at line 40 of file services_clients.cpp.

TEST ( TestSuite  ,
testIntersectedPolygonsDongHongDing   
)

Definition at line 60 of file services_clients.cpp.

TEST ( TestSuite  ,
testConvexPolygonDongHongDing   
)

Definition at line 78 of file services_clients.cpp.

TEST ( TestSuite  ,
testConcavePolygonBigDongHongDing   
)

Definition at line 96 of file services_clients.cpp.

TEST ( TestSuite  ,
testConcavePolygonSmallDongHongDing   
)

Definition at line 114 of file services_clients.cpp.

TEST ( TestSuite  ,
testStarDongHongDing   
)

Definition at line 132 of file services_clients.cpp.

TEST ( TestSuite  ,
testSTLFileTwistedPyramidDongHongDing   
)

MESHES.

Definition at line 152 of file services_clients.cpp.

TEST ( TestSuite  ,
testPLYFileTwistedPyramidDongHongDing   
)

Definition at line 169 of file services_clients.cpp.

TEST ( TestSuite  ,
testOBJFileTwistedPyramidDongHongDing   
)

Definition at line 186 of file services_clients.cpp.

TEST ( TestSuite  ,
testPLYFileTwoTwistedPyramidsDongHongDing   
)

Definition at line 203 of file services_clients.cpp.

TEST ( TestSuite  ,
testConeTruncatedDongHongDing   
)

Definition at line 220 of file services_clients.cpp.

TEST ( TestSuite  ,
testDomeDongHongDing   
)

Definition at line 237 of file services_clients.cpp.

TEST ( TestSuite  ,
testInversedPyramidDongHongDing   
)

Definition at line 254 of file services_clients.cpp.

TEST ( TestSuite  ,
testSTLCubeNonZSlicingDongHongDing   
)

Definition at line 271 of file services_clients.cpp.

TEST ( TestSuite  ,
testPolygonWithinternalContours   
)

Contours Algorithm YAML

Definition at line 294 of file services_clients.cpp.

TEST ( TestSuite  ,
testIntersectedPolygonsContours   
)

Definition at line 312 of file services_clients.cpp.

TEST ( TestSuite  ,
testConvexPolygonContours   
)

Definition at line 329 of file services_clients.cpp.

TEST ( TestSuite  ,
testStarContours   
)

Definition at line 346 of file services_clients.cpp.

TEST ( TestSuite  ,
testSTLFileTwistedPyramidContours   
)

MESHES.

Definition at line 365 of file services_clients.cpp.

TEST ( TestSuite  ,
testPLYFileTwoTwistedPyramidsContours   
)

Definition at line 381 of file services_clients.cpp.

Variable Documentation

std::unique_ptr<ContoursActionClient> contours_ac

Definition at line 20 of file services_clients.cpp.

std::unique_ptr<DonghongDingActionClient> donghong_ding_ac

Definition at line 19 of file services_clients.cpp.

std::unique_ptr<ros::NodeHandle> nh

Definition at line 13 of file services_clients.cpp.

bool use_gui

Definition at line 22 of file services_clients.cpp.



ram_path_planning
Author(s): Andres Campos - Institut Maupertuis
autogenerated on Mon Jun 10 2019 14:50:03