Skip to content

Commit

Permalink
Merge pull request #539 from davetcoleman/kinetic-whitespace
Browse files Browse the repository at this point in the history
Removed all trailing whitespace
  • Loading branch information
j-rivero authored Feb 11, 2017
2 parents 52a2708 + d542f2e commit de823c0
Show file tree
Hide file tree
Showing 86 changed files with 437 additions and 437 deletions.
10 changes: 5 additions & 5 deletions CONTRIBUTING.md
Original file line number Diff line number Diff line change
Expand Up @@ -18,18 +18,18 @@ are submitting an issue or a pull request, please prefix the title of the issue
or pull resquest with the package name. This way the appropriate maintainers
can more easily recognize contributions which require their attention.

## Style
## Style

We follow the [C++ ROS style guidelines](http://ros.org/wiki/CppStyleGuide) and
conventions as closely as possible. However, because the plugins inherit from Gazebo
classes and Gazebo follows a very different formatting standard, there are a few
We follow the [C++ ROS style guidelines](http://ros.org/wiki/CppStyleGuide) and
conventions as closely as possible. However, because the plugins inherit from Gazebo
classes and Gazebo follows a very different formatting standard, there are a few
exceptions where Gazebo's function names do not comply to the ROS guidelines.

## Tests

We encourage developers to include tests in their pull requests when possible,
both for bug fixes and new features.
Examples of tests are in the `gazebo_plugins/test*` folders.
Currently the tests must not be run in parallel (see issue
Currently the tests must not be run in parallel (see issue
[issue 409](https://github.com/ros-simulation/gazebo_ros_pkgs/issues/409))
so it is recommented to use the `-j1` argument to `catkin run_tests`.
2 changes: 1 addition & 1 deletion gazebo_msgs/msg/WorldState.msg
Original file line number Diff line number Diff line change
Expand Up @@ -24,7 +24,7 @@
# This message is used to do the following:
# * reconstruct the world and objects for sensor generation
# * stop / start simulation - need pose, twist, wrench of each body
# * collision detection - need pose of each collision geometry. velocity/acceleration if
# * collision detection - need pose of each collision geometry. velocity/acceleration if
#
# = Assumptions =
# Assuming that each (physics) processor node locally already has
Expand Down
126 changes: 63 additions & 63 deletions gazebo_plugins/CMakeLists.txt
Original file line number Diff line number Diff line change
@@ -1,24 +1,24 @@
cmake_minimum_required(VERSION 2.8.3)
project(gazebo_plugins)

find_package(catkin REQUIRED COMPONENTS
message_generation
gazebo_msgs
roscpp
rospy
nodelet
angles
std_srvs
geometry_msgs
sensor_msgs
nav_msgs
urdf
tf
tf2_ros
dynamic_reconfigure
rosgraph_msgs
trajectory_msgs
image_transport
find_package(catkin REQUIRED COMPONENTS
message_generation
gazebo_msgs
roscpp
rospy
nodelet
angles
std_srvs
geometry_msgs
sensor_msgs
nav_msgs
urdf
tf
tf2_ros
dynamic_reconfigure
rosgraph_msgs
trajectory_msgs
image_transport
rosconsole
cv_bridge
polled_camera
Expand Down Expand Up @@ -87,58 +87,58 @@ endif()

catkin_package(
INCLUDE_DIRS include
LIBRARIES
vision_reconfigure
gazebo_ros_utils
gazebo_ros_camera_utils
gazebo_ros_camera
gazebo_ros_multicamera
gazebo_ros_depth_camera
gazebo_ros_openni_kinect
gazebo_ros_gpu_laser
gazebo_ros_laser
gazebo_ros_block_laser
gazebo_ros_p3d
gazebo_ros_imu
gazebo_ros_f3d
LIBRARIES
vision_reconfigure
gazebo_ros_utils
gazebo_ros_camera_utils
gazebo_ros_camera
gazebo_ros_multicamera
gazebo_ros_depth_camera
gazebo_ros_openni_kinect
gazebo_ros_gpu_laser
gazebo_ros_laser
gazebo_ros_block_laser
gazebo_ros_p3d
gazebo_ros_imu
gazebo_ros_f3d
gazebo_ros_ft_sensor
gazebo_ros_bumper
gazebo_ros_template
gazebo_ros_projector
gazebo_ros_prosilica
gazebo_ros_force
gazebo_ros_joint_trajectory
gazebo_ros_joint_state_publisher
gazebo_ros_bumper
gazebo_ros_template
gazebo_ros_projector
gazebo_ros_prosilica
gazebo_ros_force
gazebo_ros_joint_trajectory
gazebo_ros_joint_state_publisher
gazebo_ros_joint_pose_trajectory
gazebo_ros_diff_drive
gazebo_ros_tricycle_drive
gazebo_ros_skid_steer_drive
gazebo_ros_video
gazebo_ros_planar_move
gazebo_ros_vacuum_gripper
CATKIN_DEPENDS
message_generation
gazebo_msgs
roscpp
rospy
nodelet
angles
std_srvs
geometry_msgs
sensor_msgs
nav_msgs
urdf
tf

CATKIN_DEPENDS
message_generation
gazebo_msgs
roscpp
rospy
nodelet
angles
std_srvs
geometry_msgs
sensor_msgs
nav_msgs
urdf
tf
tf2_ros
dynamic_reconfigure
rosgraph_msgs
trajectory_msgs
image_transport
dynamic_reconfigure
rosgraph_msgs
trajectory_msgs
image_transport
rosconsole
camera_info_manager
std_msgs
DEPENDS
DEPENDS
GAZEBO
SDFormat
)
Expand Down Expand Up @@ -289,9 +289,9 @@ target_link_libraries(gazebo_ros_vacuum_gripper ${GAZEBO_LIBRARIES} ${catkin_LIB
add_library(gazebo_ros_template src/gazebo_ros_template.cpp)
target_link_libraries(gazebo_ros_template ${GAZEBO_LIBRARIES} ${catkin_LIBRARIES} ${Boost_LIBRARIES})

install(TARGETS
hokuyo_node
vision_reconfigure
install(TARGETS
hokuyo_node
vision_reconfigure
camera_synchronizer
gazebo_ros_utils
gazebo_ros_camera_utils
Expand Down Expand Up @@ -322,7 +322,7 @@ install(TARGETS
gazebo_ros_video
gazebo_ros_planar_move
gazebo_ros_vacuum_gripper
pub_joint_trajectory_test
pub_joint_trajectory_test
gazebo_ros_gpu_laser
gazebo_ros_range
DESTINATION ${CATKIN_PACKAGE_BIN_DESTINATION}
Expand Down Expand Up @@ -364,7 +364,7 @@ install(DIRECTORY test
if (CATKIN_ENABLE_TESTING)
find_package(rostest REQUIRED)
add_rostest_gtest(set_model_state-test
test/set_model_state_test/set_model_state_test.test
test/set_model_state_test/set_model_state_test.test
test/set_model_state_test/set_model_state_test.cpp)
add_rostest(test/range/range_plugin.test)
target_link_libraries(set_model_state-test ${catkin_LIBRARIES})
Expand Down
2 changes: 1 addition & 1 deletion gazebo_plugins/cfg/CameraSynchronizer.cfg
Original file line number Diff line number Diff line change
Expand Up @@ -75,7 +75,7 @@ gen.add("projector_mode", int_t, lvl_all, "Indicates
gen.add("prosilica_projector_inhibit", bool_t, lvl_projector, "Indicates if the projector should turn off when the prosilica camera is exposing.", False)

gen.add("stereo_rate", double_t, lvl_stereo, "Indicates the frame rate for both stereo cameras in Hz. (Gets rounded to suitable divisors of projector_rate.)", 30.0, 1.0, 60.0)

gen.add("wide_stereo_trig_mode", int_t, lvl_stereo, "Indicates the triggering mode of the wide stereo camera.", 4, 2, 4, edit_method = wide_trig_mode_enum)
gen.add("narrow_stereo_trig_mode", int_t, lvl_stereo, "Indicates the triggering mode of the narrow stereo camera.", 4, 2, 5, edit_method = narrow_trig_mode_enum)

Expand Down
2 changes: 1 addition & 1 deletion gazebo_plugins/cfg/GazeboRosCamera.cfg
Original file line number Diff line number Diff line change
Expand Up @@ -8,6 +8,6 @@ from dynamic_reconfigure.msg import SensorLevels
from dynamic_reconfigure.parameter_generator_catkin import *
gen = ParameterGenerator()
gen.add("imager_rate", double_t, SensorLevels.RECONFIGURE_CLOSE, \
"Sets the frame rate of the imager. In externally triggered mode this must be more than trig_rate", 2, 1, 50)
"Sets the frame rate of the imager. In externally triggered mode this must be more than trig_rate", 2, 1, 50)

exit(gen.generate(PKG, "gazebo_ros_camera", "GazeboRosCamera"))
2 changes: 1 addition & 1 deletion gazebo_plugins/cfg/GazeboRosOpenniKinect.cfg
Original file line number Diff line number Diff line change
Expand Up @@ -8,6 +8,6 @@ from dynamic_reconfigure.msg import SensorLevels
from dynamic_reconfigure.parameter_generator_catkin import *
gen = ParameterGenerator()
gen.add("imager_rate", double_t, SensorLevels.RECONFIGURE_CLOSE, \
"Sets the frame rate of the imager. In externally triggered mode this must be more than trig_rate", 2, 1, 50)
"Sets the frame rate of the imager. In externally triggered mode this must be more than trig_rate", 2, 1, 50)

exit(gen.generate(PKG, "gazebo_ros_openni_kinect", "GazeboRosOpenniKinect"))
10 changes: 5 additions & 5 deletions gazebo_plugins/include/gazebo_plugins/PubQueue.h
Original file line number Diff line number Diff line change
Expand Up @@ -27,7 +27,7 @@
#include <ros/ros.h>


/// \brief Container for a (ROS publisher, outgoing message) pair.
/// \brief Container for a (ROS publisher, outgoing message) pair.
/// We'll have queues of these. Templated on a ROS message type.
template<class T>
class PubMessagePair
Expand Down Expand Up @@ -61,7 +61,7 @@ class PubQueue
boost::function<void()> notify_func_;

public:
PubQueue(QueuePtr queue,
PubQueue(QueuePtr queue,
boost::shared_ptr<boost::mutex> queue_lock,
boost::function<void()> notify_func) :
queue_(queue), queue_lock_(queue_lock), notify_func_(notify_func) {}
Expand Down Expand Up @@ -111,7 +111,7 @@ class PubMultiQueue

/// \brief Service a given queue by popping outgoing message off it and
/// publishing them.
template <class T>
template <class T>
void serviceFunc(boost::shared_ptr<PubQueue<T> > pq)
{
std::vector<boost::shared_ptr<PubMessagePair<T> > > els;
Expand All @@ -123,10 +123,10 @@ class PubMultiQueue
(*it)->pub_.publish((*it)->msg_);
}
}

public:
PubMultiQueue() {}
~PubMultiQueue()
~PubMultiQueue()
{
if(service_thread_.joinable())
{
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -84,7 +84,7 @@ namespace gazebo

/// \brief ros message
private: sensor_msgs::PointCloud cloud_msg_;

/// \brief topic name
private: std::string topic_name_;

Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -120,7 +120,7 @@ namespace gazebo

/// \brief tf prefix
private: std::string tf_prefix_;

/// \brief ROS image topic name
protected: std::string image_topic_name_;

Expand Down
8 changes: 4 additions & 4 deletions gazebo_plugins/include/gazebo_plugins/gazebo_ros_diff_drive.h
Original file line number Diff line number Diff line change
Expand Up @@ -29,7 +29,7 @@
/*
* \file gazebo_ros_diff_drive.h
*
* \brief A differential drive plugin for gazebo. Based on the diffdrive plugin
* \brief A differential drive plugin for gazebo. Based on the diffdrive plugin
* developed for the erratic robot (see copyright notice above). The original
* plugin can be found in the ROS package gazebo_erratic_plugins.
*
Expand Down Expand Up @@ -113,7 +113,7 @@ namespace gazebo {
ros::Subscriber cmd_vel_subscriber_;
boost::shared_ptr<tf::TransformBroadcaster> transform_broadcaster_;
sensor_msgs::JointState joint_state_;
ros::Publisher joint_state_publisher_;
ros::Publisher joint_state_publisher_;
nav_msgs::Odometry odom_;
std::string tf_prefix_;

Expand Down Expand Up @@ -142,11 +142,11 @@ namespace gazebo {
double update_rate_;
double update_period_;
common::Time last_update_time_;

OdomSource odom_source_;
geometry_msgs::Pose2D pose_encoder_;
common::Time last_odom_update_;

// Flags
bool publishWheelTF_;
bool publishWheelJointState_;
Expand Down
2 changes: 1 addition & 1 deletion gazebo_plugins/include/gazebo_plugins/gazebo_ros_f3d.h
Original file line number Diff line number Diff line change
Expand Up @@ -56,7 +56,7 @@ class GazeboRosF3D : public ModelPlugin

/// \brief Update the controller
protected: virtual void UpdateChild();

private: physics::WorldPtr world_;

/// \brief A pointer to the Gazebo Body
Expand Down
6 changes: 3 additions & 3 deletions gazebo_plugins/include/gazebo_plugins/gazebo_ros_force.h
Original file line number Diff line number Diff line change
Expand Up @@ -47,7 +47,7 @@ namespace gazebo
/** \defgroup GazeboRosForce Plugin XML Reference and Example

\brief Ros Force Plugin.

This is a Plugin that collects data from a ROS topic and applies wrench to a body accordingly.

Example Usage:
Expand All @@ -59,13 +59,13 @@ namespace gazebo
</plugin>
</gazebo>
\endverbatim

\{
*/

/**
.

*/

class GazeboRosForce : public ModelPlugin
Expand Down
14 changes: 7 additions & 7 deletions gazebo_plugins/include/gazebo_plugins/gazebo_ros_ft_sensor.h
Original file line number Diff line number Diff line change
Expand Up @@ -85,7 +85,7 @@ class GazeboRosFT : public ModelPlugin

/// \brief Update the controller
protected: virtual void UpdateChild();

/// \brief Gaussian noise
private: double gaussian_noise_;
private: unsigned int seed;
Expand All @@ -94,16 +94,16 @@ class GazeboRosFT : public ModelPlugin

/// \brief A pointer to the Gazebo joint
private: physics::JointPtr joint_;

/// \brief A pointer to the Gazebo parent link
private: physics::LinkPtr parent_link_;

/// \brief A pointer to the Gazebo child link
private: physics::LinkPtr child_link_;

/// \brief A pointer to the Gazebo model
private: physics::ModelPtr model_;

/// \brief A pointer to the Gazebo world
private: physics::WorldPtr world_;

Expand All @@ -129,10 +129,10 @@ class GazeboRosFT : public ModelPlugin

/// \brief A mutex to lock access to fields that are used in message callbacks
private: boost::mutex lock_;

/// \brief save last_time
private: common::Time last_time_;

// rate control
private: double update_rate_;

Expand Down
Loading

0 comments on commit de823c0

Please sign in to comment.