Demonstrate how to flash a LED light with RoNeX. More...
#include <string>#include <ros/ros.h>#include <ros/console.h>#include <boost/lexical_cast.hpp>#include "sr_ronex_msgs/PWM.h"#include "sr_ronex_utilities/sr_ronex_utilities.hpp"
Go to the source code of this file.
Classes | |
| class | SrRonexFindGeneralIOModule |
Functions | |
| void | flash_LED (ros::NodeHandle &n, const std::string &topic) |
| int | main (int argc, char **argv) |
Demonstrate how to flash a LED light with RoNeX.
Definition in file sr_ronex_flash_LED_with_PWM.cpp.
| void flash_LED | ( | ros::NodeHandle & | n, |
| const std::string & | topic | ||
| ) |
Flash a LED light with PWM.
| n | A ROS node handle. |
| topic | For example "/ronex/general_io/1/command/0". |
Definition at line 105 of file sr_ronex_flash_LED_with_PWM.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Assume that your RoNeX consists of a Bridge (IN) module, and one or multiple General I/O module(s). This example demonstrates how to flash a LED light with pulse-width modulation (PWM).
Definition at line 144 of file sr_ronex_flash_LED_with_PWM.cpp.