35 #include "novatel_oem7_msgs/RXSTATUS.h" 62 "Software resource limit exceeded",
63 "Model invalid for this receiver",
66 "Remote loading has begun",
77 "Component hardware failure" 85 "Primary antenna not powered",
87 "Primary antenna open circuit",
88 "Primary antenna short circuit",
90 "COM port tx buffer overrun",
95 "Aux transmit overrun",
96 "Antenna gain out of range",
99 "IMU communication failure",
100 "GPS almanac invalid",
101 "Position solution invalid",
103 "Clock steering disabled",
104 "Clock model invalid",
105 "External oscillator locked",
106 "Software resource warning",
108 "Interpret Status/Error Bits as Oem7 format",
109 "Tracking mode: HDR",
110 "Digital filtering enabled",
119 "Jammer detected on RF1",
120 "Jammer detected on RF2",
121 "Jammer detected on RF3",
122 "Position averaging On",
123 "Jammer detected on RF4",
124 "Jammer detected on RF5",
125 "Jammer detected on RF6",
127 "USB1 buffer overrun",
128 "USB2 buffer overrun",
129 "USB3 buffer overrun",
131 "Profile Activation Error",
132 "Throttled Ethernet Reception",
137 "Ethernet not connected",
138 "ICOM1 buffer overrun",
139 "ICOM2 buffer overrun",
140 "ICOM3 buffer overrun",
141 "NCOM1 buffer overrun",
142 "NCOM2 buffer overrun",
143 "NCOM3 buffer overrun",
150 "IMU measurement outlier detected" 156 "SPI Communication Failure",
157 "I2C Communication Failure",
158 "COM4 buffer overrun",
159 "COM5 buffer overrun",
165 "COM1 buffer overrun",
166 "COM2 buffer overrun",
167 "COM3 buffer overrun",
174 "CCOM1 buffer overrun",
175 "CCOM2 buffer overrun",
176 "CCOM3 buffer overrun",
177 "CCOM4 buffer overrun",
178 "CCOM5 buffer overrun",
179 "CCOM6 buffer overrun",
180 "ICOM4 buffer overrun",
181 "ICOM5 buffer overrun",
182 "ICOM6 buffer overrun",
183 "ICOM7 buffer overrun",
184 "Secondary antenna not powered",
185 "Secondary antenna open circuit",
186 "Secondary antenna short circuit",
187 "Reset loop detected",
193 "SCOM buffer overrun",
194 "WCOM1 buffer overrun",
195 "FILE buffer overrun",
222 "Web content is corrupt or does not exist",
223 "RF Calibration Data is present and in error",
224 "RF Calibration data exists and has no errors" 229 "<60% of available satellites are tracked well",
230 "<15% of available satellites are tracked well",
241 "Clock freewheeling due to bad position integrity",
243 "Usable RTK Corrections: < 60%",
244 "Usable RTK Corrections: < 15%",
250 "Poor ALIGN COM link",
253 "No TerraStar Subscription",
267 const str_vector_t& str_map,
268 str_vector_t& str_list,
269 std::vector<uint8_t>& bit_list)
272 bit < (
sizeof(bitmask) * 8);
275 if(bitmask & (1 << bit))
277 bit_list.push_back(bit);
278 if(str_map[bit].
length() > 0)
280 str_list.push_back(str_map[bit]);
297 static const size_t NUM_BITS =
sizeof(uint32_t) * 8;
311 RXSTATUS_pub_.
setup<novatel_oem7_msgs::RXSTATUS>(
"RXSTATUS", nh);
333 RXSTATUS_pub_.
publish(rxstatus);
const int RXSTATUS_OEM7_MSGID
void handleMsg(Oem7RawMessageIf::ConstPtr msg)
const str_vector_t AUX2_STATUS_STRS
Oem7RosPublisher RXSTATUS_pub_
TF2SIMD_FORCE_INLINE tf2Scalar length(const Quaternion &q)
void initialize(ros::NodeHandle &nh)
const str_vector_t AUX3_STATUS_STRS
void publish(boost::shared_ptr< M > &msg)
PLUGINLIB_EXPORT_CLASS(novatel_oem7_driver::Oem7ConfigNodelet, nodelet::Nodelet)
const str_vector_t RECEIVER_STATUS_STRS
void setup(const std::string &name, ros::NodeHandle &nh)
const str_vector_t RECEIVER_ERROR_STRS
const str_vector_t AUX1_STATUS_STRS
void MakeROSMessage(const Oem7RawMessageIf::ConstPtr &msg, boost::shared_ptr< T > &rosmsg)
std::vector< std::string > str_vector_t
const str_vector_t AUX4_STATUS_STRS
const std::vector< int > & getMessageIds()
void get_status_info(uint32_t bitmask, const str_vector_t &str_map, str_vector_t &str_list, std::vector< uint8_t > &bit_list)