#include <ros/ros.h>#include <ros/package.h>#include <unique_id/unique_id.h>#include <ram_msgs/AdditiveManufacturingTrajectory.h>#include <ram_modify_trajectory/GetPosesFromTrajectory.h>#include <ram_modify_trajectory/GetPosesFromLayersList.h>#include <ram_modify_trajectory/GetPosesFromLayer.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, getPosesFromTrajectory) | |
| TEST (TestSuite, getPosesFromLayersList) | |
| TEST (TestSuite, getPosesFromLayer) | |
| TEST (TestSuite, trajectoryWithEmptyLayer) | |
Variables | |
| ros::ServiceClient | get_poses_from_layer_client |
| ros::ServiceClient | get_poses_from_layers_list_client |
| ros::ServiceClient | get_poses_from_trajectory_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 187 of file pose_selector_test.cpp.
| TEST | ( | TestSuite | , |
| testSrvsExistence | |||
| ) |
Definition at line 23 of file pose_selector_test.cpp.
| TEST | ( | TestSuite | , |
| selectPosesInEmptyTrajectory | |||
| ) |
Definition at line 41 of file pose_selector_test.cpp.
| TEST | ( | TestSuite | , |
| getPosesFromTrajectory | |||
| ) |
Definition at line 63 of file pose_selector_test.cpp.
| TEST | ( | TestSuite | , |
| getPosesFromLayersList | |||
| ) |
Definition at line 102 of file pose_selector_test.cpp.
| TEST | ( | TestSuite | , |
| getPosesFromLayer | |||
| ) |
Definition at line 141 of file pose_selector_test.cpp.
| TEST | ( | TestSuite | , |
| trajectoryWithEmptyLayer | |||
| ) |
Definition at line 156 of file pose_selector_test.cpp.
| ros::ServiceClient get_poses_from_layer_client |
Definition at line 21 of file pose_selector_test.cpp.
| ros::ServiceClient get_poses_from_layers_list_client |
Definition at line 20 of file pose_selector_test.cpp.
| ros::ServiceClient get_poses_from_trajectory_client |
Definition at line 19 of file pose_selector_test.cpp.
| std::unique_ptr<ros::NodeHandle> nh |
Definition at line 14 of file pose_selector_test.cpp.
| ros::Publisher test_trajectory_pub |
Definition at line 15 of file pose_selector_test.cpp.
| ram_msgs::AdditiveManufacturingTrajectory trajectory |
Definition at line 16 of file pose_selector_test.cpp.