#include <coordConversion.h>
Public Member Functions | |
| bool | convertCoordinates (youbot_overhead_vision::CoordConversion::Request &req, youbot_overhead_vision::CoordConversion::Response &res) |
| coordConversion () | |
Public Attributes | |
| ros::ServiceServer | conversionService |
| ros::NodeHandle | n |
| bool | useSim |
Definition at line 28 of file coordConversion.h.
Constructor
This file contains conversions for various coordinate systems, including the the overhead camera map, the occupancy grid, and the real-world coordinate systems.
Definition at line 12 of file coordConversion.cpp.
| bool coordConversion::convertCoordinates | ( | youbot_overhead_vision::CoordConversion::Request & | req, |
| youbot_overhead_vision::CoordConversion::Response & | res | ||
| ) |
Service handler to convert between pixel and meter coordinates
| req | service request |
| res | service response |
Definition at line 19 of file coordConversion.cpp.
Definition at line 32 of file coordConversion.h.
Definition at line 31 of file coordConversion.h.
Definition at line 34 of file coordConversion.h.