AR-tagged furniture tracking from overhead cameras. More...
#include <ros/ros.h>
#include <ar_track_alvar_msgs/AlvarMarkers.h>
#include <geometry_msgs/Polygon.h>
#include <geometry_msgs/Pose2D.h>
#include <rail_ceiling/GetAllObstacles.h>
#include <rail_ceiling/Obstacles.h>
#include <ros/package.h>
#include <tf/transform_listener.h>
#include <yaml-cpp/yaml.h>
Go to the source code of this file.
Classes | |
struct | _Furniture |
struct | _FurnitureTransforms |
struct | _Marker |
class | FurnitureTracker |
Defines | |
#define | ANGULAR_THRESHOLD .087 |
#define | POSITION_THRESHOLD .03 |
Typedefs | |
typedef struct _Furniture | Furniture |
typedef struct _FurnitureTransforms | FurnitureTransforms |
typedef struct _Marker | Marker |
Functions | |
int | main (int argc, char **argv) |
AR-tagged furniture tracking from overhead cameras.
rail_lab_location_server creates an action server with pre-defined goal locations for CARL navigation.
Definition in file furniture_tracker.h.
#define ANGULAR_THRESHOLD .087 |
Definition at line 25 of file furniture_tracker.h.
#define POSITION_THRESHOLD .03 |
Definition at line 24 of file furniture_tracker.h.
typedef struct _Furniture Furniture |
typedef struct _FurnitureTransforms FurnitureTransforms |
int main | ( | int | argc, |
char ** | argv | ||
) |
Creates and runs the furniture_tracker node.
argc | argument count that is passed to ros::init |
argv | arguments that are passed to ros::init |
Creates and runs the calibration node.
argc | argument count that is passed to ros::init |
argv | arguments that are passed to ros::init |
Definition at line 254 of file calibration.cpp.