Loading [MathJax]/extensions/tex2jax.js
Smart Minotaur
Alle Klassen Dateien Funktionen Variablen Seiten
minotaur::MinotaurCommunicator Klassenreferenz

Processes all ROS navigation stack communcication. Mehr ...

#include <MinotaurCommunicator.hpp>

Klassendiagramm für minotaur::MinotaurCommunicator:
minotaur::IMinotaurListener

Öffentliche Methoden

void init (ros::NodeHandle &p_handle, RobotOdometry *p_robotOdom, BlockingQueue< SensorMeasurement > *p_queue)
void setTargetPosition (const RobotPosition &p_position)
 Sets the target position of the robot, to which it should move.
void onReceiveOdometry (const nav_msgs::Odometry &p_odometry)
 This method is called when an incoming Odometry message is received.
void onReceiveUltrasonicData (const minotaur_common::UltrasonicData &p_sensorData)
 This method is called when an incoming UltrasonicData message is received.

Ausführliche Beschreibung

Processes all ROS navigation stack communcication.

This class provides functionality to set the target position of the robot in the ROS navigation stack.

Dokumentation der Elementfunktionen

void minotaur::MinotaurCommunicator::onReceiveOdometry ( const nav_msgs::Odometry &  p_odometry)
virtual

This method is called when an incoming Odometry message is received.

Parameter
p_odometrythe incoming Odometry message

Implementiert minotaur::IMinotaurListener.

void minotaur::MinotaurCommunicator::onReceiveUltrasonicData ( const minotaur_common::UltrasonicData &  p_sensorData)
virtual

This method is called when an incoming UltrasonicData message is received.

Parameter
p_sensorDatathe incoming UltrasonicData message

Implementiert minotaur::IMinotaurListener.

void minotaur::MinotaurCommunicator::setTargetPosition ( const RobotPosition p_position)

Sets the target position of the robot, to which it should move.

The movement to the position is handled by the ROS navigation stack.

Parameter
p_positiontarget position of the robot

Die Dokumentation für diese Klasse wurde erzeugt aufgrund der Dateien: