Public Member Functions | Public Attributes | List of all members
app1::App1 Class Reference

#include <app1.h>

Inheritance diagram for app1::App1:
Inheritance graph
[legend]

Public Member Functions

 App1 ()
 
void baseCallback (const nav_msgs::Odometry &lmsg)
 
XY direction ()
 
float force_mag (float dist)
 
XY force_sum (micros_swarm::NeighborBase n, XY &s)
 
virtual void init ()
 
void motion ()
 
void publish_cmd (const ros::TimerEvent &)
 
virtual void start ()
 
virtual void stop ()
 
 ~App1 ()
 
- Public Member Functions inherited from micros_swarm::Application
 Application ()
 
const Baseget_base ()
 
float get_dis ()
 
const int get_id ()
 
void set_base (const Base &robot_base)
 
void set_dis (float neighbor_distance)
 
virtual ~Application ()
 

Public Attributes

int delta
 
int epsilon
 
ros::Publisher pub
 
ros::Subscriber sub
 
ros::Timer timer
 

Detailed Description

Definition at line 36 of file app1.h.

Constructor & Destructor Documentation

app1::App1::App1 ( )

Definition at line 36 of file app1.cpp.

app1::App1::~App1 ( )

Definition at line 38 of file app1.cpp.

Member Function Documentation

void app1::App1::baseCallback ( const nav_msgs::Odometry &  lmsg)

Definition at line 108 of file app1.cpp.

XY app1::App1::direction ( )

Definition at line 78 of file app1.cpp.

float app1::App1::force_mag ( float  dist)

Definition at line 49 of file app1.cpp.

XY app1::App1::force_sum ( micros_swarm::NeighborBase  n,
XY s 
)

Definition at line 54 of file app1.cpp.

void app1::App1::init ( )
virtual

Implements micros_swarm::Application.

Definition at line 42 of file app1.cpp.

void app1::App1::motion ( )

Definition at line 102 of file app1.cpp.

void app1::App1::publish_cmd ( const ros::TimerEvent )

Definition at line 92 of file app1.cpp.

void app1::App1::start ( )
virtual

Implements micros_swarm::Application.

Definition at line 120 of file app1.cpp.

void app1::App1::stop ( )
virtual

Implements micros_swarm::Application.

Definition at line 40 of file app1.cpp.

Member Data Documentation

int app1::App1::delta

Definition at line 44 of file app1.h.

int app1::App1::epsilon

Definition at line 45 of file app1.h.

ros::Publisher app1::App1::pub

Definition at line 40 of file app1.h.

ros::Subscriber app1::App1::sub

Definition at line 41 of file app1.h.

ros::Timer app1::App1::timer

Definition at line 39 of file app1.h.


The documentation for this class was generated from the following files:


app1
Author(s):
autogenerated on Mon Jun 10 2019 14:02:12