Implements functions for firmware version 6.
More...
#include <node.h>
Implements functions for firmware version 6.
Definition at line 676 of file node.h.
UbloxFirmware6::UbloxFirmware6 |
( |
| ) |
|
void UbloxFirmware6::callbackNavPosLlh |
( |
const ublox_msgs::NavPOSLLH & |
m | ) |
|
|
private |
Publish the fix and call the fix diagnostic updater.
Also updates the last known position and publishes the NavPosLLH message if publishing is enabled.
- Parameters
-
Definition at line 728 of file node.cpp.
void UbloxFirmware6::callbackNavSol |
( |
const ublox_msgs::NavSOL & |
m | ) |
|
|
private |
Update the number of SVs used for the fix.
Publish the message if publishing is enabled.
- Parameters
-
Definition at line 805 of file node.cpp.
void UbloxFirmware6::callbackNavVelNed |
( |
const ublox_msgs::NavVELNED & |
m | ) |
|
|
private |
Update the last known velocity.
Publish the message if publishing is enabled.
- Parameters
-
Definition at line 771 of file node.cpp.
bool UbloxFirmware6::configureUblox |
( |
| ) |
|
|
virtual |
void UbloxFirmware6::getRosParams |
( |
| ) |
|
|
virtual |
void UbloxFirmware6::subscribe |
( |
| ) |
|
|
virtual |
ublox_msgs::CfgNMEA6 ublox_node::UbloxFirmware6::cfg_nmea_ |
|
private |
Used to configure NMEA (if set_nmea_) filled with ROS parameters.
Definition at line 741 of file node.h.
sensor_msgs::NavSatFix ublox_node::UbloxFirmware6::fix_ |
|
private |
The last NavSatFix based on last_nav_pos_.
Definition at line 736 of file node.h.
ublox_msgs::NavPOSLLH ublox_node::UbloxFirmware6::last_nav_pos_ |
|
private |
The last received navigation position.
Definition at line 730 of file node.h.
ublox_msgs::NavSOL ublox_node::UbloxFirmware6::last_nav_sol_ |
|
private |
The last received num SVs used.
Definition at line 734 of file node.h.
ublox_msgs::NavVELNED ublox_node::UbloxFirmware6::last_nav_vel_ |
|
private |
The last received navigation velocity.
Definition at line 732 of file node.h.
bool ublox_node::UbloxFirmware6::set_nmea_ |
|
private |
Whether or not to configure the NMEA settings.
Definition at line 743 of file node.h.
geometry_msgs::TwistWithCovarianceStamped ublox_node::UbloxFirmware6::velocity_ |
|
private |
The last Twist based on last_nav_vel_.
Definition at line 738 of file node.h.
The documentation for this class was generated from the following files: