Resurgence (PY2022)
Codebase for the Husky Robotics 2021-2022 rover Resurgence
Loading...
Searching...
No Matches
Class Hierarchy

Go to the graphical class hierarchy

This inheritance list is sorted roughly, but not completely, alphabetically:
[detail level 1234]
 Cnet::ardupilot::ArduPilotProtocol
 Cautonomous::AutonomousTask
 Crobot::base_motorAn abstract motor class
 Crobot::can_motor
 Crobot::sim_motor
 Ccam::CameraRepresents a camera on the rover, from which a video feed can be retrieved
 Ccam::CameraConfigA struct that represents the information outlined in Camera Configuration
 Ccam::CameraParamsRepresents a set of intrinsic camera parameters
 Ccommands::command_t
 Ccommands::CommandBase
 Ccommands::DriveToWaypointCommandProvides robot drive velocity commands to navigate the robot to a given waypoint given the velocity parameters to drive the robot at, the proportional factor to steer the robot with and the 2D Cartesian position of the target in the world reference frame
 CDataPoint< T >Represents data measured using a sensor at a given time
 Crobot::types::DataPoint< T >Represents data measured using a sensor at a given time
 CAR::Detector
 CDiffDriveKinematicsRepresents the kinematics of a differential drive
 Ckinematics::DiffDriveKinematicsRepresents the kinematics of a differential drive
 Ckinematics::DiffWristKinematicsRepresents the kinematics of a differential wrist
 Ccontrol::drive_commands_tThe power commands to all four drive motors
 Ch264encoder::Encoder
 Ch264encoder::EncoderImpl
 Crobot::encparams_t
 Cnavtypes::eulerangles_t
 Cstd::exception [external]
 Ccam::invalid_camera_configException for errors in the camera configuration
 Cstd::runtime_error [external]
 Crobot::types::bad_datapoint_access
 Ckinematics::ForwardArmKinematics< D, N >A class that calculates the forward kinematics of an arm
 Ckinematics::ArmKinematics< 2, N >
 Ckinematics::ArmKinematics< D, N >A class that combines the forward and inverse kinematics of an arm
 Ckinematics::ForwardArmKinematics< 2, N >
 Ckinematics::PlanarArmFK< N >Kinematics object for a sequence of arm segments in a 2d plane
 Ckinematics::gearpos_tRepresents the positions (or power) of the two motor-driven gears in the differential wrist
 Cnavtypes::gpscoords_tRepresents a GPS coordinate in degrees
 CGPSDatumA GPS datum that specifies the reference ellipsoid for use in GPS calculations
 CGPSToMetersConverterA class used to convert gps coordinates to coordinates on a flat xy-plane, and vice versa
 Cvideo::H264EncoderThis class encodes OpenCV frames into encoded H264 data that can be sent to an H264 decoder, like JMuxer
 Cstd::hash< std::pair< T1, T2 > >
 Ckinematics::InverseArmKinematics< D, N >A class that calculates the inverse kinematics of an arm
 Ckinematics::ArmKinematics< 2, N >
 Ckinematics::ArmKinematics< D, N >A class that combines the forward and inverse kinematics of an arm
 Ckinematics::InverseArmKinematics< 2, N >
 Ckinematics::FabrikSolver2D< N >Implementation of the FABRIK algorithm, in the special case of 2 dimensions
 Ccontrol::JacobianPosController< outputDim, inputDim >This class controls the position of a multidimensional mechanism with a trapezoidal velocity profile using the jacobian of the kinematics
 CJacobianVelController< outputDim, inputDim >This class controls the velocity of a multidimensional mechanism by commanding its position using the jacobian of the kinematics
 Ckinematics::jointpos_tRepresents the position (or power) of the differential wrist joint
 Cfilters::KalmanFilterBase< stateDim, inputDim >Base class for Kalman Filters
 Cfilters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim >Implements a discrete-time EKF
 Cfilters::KalmanFilter< stateDim, inputDim, outputDim >Implements a Kalman Filter
 Cfilters::MultiSensorEKF< stateDim, inputDim, processNoiseDim, numOutputs >
 Cutil::latchImplementation of a countdown latch for threading synchronization
 CLimitSwitchDataA class that represents limit switches from a specific motor
 Crobot::types::LimitSwitchDataA class that represents limit switches from a specific motor
 CAR::MarkerPatternA class to represent the pattern that may appear on a physical AR tag, NOT a physical instance of a tag itself; each individual instance of the pattern as it appears in the world is represented by an instance of the Tag class, and there may be multiple Tags corresponding to the same MarkerPattern
 CAR::MarkerSetRepresents a "set" of markers used for a competition, containing the markers that should be recognized for that competition and also some other information like the physical (real-world) size of the tags
 CMat
 Cfilters::statespace::NoiseCovMat< stateDim, size, paramSize >Represents a square noise covariance matrix
 Cutil::impl::Notifiable
 Cutil::AsyncTask< std::chrono::steady_clock >
 Cutil::PeriodicTask< Clock >Implements a task that executes a function periodically
 Cnet::mc::tasks::ArmIKTaskThis task sets the arm joint positions to track the current IK command
 Cnet::mc::tasks::PowerRepeatTaskThis task is responsible for periodically resending setMotorPower commands to the motors
 Cnet::mc::tasks::TelemReportTaskThis task periodically sends robot telemetry data to Mission Control
 Cutil::PeriodicScheduler< std::chrono::steady_clock >
 Cutil::AsyncTask< Clock >An abstract class that can be overridden to run long-running tasks and encapsulate task-related data
 Cnet::mc::tasks::CameraStreamTaskThis task is responsible for sending the camera streams to Mission Control over websocket
 Cutil::PeriodicScheduler< Clock >Uses a single thread to periodically invoke callbacks at a given frequency
 Cutil::PeriodicTask< Clock >Implements a task that executes a function periodically
 Cutil::Watchdog< Clock >Implements a thread-safe watchdog
 Cfilters::OutputRepresent an output for a system
 Ccan::packettype_tThe types of CAN packets that we recognize
 Crobot::pidcoef_tA struct containing a set of PID coefficients
 Ccontrol::PIDController< dim >A PID controller for multiple independent dimensions
 Ccontrol::PIDGainsA set of PID gains
 Ccontrol::PlanarArmController< N >Controller to move planar arm to a target end effector position
 Crobot::potparams_tRepresents parameters defining a potentiometer scale
 Cutil::RAIIHelperA helper class for executing a function when leaving a scope, in RAII-style
 Cfilters::RollingAvgFilter< T >Implements a rolling average filter of the specified type
 CRollingAvgFilter< T >Implements a rolling average filter of the specified type
 Cutil::ScopedTimerA utility class that helps with timing
 Ccan::motor::sensor_tThe supported motor position sensors
 Cnet::mc::SingleClientWSServerA WebSocket server class that only accepts a single client at a time to each endpoint served by this server
 Cnet::websocket::SingleClientWSServerA WebSocket server class that only accepts a single client at a time to each endpoint served by this server
 Ccontrol::SingleDimTrapezoidalVelocityProfileTrapezoidal velocity profile in a single dimension
 Ccontrol::swerve_rots_tRepresents the rotations of all four steer motors in in millidegrees
 Ccontrol::SwerveControllerController to handle the wheel rotations for driving with swerve modes
 Ckinematics::SwerveDriveKinematicsCalculates forward and inverse drivebase kinematics for a 4-wheel swerve drivebase with specifiable width and length
 Ckinematics::swervewheelvel_tRepresents robot wheel velocities in robot reference frame, in polar form (wheel speed and angle)
 CAR::TagClass representing an AR tag detected in an image
 Ccontrol::TrapezoidalVelocityProfile< dim >Trapezoidal velocity profile in multiple dimensions
 Cnet::mc::WebSocketProtocolDefines a protocol which will be served at an endpoint of a server
 Cnet::mc::MissionControlProtocol
 Cnet::websocket::WebSocketProtocolDefines a protocol which will be served at an endpoint of a server
 Cnet::mc::MissionControlProtocol
 Ckinematics::wheelvel_t
 Ch264encoder::x264_nal_t_simple