#include <ros/ros.h>#include <ros/package.h>#include <ros/service.h>#include <tf_conversions/tf_eigen.h>#include <eigen_conversions/eigen_msg.h>#include <geometry_msgs/Transform.h>#include "fanuc_post_processor_library/fanuc_post_processor_library.hpp"#include <fanuc_grinding_post_processor/PostProcessorService.h>
Go to the source code of this file.
Functions | |
| int | main (int argc, char **argv) |
| bool | postProcessor (fanuc_grinding_post_processor::PostProcessorService::Request &req, fanuc_grinding_post_processor::PostProcessorService::Response &res) |
Variables | |
| boost::shared_ptr< ros::NodeHandle > | node |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 129 of file post_processor.cpp.
| bool postProcessor | ( | fanuc_grinding_post_processor::PostProcessorService::Request & | req, |
| fanuc_grinding_post_processor::PostProcessorService::Response & | res | ||
| ) |
This is the service function that is called whenever a request is received
| req[int] | |
| res[out] |
Definition at line 26 of file post_processor.cpp.
Definition at line 18 of file post_processor.cpp.