#include <SensorHandlers.hpp>
Public Types | |
enum | { u = 0, v, w } |
Public Member Functions | |
const double * | body_speeds () const |
void | configure (ros::NodeHandle &nh) |
void | current_r (double yaw_rate) |
DvlHandler () | |
Private Member Functions | |
void | onBottomLock (const std_msgs::Bool::ConstPtr &data) |
void | onDvl (const geometry_msgs::TwistStamped::ConstPtr &data) |
Private Attributes | |
bool | bottom_lock |
tf2_ros::Buffer | buffer |
ros::Subscriber | dvl_bottom |
tf2_ros::TransformListener | listener |
ros::Subscriber | nu_dvl |
double | r |
double | uvw [3] |
Definition at line 132 of file SensorHandlers.hpp.
anonymous enum |
Definition at line 135 of file SensorHandlers.hpp.
labust::navigation::DvlHandler::DvlHandler | ( | ) | [inline] |
Definition at line 137 of file SensorHandlers.hpp.
const double* labust::navigation::DvlHandler::body_speeds | ( | ) | const [inline] |
Definition at line 141 of file SensorHandlers.hpp.
void DvlHandler::configure | ( | ros::NodeHandle & | nh | ) |
Definition at line 145 of file SensorHandlers.cpp.
void labust::navigation::DvlHandler::current_r | ( | double | yaw_rate | ) | [inline] |
Definition at line 143 of file SensorHandlers.hpp.
void DvlHandler::onBottomLock | ( | const std_msgs::Bool::ConstPtr & | data | ) | [private] |
Definition at line 158 of file SensorHandlers.cpp.
void DvlHandler::onDvl | ( | const geometry_msgs::TwistStamped::ConstPtr & | data | ) | [private] |
Definition at line 163 of file SensorHandlers.cpp.
bool labust::navigation::DvlHandler::bottom_lock [private] |
Definition at line 149 of file SensorHandlers.hpp.
Definition at line 151 of file SensorHandlers.hpp.
Definition at line 150 of file SensorHandlers.hpp.
Definition at line 152 of file SensorHandlers.hpp.
Definition at line 150 of file SensorHandlers.hpp.
double labust::navigation::DvlHandler::r [private] |
Definition at line 148 of file SensorHandlers.hpp.
double labust::navigation::DvlHandler::uvw[3] [private] |
Definition at line 148 of file SensorHandlers.hpp.