Go to the documentation of this file.
6 #include <gtest/gtest.h>
10 #include "std_srvs/Trigger.h"
15 #include "outsight_alb_driver/AlbConfig.h"
16 #include "outsight_alb_driver/AlbFile.h"
77 outsight_alb_driver::AlbConfig srv;
96 outsight_alb_driver::AlbFile srv;
107 int main(
int argc,
char **argv)
109 testing::InitGoogleTest(&argc, argv);
110 ros::init(argc, argv,
"alb_services_test");
118 auto res = RUN_ALL_TESTS();
const std::string response
constexpr const char * k_alb_processing_put_config
std_srvs::Trigger::Request request
constexpr const char * k_alb_storage_download
ROSCPP_DECL bool exists(const std::string &service_name, bool print_failure_reason)
bool call(const std::string &service_name, MReq &req, MRes &res)
ROSCPP_DECL void init(const M_string &remappings, const std::string &name, uint32_t options=0)
constexpr const char * k_invalid_service
constexpr const char * k_alb_processing_restart
ROSCPP_DECL void shutdown()
TEST_F(AlbServicesTest, invalidService)
Test to check that invalid service call should fail.
std::unique_ptr< AlbRequester > requester
constexpr const char * k_alb_storage_list
void testServiceCall(const std::string &service_name)
Function to check if a service can be called.
constexpr const char * k_alb_storage_upload
constexpr const char * k_alb_processing_get_config
std_srvs::Trigger::Response response
ROSCPP_DECL bool waitForService(const std::string &service_name, int32_t timeout)
constexpr const char * k_alb_processing_stop
Class to test the ALB services.
int main(int argc, char **argv)
geometry_msgs::TransformStamped t