#include <AugmentedAcoustics.hpp>
Public Member Functions | |
AugmentedAcoustics () | |
void | onInit () |
void | start () |
void | step () |
Private Member Functions | |
void | handleEstimates (const auv_msgs::NavSts::ConstPtr &estimate) |
void | handleManual (const sensor_msgs::Joy::ConstPtr &joy) |
void | handleTarget (const auv_msgs::NavSts::ConstPtr &target) |
Private Attributes | |
ros::Subscriber | manualIn |
ros::Subscriber | stateHat |
ros::Subscriber | targetRef |
ros::Publisher | tauOut |
The class contains the implementation of the augmented acoustic reality controller developed by A. Vasilijevic.
Definition at line 51 of file AugmentedAcoustics.hpp.
Main constructor
Definition at line 43 of file AugmentedAcoustics.cpp.
void AugmentedAcoustics::handleEstimates | ( | const auv_msgs::NavSts::ConstPtr & | estimate | ) | [private] |
Handle incoming estimates.
Definition at line 74 of file AugmentedAcoustics.cpp.
void AugmentedAcoustics::handleManual | ( | const sensor_msgs::Joy::ConstPtr & | joy | ) | [private] |
Handle incoming estimates message.
Definition at line 69 of file AugmentedAcoustics.cpp.
void AugmentedAcoustics::handleTarget | ( | const auv_msgs::NavSts::ConstPtr & | target | ) | [private] |
Handle the target that is tracked.
Definition at line 64 of file AugmentedAcoustics.cpp.
void AugmentedAcoustics::onInit | ( | ) |
Initialize and setup controller.
Definition at line 48 of file AugmentedAcoustics.cpp.
void AugmentedAcoustics::start | ( | ) |
Start the controller loop.
Definition at line 85 of file AugmentedAcoustics.cpp.
void AugmentedAcoustics::step | ( | ) |
Performs one iteration.
Definition at line 79 of file AugmentedAcoustics.cpp.
Definition at line 92 of file AugmentedAcoustics.hpp.
Definition at line 92 of file AugmentedAcoustics.hpp.
The subscribed topics.
Definition at line 92 of file AugmentedAcoustics.hpp.
The publisher of the TAU message.
Definition at line 88 of file AugmentedAcoustics.hpp.