Public Member Functions | Protected Member Functions | Protected Attributes | List of all members
pfuclt_omni_dataset::Robot Class Reference

The Robot class - Has the common variables and methods of all robots, and is the base class of any specialized robots who may derive from it. Teammates should be instances of this class. More...

#include <pfuclt_omni_dataset.h>

Public Member Functions

bool hasStarted ()
 hasStarted More...
 
void landmarkDataCallback (const read_omni_dataset::LRMLandmarksData::ConstPtr &)
 landmarkDataCallback - event-driven function which should be called when new landmark data is received More...
 
void odometryCallback (const nav_msgs::Odometry::ConstPtr &)
 odometryCallback - event-driven function which should be called when new odometry data is received More...
 
 Robot (ros::NodeHandle &nh, RobotFactory *parent, ParticleFilter *pf, uint robotNumber)
 Robot - constructor, creates a new Robot instance. More...
 
void targetCallback (const read_omni_dataset::BallData::ConstPtr &)
 targetCallBack - event-driven function which should be called when new target data is received More...
 

Protected Member Functions

void startNow ()
 startNow - starts the robot More...
 

Protected Attributes

Eigen::Isometry2d initPose_
 
RobotFactoryparent_
 
ParticleFilterpf_
 
uint robotNumber_
 
ros::Subscriber sBall_
 
ros::Subscriber sLandmark_
 
ros::Subscriber sOdom_
 
bool started_
 
ros::Time timeStarted_
 

Detailed Description

The Robot class - Has the common variables and methods of all robots, and is the base class of any specialized robots who may derive from it. Teammates should be instances of this class.

Definition at line 86 of file pfuclt_omni_dataset.h.

Constructor & Destructor Documentation

pfuclt_omni_dataset::Robot::Robot ( ros::NodeHandle &  nh,
RobotFactory parent,
ParticleFilter pf,
uint  robotNumber 
)

Robot - constructor, creates a new Robot instance.

Parameters
nh- reference to the node handler object
parent- reference to the robot factory creating this object
initPose- initial (x,y) pose of the robot
pf- reference to the particle filter to be used for this robot
robotNumber- the assigned number in the team

Definition at line 111 of file pfuclt_omni_dataset.cpp.

Member Function Documentation

bool pfuclt_omni_dataset::Robot::hasStarted ( )
inline

hasStarted

Returns

Definition at line 137 of file pfuclt_omni_dataset.h.

void pfuclt_omni_dataset::Robot::landmarkDataCallback ( const read_omni_dataset::LRMLandmarksData::ConstPtr &  landmarkData)

landmarkDataCallback - event-driven function which should be called when new landmark data is received

Definition at line 219 of file pfuclt_omni_dataset.cpp.

void pfuclt_omni_dataset::Robot::odometryCallback ( const nav_msgs::Odometry::ConstPtr &  odometry)

odometryCallback - event-driven function which should be called when new odometry data is received

Definition at line 134 of file pfuclt_omni_dataset.cpp.

void pfuclt_omni_dataset::Robot::startNow ( )
protected

startNow - starts the robot

Definition at line 103 of file pfuclt_omni_dataset.cpp.

void pfuclt_omni_dataset::Robot::targetCallback ( const read_omni_dataset::BallData::ConstPtr &  target)

targetCallBack - event-driven function which should be called when new target data is received

Definition at line 155 of file pfuclt_omni_dataset.cpp.

Member Data Documentation

Eigen::Isometry2d pfuclt_omni_dataset::Robot::initPose_
protected

Definition at line 95 of file pfuclt_omni_dataset.h.

RobotFactory* pfuclt_omni_dataset::Robot::parent_
protected

Definition at line 89 of file pfuclt_omni_dataset.h.

ParticleFilter* pfuclt_omni_dataset::Robot::pf_
protected

Definition at line 90 of file pfuclt_omni_dataset.h.

uint pfuclt_omni_dataset::Robot::robotNumber_
protected

Definition at line 94 of file pfuclt_omni_dataset.h.

ros::Subscriber pfuclt_omni_dataset::Robot::sBall_
protected

Definition at line 93 of file pfuclt_omni_dataset.h.

ros::Subscriber pfuclt_omni_dataset::Robot::sLandmark_
protected

Definition at line 93 of file pfuclt_omni_dataset.h.

ros::Subscriber pfuclt_omni_dataset::Robot::sOdom_
protected

Definition at line 93 of file pfuclt_omni_dataset.h.

bool pfuclt_omni_dataset::Robot::started_
protected

Definition at line 91 of file pfuclt_omni_dataset.h.

ros::Time pfuclt_omni_dataset::Robot::timeStarted_
protected

Definition at line 92 of file pfuclt_omni_dataset.h.


The documentation for this class was generated from the following files:


pfuclt_omni_dataset
Author(s):
autogenerated on Tue Jul 4 2017 19:38:38