#include <ros/ros.h>#include <ros/package.h>#include <ram_msgs/AdditiveManufacturingTrajectory.h>#include <ram_trajectory_utils/UnmodifiedTrajectory.h>#include <gtest/gtest.h>
Go to the source code of this file.
Functions | |
| int | main (int argc, char **argv) |
| TEST (TestSuite, testSrvExistence) | |
| TEST (TestSuite, testVerifyTrajectoryNotInBuffer) | |
| TEST (TestSuite, testVerifyTrajectoryInBuffer) | |
Variables | |
| std::unique_ptr< ros::NodeHandle > | nh |
| ros::Publisher | test_trajectory_pub |
| ros::ServiceClient | unmodified_trajectory_client |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 48 of file services_clients.cpp.
| TEST | ( | TestSuite | , |
| testSrvExistence | |||
| ) |
Definition at line 13 of file services_clients.cpp.
| TEST | ( | TestSuite | , |
| testVerifyTrajectoryNotInBuffer | |||
| ) |
Definition at line 21 of file services_clients.cpp.
| TEST | ( | TestSuite | , |
| testVerifyTrajectoryInBuffer | |||
| ) |
Definition at line 33 of file services_clients.cpp.
| std::unique_ptr<ros::NodeHandle> nh |
Definition at line 9 of file services_clients.cpp.
| ros::Publisher test_trajectory_pub |
Definition at line 11 of file services_clients.cpp.
| ros::ServiceClient unmodified_trajectory_client |
Definition at line 10 of file services_clients.cpp.