power_node.cpp File Reference

#include <stdio.h>
#include <stdint.h>
#include <string.h>
#include <unistd.h>
#include <stdlib.h>
#include <sys/select.h>
#include <sys/types.h>
#include <assert.h>
#include <errno.h>
#include <signal.h>
#include <vector>
#include <sstream>
#include <iostream>
#include <boost/thread/thread.hpp>
#include <boost/program_options.hpp>
#include <sys/socket.h>
#include <netinet/in.h>
#include <arpa/inet.h>
#include <net/if.h>
#include <sys/ioctl.h>
#include "power_comm.h"
#include "power_node.h"
#include "diagnostic_msgs/DiagnosticArray.h"
#include <string>
#include <ostream>
#include "ros/serialization.h"
#include "ros/builtin_message_traits.h"
#include "ros/message_operations.h"
#include "ros/message.h"
#include "ros/time.h"
#include "std_msgs/Header.h"
#include <stdarg.h>
#include <cstdio>
#include "ros/ros.h"
#include "diagnostic_msgs/DiagnosticStatus.h"
#include "rosconsole/macros_generated.h"
Include dependency graph for power_node.cpp:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Defines

#define PRINT_IF_CHANGED(val)
#define PRINT_IF_CHANGED(val)

Functions

void CloseAllDevices (void)
void CloseAllInterfaces (void)
int CreateAllInterfaces (void)
void getMessages ()
int main (int argc, char **argv)
void sendMessages ()
void setupReceive ()

Variables

static std::vector< Device * > Devices
static PowerBoardmyBoard
static InterfaceReceiveInterface
static std::vector< Interface * > SendInterfaces
static const ros::Duration TIMEOUT = ros::Duration(1,0)

Define Documentation

#define PRINT_IF_CHANGED ( val   ) 
Value:
if (pmsg.status.val##_status != newpmsg.status.val##_status)                             \
{                                                                                        \
  ROS_INFO("Power board: status of "#val" changed to %i.", newpmsg.status.val##_status); \
}
#define PRINT_IF_CHANGED ( val   ) 
Value:
for (int counter = 0; counter < 3; counter++)                                                                 \
{                                                                                                             \
  if (tmsg.cb[counter].val##_count != newtmsg.cb[counter].val##_count)                                        \
  {                                                                                                           \
    ROS_INFO("Power board: CB%i "#val" event count changed to %i.", counter, newtmsg.cb[counter].val##_count);\
  }                                                                                                           \
}

Function Documentation

void CloseAllDevices ( void   ) 

Definition at line 898 of file power_node.cpp.

void CloseAllInterfaces ( void   ) 

Definition at line 889 of file power_node.cpp.

int CreateAllInterfaces ( void   ) 

Definition at line 915 of file power_node.cpp.

void getMessages (  ) 

Definition at line 878 of file power_node.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 1004 of file power_node.cpp.

void sendMessages (  ) 

Definition at line 883 of file power_node.cpp.

void setupReceive (  ) 

Definition at line 906 of file power_node.cpp.


Variable Documentation

std::vector<Device*> Devices [static]

Definition at line 68 of file power_node.cpp.

PowerBoard* myBoard [static]

Definition at line 70 of file power_node.cpp.

Definition at line 71 of file power_node.cpp.

std::vector<Interface*> SendInterfaces [static]

Definition at line 69 of file power_node.cpp.

const ros::Duration TIMEOUT = ros::Duration(1,0) [static]

Definition at line 73 of file power_node.cpp.

 All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator Defines


pr2_power_board
Author(s): Curt Meyers, Blaise Gassend
autogenerated on Fri Jan 11 09:52:51 2013