publish_control_board_rev2.h
Go to the documentation of this file.
00001 /*
00002 * Unpublished Copyright (c) 2009-2018 AutonomouStuff, LLC, All Rights Reserved.
00003 *
00004 * This file is part of the PACMod ROS 1.0 driver which is released under the MIT license.
00005 * See file LICENSE included with this software or go to https://opensource.org/licenses/MIT for full license details.
00006 */
00007 
00008 #ifndef PUBLISH_CONTROL_BOARD_REV2_H
00009 #define PUBLISH_CONTROL_BOARD_REV2_H
00010 
00011 #include "globals.h"
00012 #include "publish_control.h"
00013 
00014 #include <pacmod_msgs/PositionWithSpeed.h>
00015 #include <pacmod_msgs/PacmodCmd.h>
00016 
00017 namespace AS
00018 {
00019 namespace Joystick
00020 {
00021 
00022 // Publish control class, child class from publish control
00023 class PublishControlBoardRev2 :
00024   public PublishControl
00025 {
00026   public:
00027     PublishControlBoardRev2();
00028 
00029   private:
00030     // private functions
00031     void publish_steering_message(const sensor_msgs::Joy::ConstPtr& msg);
00032     void publish_turn_signal_message(const sensor_msgs::Joy::ConstPtr& msg);
00033     void publish_shifting_message(const sensor_msgs::Joy::ConstPtr& msg);
00034     void publish_accelerator_message(const sensor_msgs::Joy::ConstPtr& msg);
00035     void publish_brake_message(const sensor_msgs::Joy::ConstPtr& msg);
00036     void publish_lights_horn_wipers_message(const sensor_msgs::Joy::ConstPtr& msg);
00037 };
00038 
00039 }
00040 }
00041 
00042 #endif


pacmod_game_control
Author(s): Joe Driscoll
autogenerated on Thu Jun 6 2019 21:10:24