27 #include <ISM/tools/PoseInterpolator.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\"");
54 if (!nh.
getParam(
"step_number", step_number))
56 ROS_INFO(
"Missing parameter: \"step_number\"");
67 int main (
int argc,
char **argv)
70 ros::init(argc, argv,
"pose_interpolator");
72 ISM::PoseInterpolator pose_interpolator;
74 std::string target_file;
75 std::string source_file;
82 pose_interpolator.interpolate(source_file, target_file, step_number);
83 ROS_INFO(
"INTERPOLATION COMPLETED!");
87 ROS_INFO(
"CHECK step_number! It should have a value of 1 or greater.");
92 ROS_INFO(
"INTERPOLATION ABORTED! Check launch-file for missing parameter.");
bool getNodeParameters(ros::NodeHandle nh, std::string &source_file, std::string &target_file, int &step_number)
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)