27 #include <ISM/tools/MarkerRotator.hpp> 34 if (!nh.
getParam(
"source", source_file) || source_file.empty())
36 ROS_INFO(
"Missing parameter: \"source\"");
44 if (!nh.
getParam(
"target", target_file) || target_file.empty())
46 ROS_INFO(
"Missing parameter: \"target\"");
57 int main (
int argc,
char **argv)
62 ISM::MarkerRotator marker_rotator;
64 std::string target_file;
65 std::string source_file;
69 marker_rotator.rotateMarker(source_file, target_file);
75 ROS_INFO(
"ROTATION ABORTED! Check launch-file for missing parameter.");
bool getNodeParameters(ros::NodeHandle nh, std::string &source_file, std::string &target_file)
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
#define ROS_INFO_STREAM(args)
bool getParam(const std::string &key, std::string &s) const
int main(int argc, char **argv)