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>
|
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...
|
|
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.
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.
bool pfuclt_omni_dataset::Robot::hasStarted |
( |
| ) |
|
|
inline |
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 |
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.
Eigen::Isometry2d pfuclt_omni_dataset::Robot::initPose_ |
|
protected |
uint pfuclt_omni_dataset::Robot::robotNumber_ |
|
protected |
ros::Subscriber pfuclt_omni_dataset::Robot::sBall_ |
|
protected |
ros::Subscriber pfuclt_omni_dataset::Robot::sLandmark_ |
|
protected |
ros::Subscriber pfuclt_omni_dataset::Robot::sOdom_ |
|
protected |
bool pfuclt_omni_dataset::Robot::started_ |
|
protected |
ros::Time pfuclt_omni_dataset::Robot::timeStarted_ |
|
protected |
The documentation for this class was generated from the following files: