#include <ros/ros.h>
#include <ros/package.h>
#include <unique_id/unique_id.h>
#include <ram_msgs/AdditiveManufacturingTrajectory.h>
#include <ram_utils/GetTrajectorySize.h>
#include <ram_utils/GetNumberOfLayersLevels.h>
#include <ram_utils/GetLayerSize.h>
#include <gtest/gtest.h>
Go to the source code of this file.
Functions | |
int | main (int argc, char **argv) |
TEST (TestSuite, testSrvsExistence) | |
TEST (TestSuite, selectPosesInEmptyTrajectory) | |
TEST (TestSuite, getTrajectorySize) | |
TEST (TestSuite, numberOfLayersLevels) | |
TEST (TestSuite, layerSize) | |
Variables | |
ros::ServiceClient | get_layer_size_client |
ros::ServiceClient | get_number_of_layers_levels_client |
ros::ServiceClient | get_trajectory_size_client |
std::unique_ptr< ros::NodeHandle > | nh |
ros::Publisher | test_trajectory_pub |
ram_msgs::AdditiveManufacturingTrajectory | trajectory |
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 108 of file trajectory_info_test.cpp.
TEST | ( | TestSuite | , |
testSrvsExistence | |||
) |
Definition at line 23 of file trajectory_info_test.cpp.
TEST | ( | TestSuite | , |
selectPosesInEmptyTrajectory | |||
) |
Definition at line 39 of file trajectory_info_test.cpp.
TEST | ( | TestSuite | , |
getTrajectorySize | |||
) |
Definition at line 62 of file trajectory_info_test.cpp.
TEST | ( | TestSuite | , |
numberOfLayersLevels | |||
) |
Definition at line 87 of file trajectory_info_test.cpp.
TEST | ( | TestSuite | , |
layerSize | |||
) |
Definition at line 97 of file trajectory_info_test.cpp.
ros::ServiceClient get_layer_size_client |
Definition at line 21 of file trajectory_info_test.cpp.
ros::ServiceClient get_number_of_layers_levels_client |
Definition at line 20 of file trajectory_info_test.cpp.
ros::ServiceClient get_trajectory_size_client |
Definition at line 19 of file trajectory_info_test.cpp.
std::unique_ptr<ros::NodeHandle> nh |
Definition at line 14 of file trajectory_info_test.cpp.
ros::Publisher test_trajectory_pub |
Definition at line 15 of file trajectory_info_test.cpp.
ram_msgs::AdditiveManufacturingTrajectory trajectory |
Definition at line 16 of file trajectory_info_test.cpp.