/* simple UAVCAN network sniffer as an ArduPilot firmware */ #include #include #if HAL_MAX_CAN_PROTOCOL_DRIVERS #include #include #include #include #include #include #include #include #include #include #include #include #include #include #include #include #include #include #include #if CONFIG_HAL_BOARD == HAL_BOARD_LINUX #include #elif CONFIG_HAL_BOARD == HAL_BOARD_SITL #include #elif CONFIG_HAL_BOARD == HAL_BOARD_CHIBIOS #include #endif void setup(); void loop(); const AP_HAL::HAL& hal = AP_HAL::get_HAL(); #define UAVCAN_NODE_POOL_SIZE 8192 #ifdef UAVCAN_NODE_POOL_BLOCK_SIZE #undef UAVCAN_NODE_POOL_BLOCK_SIZE #endif #define UAVCAN_NODE_POOL_BLOCK_SIZE 256 #define debug_uavcan(fmt, args...) do { hal.console->printf(fmt, ##args); } while (0) class UAVCAN_sniffer { public: UAVCAN_sniffer(); ~UAVCAN_sniffer(); void init(void); void loop(void); void print_stats(void); private: uint8_t driver_index = 0; uavcan::Node<0> *_node; // This will be needed to implement if UAVCAN is used with multithreading // Such cases will be firmware update, etc. class RaiiSynchronizer { public: RaiiSynchronizer() { } ~RaiiSynchronizer() { } }; uavcan::HeapBasedPoolAllocator _node_allocator; AP_CANManager can_mgr; }; static struct { const char *msg_name; uint32_t count; } counters[100]; static void count_msg(const char *name) { for (uint16_t i=0; i& msg) { count_msg(msg.getDataTypeFullName()); } MSG_CB(uavcan::protocol::NodeStatus, NodeStatus) MSG_CB(uavcan::equipment::gnss::Fix2, Fix2) MSG_CB(uavcan::equipment::gnss::Auxiliary, Auxiliary) MSG_CB(uavcan::equipment::ahrs::MagneticFieldStrength, MagneticFieldStrength) MSG_CB(uavcan::equipment::ahrs::MagneticFieldStrength2, MagneticFieldStrength2); MSG_CB(uavcan::equipment::air_data::StaticPressure, StaticPressure) MSG_CB(uavcan::equipment::air_data::StaticTemperature, StaticTemperature) MSG_CB(uavcan::equipment::power::BatteryInfo, BatteryInfo); MSG_CB(uavcan::equipment::actuator::ArrayCommand, ArrayCommand) MSG_CB(uavcan::equipment::esc::RawCommand, RawCommand) MSG_CB(uavcan::equipment::indication::LightsCommand, LightsCommand); MSG_CB(com::hex::equipment::flow::Measurement, Measurement); void UAVCAN_sniffer::init(void) { const_cast (hal).can[driver_index] = new HAL_CANIface(driver_index); if (hal.can[driver_index] == nullptr) { AP_HAL::panic("Couldn't allocate CANManager, something is very wrong"); } hal.can[driver_index]->init(1000000, AP_HAL::CANIface::NormalMode); if (!hal.can[driver_index]->is_initialized()) { debug_uavcan("Can not initialised\n"); return; } uavcan::CanIfaceMgr *_uavcan_iface_mgr = new uavcan::CanIfaceMgr; if (_uavcan_iface_mgr == nullptr) { return; } if (!_uavcan_iface_mgr->add_interface(hal.can[driver_index])) { debug_uavcan("Failed to add iface"); return; } _node = new uavcan::Node<0>(*_uavcan_iface_mgr, uavcan::SystemClock::instance(), _node_allocator); if (_node == nullptr) { return; } if (_node->isStarted()) { return; } uavcan::NodeID self_node_id(9); _node->setNodeID(self_node_id); char ndname[20]; snprintf(ndname, sizeof(ndname), "org.ardupilot:%u", driver_index); uavcan::NodeStatusProvider::NodeName name(ndname); _node->setName(name); uavcan::protocol::SoftwareVersion sw_version; // Standard type uavcan.protocol.SoftwareVersion sw_version.major = AP_UAVCAN_SW_VERS_MAJOR; sw_version.minor = AP_UAVCAN_SW_VERS_MINOR; _node->setSoftwareVersion(sw_version); uavcan::protocol::HardwareVersion hw_version; // Standard type uavcan.protocol.HardwareVersion hw_version.major = AP_UAVCAN_HW_VERS_MAJOR; hw_version.minor = AP_UAVCAN_HW_VERS_MINOR; _node->setHardwareVersion(hw_version); int start_res = _node->start(); if (start_res < 0) { debug_uavcan("UAVCAN: node start problem\n\r"); return; } #define START_CB(mtype, cbname) (new uavcan::Subscriber(*_node))->start(cb_ ## cbname) START_CB(uavcan::protocol::NodeStatus, NodeStatus); START_CB(uavcan::equipment::gnss::Fix2, Fix2); START_CB(uavcan::equipment::gnss::Auxiliary, Auxiliary); START_CB(uavcan::equipment::ahrs::MagneticFieldStrength, MagneticFieldStrength); START_CB(uavcan::equipment::ahrs::MagneticFieldStrength2, MagneticFieldStrength2); START_CB(uavcan::equipment::air_data::StaticPressure, StaticPressure); START_CB(uavcan::equipment::air_data::StaticTemperature, StaticTemperature); START_CB(uavcan::equipment::power::BatteryInfo, BatteryInfo); START_CB(uavcan::equipment::actuator::ArrayCommand, ArrayCommand); START_CB(uavcan::equipment::esc::RawCommand, RawCommand); START_CB(uavcan::equipment::indication::LightsCommand, LightsCommand); START_CB(com::hex::equipment::flow::Measurement, Measurement); /* * Informing other nodes that we're ready to work. * Default mode is INITIALIZING. */ _node->setModeOperational(); debug_uavcan("UAVCAN: init done\n\r"); } void UAVCAN_sniffer::loop(void) { if (_node == nullptr) { return; } _node->spin(uavcan::MonotonicDuration::fromMSec(1)); } void UAVCAN_sniffer::print_stats(void) { hal.console->printf("%lu\n", (unsigned long)AP_HAL::micros()); for (uint16_t i=0;i<100;i++) { if (counters[i].msg_name == nullptr) { break; } hal.console->printf("%s: %u\n", counters[i].msg_name, unsigned(counters[i].count)); counters[i].count = 0; } hal.console->printf("\n"); } static UAVCAN_sniffer sniffer; UAVCAN_sniffer::UAVCAN_sniffer() : _node_allocator(UAVCAN_NODE_POOL_SIZE, UAVCAN_NODE_POOL_SIZE) {} UAVCAN_sniffer::~UAVCAN_sniffer() { } void setup(void) { hal.scheduler->delay(2000); hal.console->printf("Starting UAVCAN sniffer\n"); sniffer.init(); } void loop(void) { sniffer.loop(); static uint32_t last_print_ms; uint32_t now = AP_HAL::millis(); if (now - last_print_ms >= 1000) { last_print_ms = now; sniffer.print_stats(); } // auto-reboot for --upload if (hal.console->available() > 50) { hal.console->printf("rebooting\n"); hal.console->discard_input(); hal.scheduler->reboot(false); } hal.console->discard_input(); } AP_HAL_MAIN(); #else #include const AP_HAL::HAL& hal = AP_HAL::get_HAL(); static void loop() { } static void setup() { printf("Board not currently supported\n"); } AP_HAL_MAIN(); #endif