Public Member Functions | Public Attributes | List of all members
app2::App2 Class Reference

#include <app2.h>

Inheritance diagram for app2::App2:
Inheritance graph
[legend]

Public Member Functions

 App2 ()
 
void baseCallback (const nav_msgs::Odometry &lmsg)
 
bool blue (int id)
 
XY direction_blue ()
 
XY direction_red ()
 
float force_mag_kin (float dist)
 
float force_mag_nonkin (float dist)
 
XY force_sum_kin (micros_swarm::NeighborBase n, XY &s)
 
XY force_sum_nonkin (micros_swarm::NeighborBase n, XY &s)
 
virtual void init ()
 
void motion_blue ()
 
void motion_red ()
 
void publish_blue_cmd (const ros::TimerEvent &)
 
void publish_red_cmd (const ros::TimerEvent &)
 
bool red (int id)
 
virtual void start ()
 
virtual void stop ()
 
 ~App2 ()
 
- 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

ros::Timer blue_timer
 
int delta_kin
 
int delta_nonkin
 
int epsilon_kin
 
int epsilon_nonkin
 
ros::Publisher pub
 
ros::Timer red_timer
 
ros::Subscriber sub
 

Detailed Description

Definition at line 36 of file app2.h.

Constructor & Destructor Documentation

app2::App2::App2 ( )

Definition at line 42 of file app2.cpp.

app2::App2::~App2 ( )

Definition at line 44 of file app2.cpp.

Member Function Documentation

void app2::App2::baseCallback ( const nav_msgs::Odometry &  lmsg)

Definition at line 194 of file app2.cpp.

bool app2::App2::blue ( int  id)

Definition at line 154 of file app2.cpp.

XY app2::App2::direction_blue ( )

Definition at line 131 of file app2.cpp.

XY app2::App2::direction_red ( )

Definition at line 116 of file app2.cpp.

float app2::App2::force_mag_kin ( float  dist)

Definition at line 58 of file app2.cpp.

float app2::App2::force_mag_nonkin ( float  dist)

Definition at line 63 of file app2.cpp.

XY app2::App2::force_sum_kin ( micros_swarm::NeighborBase  n,
XY s 
)

Definition at line 68 of file app2.cpp.

XY app2::App2::force_sum_nonkin ( micros_swarm::NeighborBase  n,
XY s 
)

Definition at line 92 of file app2.cpp.

void app2::App2::init ( )
virtual

Implements micros_swarm::Application.

Definition at line 48 of file app2.cpp.

void app2::App2::motion_blue ( )

Definition at line 188 of file app2.cpp.

void app2::App2::motion_red ( )

Definition at line 182 of file app2.cpp.

void app2::App2::publish_blue_cmd ( const ros::TimerEvent )

Definition at line 172 of file app2.cpp.

void app2::App2::publish_red_cmd ( const ros::TimerEvent )

Definition at line 162 of file app2.cpp.

bool app2::App2::red ( int  id)

Definition at line 146 of file app2.cpp.

void app2::App2::start ( )
virtual

Implements micros_swarm::Application.

Definition at line 206 of file app2.cpp.

void app2::App2::stop ( )
virtual

Implements micros_swarm::Application.

Definition at line 46 of file app2.cpp.

Member Data Documentation

ros::Timer app2::App2::blue_timer

Definition at line 40 of file app2.h.

int app2::App2::delta_kin

Definition at line 45 of file app2.h.

int app2::App2::delta_nonkin

Definition at line 47 of file app2.h.

int app2::App2::epsilon_kin

Definition at line 46 of file app2.h.

int app2::App2::epsilon_nonkin

Definition at line 48 of file app2.h.

ros::Publisher app2::App2::pub

Definition at line 41 of file app2.h.

ros::Timer app2::App2::red_timer

Definition at line 39 of file app2.h.

ros::Subscriber app2::App2::sub

Definition at line 42 of file app2.h.


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


app2
Author(s):
autogenerated on Mon Jun 10 2019 14:02:13