message_filters package from message_filters repo

message_filters

Package Summary

Tags No category tags.
Version 4.3.3
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/message_filters.git
VCS Type git
VCS Version humble
Last Updated 2023-04-25
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A set of ROS2 message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.

Additional Links

Maintainers

  • Ethan Gao
  • Geoffrey Biggs

Authors

  • Dirk Thomas
  • Jing Wang
  • Josh Faust
  • Vijay Pradeep
README
No README found. No README in repository either.
CHANGELOG

Changelog for package message_filters

4.3.3 (2023-04-25)

  • Add latest time zero-order-hold sync policy (#73) (#89)
  • Contributors: mergify[bot]

4.3.2 (2022-06-20)

  • Adding fix to subscribe() call with raw node pointer and subscriber options (#76) (#77)
  • Contributors: Steve Macenski

4.3.1 (2022-03-25)

  • Use RCL_ROS_TIME for message_traits::TimeStamp (#72)
  • Contributors: Kenji Brameld

4.3.0 (2022-03-01)

  • Install includes to include/\${PROJECT_NAME} (#71)
  • Update maintainers (#67)
  • Contributors: Audrow Nash, Shane Loretz

4.2.0 (2021-10-18)

  • Suppress rclcpp deprecation warnings in unit tests (#62)
  • Contributors: Abrar Rahman Protyasha

4.1.0 (2021-07-29)

  • Add missing overrides to subscriber.h (#60)
  • Add lifecycle node support (#59)
  • Correct package.xml and CMakeLists.txt (#58)
  • Contributors: Hunter L. Allen, Michel Hidalgo, Rebecca Butler

4.0.0 (2021-05-26)

  • Expose Subscription Options - V2 (#56)
  • Contributors: Audrow Nash

3.2.6 (2021-05-12)

  • Find and export dependencies properly (#54)
  • Contributors: Michel Hidalgo

3.2.5 (2020-12-10)

  • Add pytest.ini so local tests don\'t display warning (#47)
  • Contributors: Chris Lalancette

3.2.4 (2020-06-03)

  • export targets in a addition to include directories / libraries (#46)
  • Contributors: Dirk Thomas

3.2.3 (2019-11-18)

  • allow custom qos for message filters

3.2.2 (2019-11-08)

  • Fix unhashable type \'Time\' error (#33)
  • Contributors: Jamie Diprose

3.2.1 (2019-10-23)

  • Resolve ambiguity with boost/bind.hpp (#40)
  • Contributors: Shane Loretz

3.2.0 (2019-09-26)

3.1.2 (2019-05-20)

  • Add .gitignore
  • Fix deprecation warning
  • Contributors: Jacob Perron

3.1.1 (2019-05-08)

  • changes to avoid deprecated API\'s (#26)
  • Merge pull request #25 from ros2/ivanpauno/deprecate-shared-ptr-publish
  • adding code import references in comments (#6)
  • Make format string agree with argument type. (#24)
  • Contributors: Steven! Ragnar

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
avt_vimba_camera github-astuff-avt_vimba_camera
depthai_filters github-luxonis-depthai-ros
find_object_2d github-introlab-find-object
tf2_ros github-ros2-geometry2
turtle_tf2_cpp github-ros-geometry_tutorials
image_transport github-ros-perception-image_common
camera_calibration github-ros-perception-image_pipeline
depth_image_proc github-ros-perception-image_pipeline
image_view github-ros-perception-image_pipeline
stereo_image_proc github-ros-perception-image_pipeline
imu_transformer github-ros-perception-imu_pipeline
imu_complementary_filter github-CCNYRoboticsLab-imu_tools
rviz_imu_plugin github-CCNYRoboticsLab-imu_tools
laser_filters github-ros-perception-laser_filters
swri_image_util github-swri-robotics-marti_common
mavros github-mavlink-mavros
mavros_extras github-mavlink-mavros
moveit_ros_perception github-ros-planning-moveit2
moveit_ros_planning github-ros-planning-moveit2
octomap_server github-OctoMap-octomap_mapping
pcl_conversions github-ros-perception-perception_pcl
point_cloud_transport github-ros-perception-point_cloud_transport
pointcloud_to_laserscan github-ros-perception-pointcloud_to_laserscan
robot_localization github-cra-ros-pkg-robot_localization
rtabmap_odom github-introlab-rtabmap_ros
rtabmap_sync github-introlab-rtabmap_ros
rtabmap_util github-introlab-rtabmap_ros
rviz_common github-ros2-rviz
slam_toolbox github-SteveMacenski-slam_toolbox
spatio_temporal_voxel_layer github-SteveMacenski-spatio_temporal_voxel_layer
turtlebot3_node github-ROBOTIS-GIT-turtlebot3
velodyne_pointcloud github-ros-drivers-velodyne
nav2_amcl github-ros-planning-navigation2
nav2_costmap_2d github-ros-planning-navigation2
rqt_image_overlay_layer github-ros-sports-rqt_image_overlay

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged message_filters at Robotics Stack Exchange

message_filters package from message_filters repo

message_filters

Package Summary

Tags No category tags.
Version 4.7.0
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/message_filters.git
VCS Type git
VCS Version iron
Last Updated 2023-02-13
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A set of ROS2 message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.

Additional Links

Maintainers

  • Geoffrey Biggs

Authors

  • Dirk Thomas
  • Ethan Gao
  • Jing Wang
  • Josh Faust
  • Vijay Pradeep

ROS2 message filters

Package that implements different filters for ros messages.

Refer to index.rst for more information.

The implementation with the details can be found in src/message_filters/init.py

The latest version (Humble) has the stable version of the python API. If you are using older distros please upgrade your code with the rolling or humble branches.

CHANGELOG

Changelog for package message_filters

4.7.0 (2023-02-13)

  • Update message_filters to C++17. (#88)
  • Fix cache.h std::placeholder namespace (#87)
  • [rolling] Update maintainers - 2022-11-07 (#85)
  • Contributors: Audrow Nash, Chris Lalancette, Haoru Xue

4.6.1 (2022-10-05)

  • Add a simpler aproximate time sync policy: ApproximateEpsilonTime (#84)
  • Contributors: Ivan Santiago Paunovic

4.5.0 (2022-09-13)

  • Add latest time zero-order-hold sync policy (#73)
  • Fix python examples and add a new example in documentation (#79)
  • Mirror rolling to master
  • Contributors: Audrow Nash, Carlos Andr

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
avt_vimba_camera github-astuff-avt_vimba_camera
depthai_filters github-luxonis-depthai-ros
find_object_2d github-introlab-find-object
tf2_ros github-ros2-geometry2
turtle_tf2_cpp github-ros-geometry_tutorials
image_transport github-ros-perception-image_common
camera_calibration github-ros-perception-image_pipeline
depth_image_proc github-ros-perception-image_pipeline
image_view github-ros-perception-image_pipeline
stereo_image_proc github-ros-perception-image_pipeline
imu_transformer github-ros-perception-imu_pipeline
imu_complementary_filter github-CCNYRoboticsLab-imu_tools
rviz_imu_plugin github-CCNYRoboticsLab-imu_tools
laser_filters github-ros-perception-laser_filters
swri_image_util github-swri-robotics-marti_common
mavros github-mavlink-mavros
mavros_extras github-mavlink-mavros
moveit_ros_perception github-ros-planning-moveit2
moveit_ros_planning github-ros-planning-moveit2
octomap_server github-OctoMap-octomap_mapping
pcl_conversions github-ros-perception-perception_pcl
point_cloud_transport github-ros-perception-point_cloud_transport
pointcloud_to_laserscan github-ros-perception-pointcloud_to_laserscan
robot_localization github-cra-ros-pkg-robot_localization
rtabmap_odom github-introlab-rtabmap_ros
rtabmap_sync github-introlab-rtabmap_ros
rtabmap_util github-introlab-rtabmap_ros
rviz_common github-ros2-rviz
slam_toolbox github-SteveMacenski-slam_toolbox
velodyne_pointcloud github-ros-drivers-velodyne
nav2_amcl github-ros-planning-navigation2
nav2_costmap_2d github-ros-planning-navigation2
rqt_image_overlay_layer github-ros-sports-rqt_image_overlay

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged message_filters at Robotics Stack Exchange

message_filters package from message_filters repo

message_filters

Package Summary

Tags No category tags.
Version 4.11.1
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/message_filters.git
VCS Type git
VCS Version rolling
Last Updated 2024-04-16
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A set of ROS 2 message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.

Additional Links

Maintainers

  • Geoffrey Biggs

Authors

  • Dirk Thomas
  • Ethan Gao
  • Jing Wang
  • Josh Faust
  • Vijay Pradeep

ROS 2 message filters

Package that implements different filters for ros messages.

Refer to index.rst for more information.

The implementation with the details can be found in src/message_filters/init.py

CHANGELOG

Changelog for package message_filters

4.11.1 (2024-04-16)

  • Update TimeSynchronizer usage example. (#115)
  • Contributors: rkeating-planted

4.11.0 (2023-12-26)

  • Remove \'using\' keyword in message_filters (#106)
  • Remove the use of ament_target_dependencies. (#105)
  • Fixes pointed out by clang (#104)
  • Contributors: Chris Lalancette

4.10.1 (2023-11-06)

  • Mark subscription cb parameter const (#103)
  • Contributors: Patrick Roncagliolo

4.10.0 (2023-08-21)

  • Update the HasHeader check to be more specific. (#101)
  • TypeAdapters support (#95) (#96)
  • Contributors: Chris Lalancette, Patrick Roncagliolo

4.9.1 (2023-07-11)

  • Cleanup a few minor things in the filters. (#100)
  • Fix python examples (#99)
  • Contributors: Chris Lalancette, Ricardo de Azambuja

4.9.0 (2023-06-07)

  • feat: add signal time functions to ExactTime policy (#94)
  • Contributors: Russ

4.8.0 (2023-04-27)

4.7.0 (2023-02-13)

  • Update message_filters to C++17. (#88)
  • Fix cache.h std::placeholder namespace (#87)
  • [rolling] Update maintainers - 2022-11-07 (#85)
  • Contributors: Audrow Nash, Chris Lalancette, Haoru Xue

4.6.1 (2022-10-05)

  • Add a simpler aproximate time sync policy: ApproximateEpsilonTime (#84)
  • Contributors: Ivan Santiago Paunovic

4.5.0 (2022-09-13)

  • Add latest time zero-order-hold sync policy (#73)
  • Fix python examples and add a new example in documentation (#79)
  • Mirror rolling to master
  • Contributors: Audrow Nash, Carlos Andr

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged message_filters at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.16.0
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/ros_comm.git
VCS Type git
VCS Version noetic-devel
Last Updated 2023-11-21
Dev Status MAINTAINED
CI status
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A set of message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.

Additional Links

Maintainers

  • Michael Carroll
  • Shane Loretz

Authors

  • Josh Faust
  • Vijay Pradeep
  • Dirk Thomas
  • Jacob Perron
README
No README found. No README in repository either.
CHANGELOG

Changelog for package message_filters

1.16.0 (2023-02-15)

1.15.15 (2022-11-23)

  • Move \@jacobperron from maintainer to author (#2302)
  • Correct missed boost placeholders (#2242)
  • Contributors: Lucas Walter, Shane Loretz

1.15.14 (2022-01-06)

1.15.13 (2021-09-22)

1.15.12 (2021-09-21)

1.15.11 (2021-04-06)

1.15.10 (2021-03-18)

1.15.9 (2020-10-16)

  • Update maintainers (#2075)
  • Fix compatibility issue with boost 1.73 and above (#2023)
  • Contributors: Sean Yen, Shane Loretz

1.15.8 (2020-07-23)

1.15.7 (2020-05-28)

1.15.6 (2020-05-21)

1.15.5 (2020-05-15)

  • clear message queue on simtime jumping back (#1518)

1.15.4 (2020-03-19)

1.15.3 (2020-02-28)

1.15.2 (2020-02-25)

1.15.1 (2020-02-24)

  • fix missing boost dependencies (#1895)
  • use setuptools instead of distutils (#1870)

1.15.0 (2020-02-21)

1.14.4 (2020-02-20)

  • bump CMake minimum version to avoid CMP0048 warning (#1869)
  • add overload of ApproximateTime::setInterMessageLowerBound() to set all topics to the same value (#1860)
  • update approximate time filter to work with Python 2 and 3 (#1660)
  • message_filters/__init_.py - Added reduce import for Python 3 compatability (#1633)
  • remove messages that are newer than the newly added message (#1438)
  • remove signals from find_package(Boost COMPONENTS ...) (#1580)
  • fix message_filters build issue on the template syntax (#1483)

1.14.3 (2018-08-06)

  • call Subscriber::unsubscribe() in destructor (#1434)
  • rename Python message_filters.Cache.getLastestTime to getLatestTime (#1450)

1.14.2 (2018-06-06)

1.14.1 (2018-05-21)

1.14.0 (2018-05-21)

  • change invocation to [add]{.title-ref} to conform template syntax (#1388)
  • fix sphinx warning (#1371)

1.13.6 (2018-02-05)

  • use SteadyTimer in message_filters (#1247)
  • remove unnecessary xmlrpcpp dependency from message_filters (#1264)

1.13.5 (2017-11-09)

1.13.4 (2017-11-02)

1.13.3 (2017-10-25)

1.13.2 (2017-08-15)

1.13.1 (2017-07-27)

1.13.0 (2017-02-22)

1.12.7 (2017-02-17)

1.12.6 (2016-10-26)

  • use boost::bind to bind the callback function (#906)

1.12.5 (2016-09-30)

1.12.4 (2016-09-19)

1.12.3 (2016-09-17)

  • add fast approximate time synchronization in message_filters (in pure Python) (#802)

1.12.2 (2016-06-03)

  • allow saving timestamp-less messages to Cache, add getLast method (#806)

1.12.1 (2016-04-18)

  • use directory specific compiler flags (#785)

1.12.0 (2016-03-18)

1.11.18 (2016-03-17)

  • fix compiler warnings

1.11.17 (2016-03-11)

  • use boost::make_shared instead of new for constructing boost::shared_ptr (#740)
  • add __getattr_ to handle sub in message_filters as standard one (#700)

1.11.16 (2015-11-09)

1.11.15 (2015-10-13)

  • add unregister() method to message_filter.Subscriber (#683)

1.11.14 (2015-09-19)

1.11.13 (2015-04-28)

1.11.12 (2015-04-27)

1.11.11 (2015-04-16)

  • implement message filter cache in Python (#599)

1.11.10 (2014-12-22)

1.11.9 (2014-08-18)

1.11.8 (2014-08-04)

1.11.7 (2014-07-18)

1.11.6 (2014-07-10)

1.11.5 (2014-06-24)

1.11.4 (2014-06-16)

  • add approximate Python time synchronizer (used to be in camera_calibration) (#424)

1.11.3 (2014-05-21)

1.11.2 (2014-05-08)

1.11.1 (2014-05-07)

  • update API to use boost::signals2 (#267)

1.11.0 (2014-03-04)

  • suppress boost::signals deprecation warning (#362)

1.10.0 (2014-02-11)

1.9.54 (2014-01-27)

1.9.53 (2014-01-14)

  • add kwargs for message_filters.Subscriber

1.9.52 (2014-01-08)

1.9.51 (2014-01-07)

  • update code after refactoring into rosbag_storage and roscpp_core (#299)
  • fix segmentation fault on OS X 10.9 (clang / libc++)

1.9.50 (2013-10-04)

1.9.49 (2013-09-16)

1.9.48 (2013-08-21)

1.9.47 (2013-07-03)

  • check for CATKIN_ENABLE_TESTING to enable configure without tests

1.9.46 (2013-06-18)

1.9.45 (2013-06-06)

  • fix template syntax for signal_.template addCallback() to work with Intel compiler

1.9.44 (2013-03-21)

  • fix install destination for dll\'s under Windows

1.9.43 (2013-03-13)

  • fix exports of message filter symbols for Windows

1.9.42 (2013-03-08)

1.9.41 (2013-01-24)

1.9.40 (2013-01-13)

1.9.39 (2012-12-29)

  • first public release for Groovy

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

System Dependencies

Dependant Packages

Name Repo Deps
avt_vimba_camera github-astuff-avt_vimba_camera
image_cb_detector github-ros-perception-calibration
laser_cb_detector github-ros-perception-calibration
cob_map_accessibility_analysis github-ipa320-cob_navigation
cob_cam3d_throttle github-ipa320-cob_perception_common
cob_object_detection_visualizer github-ipa320-cob_perception_common
points_preprocessor github-nobleo-core_perception
dataspeed_pds_can bitbucket-DataspeedInc-dataspeed_pds
dataspeed_pds_lcm bitbucket-DataspeedInc-dataspeed_pds
depthai_examples github-luxonis-depthai-ros
depthai_filters github-luxonis-depthai-ros
depthai_ros_driver github-luxonis-depthai-ros
find_object_2d github-introlab-find-object
tf github-ros-geometry
tf2_ros github-ros-geometry2
gps_common github-swri-robotics-gps_umd
hector_pose_estimation github-tu-darmstadt-ros-pkg-hector_localization
hector_mapping github-tu-darmstadt-ros-pkg-hector_slam
image_transport github-ros-perception-image_common
camera_calibration github-ros-perception-image_pipeline
depth_image_proc github-ros-perception-image_pipeline
image_view github-ros-perception-image_pipeline
stereo_image_proc github-ros-perception-image_pipeline
imu_transformer github-ros-perception-imu_pipeline
imu_complementary_filter github-CCNYRoboticsLab-imu_tools
imu_filter_madgwick github-CCNYRoboticsLab-imu_tools
iris_lama_ros github-iris-ua-iris_lama_ros
audio_video_recorder github-jsk-ros-pkg-jsk_common
image_view2 github-jsk-ros-pkg-jsk_common
posedetection_msgs github-jsk-ros-pkg-jsk_common_msgs
jsk_footstep_controller github-jsk-ros-pkg-jsk_control
checkerboard_detector github-jsk-ros-pkg-jsk_recognition
sound_classification github-jsk-ros-pkg-jsk_recognition
jsk_interactive_marker github-jsk-ros-pkg-jsk_visualization
laser_assembler github-ros-perception-laser_assembler
laser_filters github-ros-perception-laser_filters
swri_image_util github-swri-robotics-marti_common
moveit_ros_perception github-ros-planning-moveit
moveit_ros_planning github-ros-planning-moveit
amcl github-ros-planning-navigation
costmap_2d github-ros-planning-navigation
fake_localization github-ros-planning-navigation
assisted_teleop github-ros-planning-navigation_experimental
track_odometry github-at-wat-neonavigation
nodelet_topic_tools github-ros-nodelet_core
test_nodelet_topic_tools github-ros-nodelet_core
nonpersistent_voxel_layer github-SteveMacenski-nonpersistent_voxel_layer
face_detector github-wg-perception-people
leg_detector github-wg-perception-people
people_tracking_filter github-wg-perception-people
pcl_ros github-ros-perception-perception_pcl
prbt_hardware_support github-PilzDE-pilz_robots
point_cloud_transport github-ctu-vras-point_cloud_transport
pointcloud_to_laserscan github-ros-perception-pointcloud_to_laserscan
pr2_head_action github-pr2-pr2_controllers
robot_mechanism_controllers github-pr2-pr2_controllers
pr2_navigation_perception github-PR2-pr2_navigation
robot_localization github-cra-ros-pkg-robot_localization
ros_comm github-ros-ros_comm
rtabmap_examples github-introlab-rtabmap_ros
rtabmap_odom github-introlab-rtabmap_ros
rtabmap_sync github-introlab-rtabmap_ros
rtabmap_util github-introlab-rtabmap_ros
rviz github-ros-visualization-rviz
laser_ortho_projector github-CCNYRoboticsLab-scan_tools
sick_ldmrs_tools github-SICKAG-sick_ldmrs_laser
slam_karto github-ros-perception-slam_karto
slam_toolbox github-SteveMacenski-slam_toolbox
spatio_temporal_voxel_layer github-SteveMacenski-spatio_temporal_voxel_layer
ublox_msg_filters github-KumarRobotics-ublox
velo2cam_calibration github-beltransen-velo2cam_calibration
visp_auto_tracker github-lagadic-vision_visp
magnetometer_compass github-ctu-vras-compass
gmcl github-adler-1994-gmcl

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged message_filters at Robotics Stack Exchange

No version for distro ardent. Known supported distros are highlighted in the buttons above.
No version for distro bouncy. Known supported distros are highlighted in the buttons above.

message_filters package from message_filters repo

message_filters

Package Summary

Tags No category tags.
Version 3.0.0
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/message_filters.git
VCS Type git
VCS Version crystal
Last Updated 2018-11-22
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A set of ROS2 message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.

Additional Links

Maintainers

  • Ethan Gao

Authors

  • Josh Faust
  • Vijay Pradeep
  • Dirk Thomas
  • Jing Wang
README
No README found. No README in repository either.
CHANGELOG

Changelog for package message_filters

3.0.0 (2018-11-22)

  • Move sensor_msgs to be a test dependency. (#17)
  • Fix Duration signature for Windows CI. (#16)
  • Add the ability to use raw pointers in Subscriber (#14)
  • fixed using wrong type of stamp (#12)
  • Add message trait support to frame id of message (#13)
  • Merge pull request #10 from ros2/fix_windows
  • Change argument name to better reflect behavior.
  • Fix signedness of some comparisons.
  • Correctly export and depend on ament_cmake_ros.
  • Cleanup windows warnings.
  • Fix visibility control.
  • Fix include guards and include order.
  • enable message_filters support of python interfaces and tests (#7)
  • Remove references in pointer API calls.
  • Remove ROS1 specific connection header info from API.
  • demote std_msgs to test dependency
  • Update docs to remove nodehandle reference.
  • Use Node::SharedPtr instead of Node*
  • Make node required as an internal one is required to spin.
  • Add noncopyable base class
  • Deboostify and change from ros::Time to rclcpp::Time
  • Convert to ament_cmake
  • Changed invocation to [add]{.title-ref} to conform template syntax (#1388) This change fixes issue #1383
  • fix sphinx warning (#1371)
  • Contributors: Dirk Thomas, Ethan Gao, Gary Liu, J

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged message_filters at Robotics Stack Exchange

message_filters package from message_filters repo

message_filters

Package Summary

Tags No category tags.
Version 3.2.3
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/message_filters.git
VCS Type git
VCS Version eloquent
Last Updated 2019-11-18
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A set of ROS2 message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.

Additional Links

Maintainers

  • Ethan Gao

Authors

  • Josh Faust
  • Vijay Pradeep
  • Dirk Thomas
  • Jing Wang
README
No README found. No README in repository either.
CHANGELOG

Changelog for package message_filters

3.2.3 (2019-11-18)

  • allow custom qos for message filters

3.2.2 (2019-11-08)

  • Fix unhashable type \'Time\' error (#33)
  • Contributors: Jamie Diprose

3.2.1 (2019-10-23)

  • Resolve ambiguity with boost/bind.hpp (#40)
  • Contributors: Shane Loretz

3.2.0 (2019-09-26)

3.1.2 (2019-05-20)

  • Add .gitignore
  • Fix deprecation warning
  • Contributors: Jacob Perron

3.1.1 (2019-05-08)

  • changes to avoid deprecated API\'s (#26)
  • Merge pull request #25 from ros2/ivanpauno/deprecate-shared-ptr-publish
  • adding code import references in comments (#6)
  • Make format string agree with argument type. (#24)
  • Contributors: Steven! Ragnar

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged message_filters at Robotics Stack Exchange

message_filters package from message_filters repo

message_filters

Package Summary

Tags No category tags.
Version 3.1.3
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/message_filters.git
VCS Type git
VCS Version dashing
Last Updated 2019-12-05
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A set of ROS2 message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.

Additional Links

Maintainers

  • Ethan Gao

Authors

  • Josh Faust
  • Vijay Pradeep
  • Dirk Thomas
  • Jing Wang
README
No README found. No README in repository either.
CHANGELOG

Changelog for package message_filters

3.1.3 (2019-12-05)

  • Resolve ambiguity with boost/bind.hpp (#42)
  • Contributors: Shane Loretz

3.1.2 (2019-05-20)

  • Add .gitignore
  • Fix deprecation warning
  • Contributors: Jacob Perron

3.1.1 (2019-05-08)

  • changes to avoid deprecated API\'s (#26)
  • Merge pull request #25 from ros2/ivanpauno/deprecate-shared-ptr-publish
  • adding code import references in comments (#6)
  • Make format string agree with argument type. (#24)
  • Contributors: Steven! Ragnar

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged message_filters at Robotics Stack Exchange

message_filters package from message_filters repo

message_filters

Package Summary

Tags No category tags.
Version 3.2.6
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/message_filters.git
VCS Type git
VCS Version galactic
Last Updated 2021-05-12
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A set of ROS2 message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.

Additional Links

Maintainers

  • Ethan Gao

Authors

  • Josh Faust
  • Vijay Pradeep
  • Dirk Thomas
  • Jing Wang
README
No README found. No README in repository either.
CHANGELOG

Changelog for package message_filters

3.2.6 (2021-05-12)

  • Find and export dependencies properly (#54)
  • Contributors: Michel Hidalgo

3.2.5 (2020-12-10)

  • Add pytest.ini so local tests don\'t display warning (#47)
  • Contributors: Chris Lalancette

3.2.4 (2020-06-03)

  • export targets in a addition to include directories / libraries (#46)
  • Contributors: Dirk Thomas

3.2.3 (2019-11-18)

  • allow custom qos for message filters

3.2.2 (2019-11-08)

  • Fix unhashable type \'Time\' error (#33)
  • Contributors: Jamie Diprose

3.2.1 (2019-10-23)

  • Resolve ambiguity with boost/bind.hpp (#40)
  • Contributors: Shane Loretz

3.2.0 (2019-09-26)

3.1.2 (2019-05-20)

  • Add .gitignore
  • Fix deprecation warning
  • Contributors: Jacob Perron

3.1.1 (2019-05-08)

  • changes to avoid deprecated API\'s (#26)
  • Merge pull request #25 from ros2/ivanpauno/deprecate-shared-ptr-publish
  • adding code import references in comments (#6)
  • Make format string agree with argument type. (#24)
  • Contributors: Steven! Ragnar

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged message_filters at Robotics Stack Exchange

message_filters package from message_filters repo

message_filters

Package Summary

Tags No category tags.
Version 3.2.7
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/message_filters.git
VCS Type git
VCS Version foxy
Last Updated 2023-06-06
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A set of ROS2 message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.

Additional Links

Maintainers

  • Ethan Gao

Authors

  • Josh Faust
  • Vijay Pradeep
  • Dirk Thomas
  • Jing Wang
README
No README found. No README in repository either.
CHANGELOG

Changelog for package message_filters

3.2.7 (2023-06-06)

  • Use RCL_ROS_TIME for message_traits::TimeStamp (#72) (#81)
  • Contributors: Paul Schalkwijk, Kenji Brameld, Sivert Havso

3.2.5 (2020-12-10)

  • Add pytest.ini so local tests don\'t display warning (#47)
  • Contributors: Chris Lalancette

3.2.4 (2020-06-03)

  • export targets in a addition to include directories / libraries (#46)
  • Contributors: Dirk Thomas

3.2.3 (2019-11-18)

  • allow custom qos for message filters

3.2.2 (2019-11-08)

  • Fix unhashable type \'Time\' error (#33)
  • Contributors: Jamie Diprose

3.2.1 (2019-10-23)

  • Resolve ambiguity with boost/bind.hpp (#40)
  • Contributors: Shane Loretz

3.2.0 (2019-09-26)

3.1.2 (2019-05-20)

  • Add .gitignore
  • Fix deprecation warning
  • Contributors: Jacob Perron

3.1.1 (2019-05-08)

  • changes to avoid deprecated API\'s (#26)
  • Merge pull request #25 from ros2/ivanpauno/deprecate-shared-ptr-publish
  • adding code import references in comments (#6)
  • Make format string agree with argument type. (#24)
  • Contributors: Steven! Ragnar

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
avt_vimba_camera github-astuff-avt_vimba_camera
depthai_filters github-luxonis-depthai-ros
find_object_2d github-introlab-find-object
tf2_ros github-ros2-geometry2
turtle_tf2_cpp github-ros-geometry_tutorials
image_transport github-ros-perception-image_common
camera_calibration github-ros-perception-image_pipeline
depth_image_proc github-ros-perception-image_pipeline
image_view github-ros-perception-image_pipeline
stereo_image_proc github-ros-perception-image_pipeline
imu_complementary_filter github-CCNYRoboticsLab-imu_tools
rviz_imu_plugin github-CCNYRoboticsLab-imu_tools
laser_filters github-ros-perception-laser_filters
swri_image_util github-swri-robotics-marti_common
mavros github-mavlink-mavros
mavros_extras github-mavlink-mavros
moveit_ros_perception github-ros-planning-moveit2
moveit_ros_planning github-ros-planning-moveit2
octomap_server github-OctoMap-octomap_mapping
pcl_conversions github-ros-perception-perception_pcl
pointcloud_to_laserscan github-ros-perception-pointcloud_to_laserscan
rtabmap_odom github-introlab-rtabmap_ros
rtabmap_sync github-introlab-rtabmap_ros
rtabmap_util github-introlab-rtabmap_ros
rviz_common github-ros2-rviz
slam_toolbox github-SteveMacenski-slam_toolbox
spatio_temporal_voxel_layer github-SteveMacenski-spatio_temporal_voxel_layer
turtlebot3_node github-ROBOTIS-GIT-turtlebot3
velodyne_pointcloud github-ros-drivers-velodyne
nav2_amcl github-ros-planning-navigation2
nav2_costmap_2d github-ros-planning-navigation2
system_metrics_collector github-ros-tooling-system_metrics_collector

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged message_filters at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.13.7
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/ros_comm.git
VCS Type git
VCS Version lunar-devel
Last Updated 2019-02-01
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A set of message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.

Additional Links

Maintainers

  • Dirk Thomas

Authors

  • Josh Faust
  • Vijay Pradeep
README
No README found. No README in repository either.
CHANGELOG

Changelog for package message_filters

1.13.7 (2018-08-17)

  • rename Python message_filters.Cache.getLastestTime to getLatestTime (#1450)

1.13.6 (2018-02-05)

  • use SteadyTimer in message_filters (#1247)
  • remove unnecessary xmlrpcpp dependency from message_filters (#1264)

1.13.5 (2017-11-09)

1.13.4 (2017-11-02)

1.13.3 (2017-10-25)

1.13.2 (2017-08-15)

1.13.1 (2017-07-27)

1.13.0 (2017-02-22)

1.12.7 (2017-02-17)

1.12.6 (2016-10-26)

  • use boost::bind to bind the callback function (#906)

1.12.5 (2016-09-30)

1.12.4 (2016-09-19)

1.12.3 (2016-09-17)

  • add fast approximate time synchronization in message_filters (in pure Python) (#802)

1.12.2 (2016-06-03)

  • allow saving timestamp-less messages to Cache, add getLast method (#806)

1.12.1 (2016-04-18)

  • use directory specific compiler flags (#785)

1.12.0 (2016-03-18)

1.11.18 (2016-03-17)

  • fix compiler warnings

1.11.17 (2016-03-11)

  • use boost::make_shared instead of new for constructing boost::shared_ptr (#740)
  • add __getattr_ to handle sub in message_filters as standard one (#700)

1.11.16 (2015-11-09)

1.11.15 (2015-10-13)

  • add unregister() method to message_filter.Subscriber (#683)

1.11.14 (2015-09-19)

1.11.13 (2015-04-28)

1.11.12 (2015-04-27)

1.11.11 (2015-04-16)

  • implement message filter cache in Python (#599)

1.11.10 (2014-12-22)

1.11.9 (2014-08-18)

1.11.8 (2014-08-04)

1.11.7 (2014-07-18)

1.11.6 (2014-07-10)

1.11.5 (2014-06-24)

1.11.4 (2014-06-16)

  • add approximate Python time synchronizer (used to be in camera_calibration) (#424)

1.11.3 (2014-05-21)

1.11.2 (2014-05-08)

1.11.1 (2014-05-07)

  • update API to use boost::signals2 (#267)

1.11.0 (2014-03-04)

  • suppress boost::signals deprecation warning (#362)

1.10.0 (2014-02-11)

1.9.54 (2014-01-27)

1.9.53 (2014-01-14)

  • add kwargs for message_filters.Subscriber

1.9.52 (2014-01-08)

1.9.51 (2014-01-07)

  • update code after refactoring into rosbag_storage and roscpp_core (#299)
  • fix segmentation fault on OS X 10.9 (clang / libc++)

1.9.50 (2013-10-04)

1.9.49 (2013-09-16)

1.9.48 (2013-08-21)

1.9.47 (2013-07-03)

  • check for CATKIN_ENABLE_TESTING to enable configure without tests

1.9.46 (2013-06-18)

1.9.45 (2013-06-06)

  • fix template syntax for signal_.template addCallback() to work with Intel compiler

1.9.44 (2013-03-21)

  • fix install destination for dll\'s under Windows

1.9.43 (2013-03-13)

  • fix exports of message filter symbols for Windows

1.9.42 (2013-03-08)

1.9.41 (2013-01-24)

1.9.40 (2013-01-13)

1.9.39 (2012-12-29)

  • first public release for Groovy

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

System Dependencies

Name
boost

Dependant Packages

Name Repo Deps
avt_vimba_camera github-srv-avt_vimba_camera
image_cb_detector github-ros-perception-calibration
laser_cb_detector github-ros-perception-calibration
find_object_2d github-introlab-find-object
tf github-ros-geometry
tf2_ros github-ros-geometry2
gps_common github-swri-robotics-gps_umd
image_transport github-ros-perception-image_common
camera_calibration github-ros-perception-image_pipeline
depth_image_proc github-ros-perception-image_pipeline
image_view github-ros-perception-image_pipeline
stereo_image_proc github-ros-perception-image_pipeline
imu_transformer github-ros-perception-imu_pipeline
imu_complementary_filter github-ccny-ros-pkg-imu_tools
imu_filter_madgwick github-ccny-ros-pkg-imu_tools
posedetection_msgs github-jsk-ros-pkg-jsk_common_msgs
laser_assembler github-ros-perception-laser_assembler
laser_filters github-ros-perception-laser_filters
swri_image_util github-swri-robotics-marti_common
moveit_ros_perception github-ros-planning-moveit
moveit_ros_planning github-ros-planning-moveit
amcl github-ros-planning-navigation
costmap_2d github-ros-planning-navigation
fake_localization github-ros-planning-navigation
assisted_teleop github-ros-planning-navigation_experimental
track_odometry github-at-wat-neonavigation
nodelet_topic_tools github-ros-nodelet_core
test_nodelet_topic_tools github-ros-nodelet_core
face_detector github-wg-perception-people
leg_detector github-wg-perception-people
people_tracking_filter github-wg-perception-people
pcl_ros github-ros-perception-perception_pcl
pointcloud_to_laserscan github-ros-perception-pointcloud_to_laserscan
pr2_head_action github-pr2-pr2_controllers
robot_mechanism_controllers github-pr2-pr2_controllers
robot_localization github-cra-ros-pkg-robot_localization
ros_comm github-ros-ros_comm
rtabmap_ros github-introlab-rtabmap_ros
rviz github-ros-visualization-rviz
sick_ldmrs_tools github-SICKAG-sick_ldmrs_laser
slam_karto github-ros-perception-slam_karto
uuv_sensor_ros_plugins github-uuvsimulator-uuv_simulator
velo2cam_calibration github-beltransen-velo2cam_calibration
visp_auto_tracker github-lagadic-vision_visp

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged message_filters at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.11.21
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/ros_comm.git
VCS Type git
VCS Version indigo-devel
Last Updated 2017-03-06
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A set of message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.

Additional Links

Maintainers

  • Dirk Thomas

Authors

  • Josh Faust
  • Vijay Pradeep
README
No README found. No README in repository either.
CHANGELOG

Changelog for package message_filters

1.11.21 (2017-03-06)

1.11.20 (2016-06-27)

1.11.19 (2016-04-18)

  • use directory specific compiler flags (#785)

1.11.18 (2016-03-17)

  • fix compiler warnings

1.11.17 (2016-03-11)

  • use boost::make_shared instead of new for constructing boost::shared_ptr (#740)
  • add __getattr_ to handle sub in message_filters as standard one (#700)

1.11.16 (2015-11-09)

1.11.15 (2015-10-13)

  • add unregister() method to message_filter.Subscriber (#683)

1.11.14 (2015-09-19)

1.11.13 (2015-04-28)

1.11.12 (2015-04-27)

1.11.11 (2015-04-16)

  • implement message filter cache in Python (#599)

1.11.10 (2014-12-22)

1.11.9 (2014-08-18)

1.11.8 (2014-08-04)

1.11.7 (2014-07-18)

1.11.6 (2014-07-10)

1.11.5 (2014-06-24)

1.11.4 (2014-06-16)

  • add approximate Python time synchronizer (used to be in camera_calibration) (#424)

1.11.3 (2014-05-21)

1.11.2 (2014-05-08)

1.11.1 (2014-05-07)

  • update API to use boost::signals2 (#267)

1.11.0 (2014-03-04)

  • suppress boost::signals deprecation warning (#362)

1.10.0 (2014-02-11)

1.9.54 (2014-01-27)

1.9.53 (2014-01-14)

  • add kwargs for message_filters.Subscriber

1.9.52 (2014-01-08)

1.9.51 (2014-01-07)

  • update code after refactoring into rosbag_storage and roscpp_core (#299)
  • fix segmentation fault on OS X 10.9 (clang / libc++)

1.9.50 (2013-10-04)

1.9.49 (2013-09-16)

1.9.48 (2013-08-21)

1.9.47 (2013-07-03)

  • check for CATKIN_ENABLE_TESTING to enable configure without tests

1.9.46 (2013-06-18)

1.9.45 (2013-06-06)

  • fix template syntax for signal_.template addCallback() to work with Intel compiler

1.9.44 (2013-03-21)

  • fix install destination for dll\'s under Windows

1.9.43 (2013-03-13)

  • fix exports of message filter symbols for Windows

1.9.42 (2013-03-08)

1.9.41 (2013-01-24)

1.9.40 (2013-01-13)

1.9.39 (2012-12-29)

  • first public release for Groovy

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

System Dependencies

Name
boost

Dependant Packages

Name Repo Deps
image_cb_detector github-ros-perception-calibration
laser_cb_detector github-ros-perception-calibration
depthcloud_encoder github-RobotWebTools-depthcloud_encoder
tf github-ros-geometry
tf2_ros github-ros-geometry2
gps_common github-swri-robotics-gps_umd
hector_pose_estimation github-tu-darmstadt-ros-pkg-hector_localization
hector_mapping github-tu-darmstadt-ros-pkg-hector_slam
image_transport github-ros-perception-image_common
camera_calibration github-ros-perception-image_pipeline
depth_image_proc github-ros-perception-image_pipeline
image_view github-ros-perception-image_pipeline
stereo_image_proc github-ros-perception-image_pipeline
imu_transformer github-ros-perception-imu_pipeline
imu_complementary_filter github-ccny-ros-pkg-imu_tools
imu_filter_madgwick github-ccny-ros-pkg-imu_tools
audio_video_recorder github-jsk-ros-pkg-jsk_common
image_view2 github-jsk-ros-pkg-jsk_common
posedetection_msgs github-jsk-ros-pkg-jsk_common_msgs
jsk_footstep_controller github-jsk-ros-pkg-jsk_control
checkerboard_detector github-jsk-ros-pkg-jsk_recognition
sound_classification github-jsk-ros-pkg-jsk_recognition
jsk_interactive_marker github-jsk-ros-pkg-jsk_visualization
laser_assembler github-ros-perception-laser_assembler
laser_filters github-ros-perception-laser_filters
swri_image_util github-swri-robotics-marti_common
moveit_ros_perception github-ros-planning-moveit
amcl github-ros-planning-navigation
costmap_2d github-ros-planning-navigation
fake_localization github-ros-planning-navigation
nodelet_topic_tools github-ros-nodelet_core
test_nodelet_topic_tools github-ros-nodelet_core
people_tracking_filter github-wg-perception-people
pcl_ros github-ros-perception-perception_pcl
pointcloud_to_laserscan github-ros-perception-pointcloud_to_laserscan
pr2_head_action github-pr2-pr2_controllers
robot_mechanism_controllers github-pr2-pr2_controllers
robot_localization github-cra-ros-pkg-robot_localization
ros_comm github-ros-ros_comm
rtabmap_ros github-introlab-rtabmap_ros
rviz github-ros-visualization-rviz
laser_ortho_projector github-ccny-ros-pkg-scan_tools
sick_ldmrs_tools github-SICKAG-sick_ldmrs_laser
slam_karto github-ros-perception-slam_karto
ublox_msg_filters github-KumarRobotics-ublox
simple_approximate_time_synchronizer github-uos-uos_tools
visp_auto_tracker github-lagadic-vision_visp
hector_barrel_detection_nodelet github-tu-darmstadt-ros-pkg-hector_visualization
nao_description github-ros-naoqi-nao_robot
tiny_slam github-OSLL-tiny-slam-ros-cpp
head_pose_estimation github-OSUrobotics-ros-head-tracking
stereo_slam github-srv-stereo_slam

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged message_filters at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.11.21
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/ros_comm.git
VCS Type git
VCS Version indigo-devel
Last Updated 2017-03-06
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A set of message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.

Additional Links

Maintainers

  • Dirk Thomas

Authors

  • Josh Faust
  • Vijay Pradeep
README
No README found. No README in repository either.
CHANGELOG

Changelog for package message_filters

1.11.21 (2017-03-06)

1.11.20 (2016-06-27)

1.11.19 (2016-04-18)

  • use directory specific compiler flags (#785)

1.11.18 (2016-03-17)

  • fix compiler warnings

1.11.17 (2016-03-11)

  • use boost::make_shared instead of new for constructing boost::shared_ptr (#740)
  • add __getattr_ to handle sub in message_filters as standard one (#700)

1.11.16 (2015-11-09)

1.11.15 (2015-10-13)

  • add unregister() method to message_filter.Subscriber (#683)

1.11.14 (2015-09-19)

1.11.13 (2015-04-28)

1.11.12 (2015-04-27)

1.11.11 (2015-04-16)

  • implement message filter cache in Python (#599)

1.11.10 (2014-12-22)

1.11.9 (2014-08-18)

1.11.8 (2014-08-04)

1.11.7 (2014-07-18)

1.11.6 (2014-07-10)

1.11.5 (2014-06-24)

1.11.4 (2014-06-16)

  • add approximate Python time synchronizer (used to be in camera_calibration) (#424)

1.11.3 (2014-05-21)

1.11.2 (2014-05-08)

1.11.1 (2014-05-07)

  • update API to use boost::signals2 (#267)

1.11.0 (2014-03-04)

  • suppress boost::signals deprecation warning (#362)

1.10.0 (2014-02-11)

1.9.54 (2014-01-27)

1.9.53 (2014-01-14)

  • add kwargs for message_filters.Subscriber

1.9.52 (2014-01-08)

1.9.51 (2014-01-07)

  • update code after refactoring into rosbag_storage and roscpp_core (#299)
  • fix segmentation fault on OS X 10.9 (clang / libc++)

1.9.50 (2013-10-04)

1.9.49 (2013-09-16)

1.9.48 (2013-08-21)

1.9.47 (2013-07-03)

  • check for CATKIN_ENABLE_TESTING to enable configure without tests

1.9.46 (2013-06-18)

1.9.45 (2013-06-06)

  • fix template syntax for signal_.template addCallback() to work with Intel compiler

1.9.44 (2013-03-21)

  • fix install destination for dll\'s under Windows

1.9.43 (2013-03-13)

  • fix exports of message filter symbols for Windows

1.9.42 (2013-03-08)

1.9.41 (2013-01-24)

1.9.40 (2013-01-13)

1.9.39 (2012-12-29)

  • first public release for Groovy

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

System Dependencies

Name
boost

Dependant Packages

Name Repo Deps
asr_aruco_marker_recognition github-asr-ros-asr_aruco_marker_recognition
avt_vimba_camera github-srv-avt_vimba_camera
image_cb_detector github-ros-perception-calibration
laser_cb_detector github-ros-perception-calibration
cob_camera_sensors github-ipa320-cob_driver
cob_map_accessibility_analysis github-ipa320-cob_navigation
cob_cam3d_throttle github-ipa320-cob_perception_common
cob_object_detection_visualizer github-ipa320-cob_perception_common
depthcloud_encoder github-RobotWebTools-depthcloud_encoder
tf github-ros-geometry
tf2_ros github-ros-geometry2
gps_common github-swri-robotics-gps_umd
hector_pose_estimation github-tu-darmstadt-ros-pkg-hector_localization
hector_mapping github-tu-darmstadt-ros-pkg-hector_slam
image_transport github-ros-perception-image_common
camera_calibration github-ros-perception-image_pipeline
depth_image_proc github-ros-perception-image_pipeline
image_view github-ros-perception-image_pipeline
stereo_image_proc github-ros-perception-image_pipeline
imu_transformer github-ros-perception-imu_pipeline
imu_complementary_filter github-ccny-ros-pkg-imu_tools
imu_filter_madgwick github-ccny-ros-pkg-imu_tools
audio_video_recorder github-jsk-ros-pkg-jsk_common
image_view2 github-jsk-ros-pkg-jsk_common
posedetection_msgs github-jsk-ros-pkg-jsk_common_msgs
jsk_footstep_controller github-jsk-ros-pkg-jsk_control
checkerboard_detector github-jsk-ros-pkg-jsk_recognition
sound_classification github-jsk-ros-pkg-jsk_recognition
jsk_interactive_marker github-jsk-ros-pkg-jsk_visualization
kobuki_auto_docking github-yujinrobot-kobuki
laser_assembler github-ros-perception-laser_assembler
laser_filters github-ros-perception-laser_filters
swri_image_util github-swri-robotics-marti_common
moveit_ros_perception github-ros-planning-moveit
amcl github-ros-planning-navigation
costmap_2d github-ros-planning-navigation
fake_localization github-ros-planning-navigation
assisted_teleop github-ros-planning-navigation_experimental
nodelet_topic_tools github-ros-nodelet_core
test_nodelet_topic_tools github-ros-nodelet_core
people_tracking_filter github-wg-perception-people
pcl_ros github-ros-perception-perception_pcl
pointcloud_to_laserscan github-ros-perception-pointcloud_to_laserscan
laser_joint_processor github-PR2-pr2_calibration
pr2_head_action github-pr2-pr2_controllers
robot_mechanism_controllers github-pr2-pr2_controllers
pr2_navigation_perception github-pr2-pr2_navigation
robot_localization github-cra-ros-pkg-robot_localization
ros_comm github-ros-ros_comm
rtabmap_ros github-introlab-rtabmap_ros
rviz github-ros-visualization-rviz
laser_ortho_projector github-ccny-ros-pkg-scan_tools
sick_ldmrs_tools github-SICKAG-sick_ldmrs_laser
slam_karto github-ros-perception-slam_karto
ublox_msg_filters github-KumarRobotics-ublox
simple_approximate_time_synchronizer github-uos-uos_tools
visp_auto_tracker github-lagadic-vision_visp
hector_barrel_detection_nodelet github-tu-darmstadt-ros-pkg-hector_visualization
humanoid_localization github-AravindaDP-humanoid_navigation
rgbd_depth_correction github-ros-industrial-industrial_calibration
nao_description github-ros-naoqi-nao_robot
feature_tracker github-tu-rbo-omip
joint_tracker github-tu-rbo-omip
rb_tracker github-tu-rbo-omip
rb1_base_localization github-RobotnikAutomation-rb1_base_common
bag_tools github-srv-srv_tools
summit_xl_localization github-RobotnikAutomation-summit_xl_common
tiny_slam github-OSLL-tiny-slam-ros-cpp
asctec_hl_gps github-ethz-asl-asctec_mav_framework
bwi_logging github-utexas-bwi-bwi_common
cob_people_tracking_filter github-ipa-rmb-cob_people_perception
head_pose_estimation github-OSUrobotics-ros-head-tracking
segbot_logical_translator github-utexas-bwi-segbot
stereo_slam github-srv-stereo_slam
viso2_ros github-srv-viso2
dlut_viso2_ros github-ZhuangYanDLUT-dlut_vision
selective_dualarm_stowing github-start-jsk-jsk_apc
jsk_apc2016_common github-start-jsk-jsk_apc
drc_task_common github-jsk-ros-pkg-jsk_demos
micros_dynamic_objects_filter github-yincanben-micros_dynamic_objects_filter
micros_mars_task_alloc github-liminglong-micros_mars_task_alloc

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged message_filters at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.10.12
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/ros_comm.git
VCS Type git
VCS Version hydro-devel
Last Updated 2014-12-29
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A set of message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.

Additional Links

Maintainers

  • Dirk Thomas

Authors

  • Josh Faust
  • Vijay Pradeep
README
No README found. No README in repository either.
CHANGELOG

Changelog for package message_filters

1.10.12 (2014-12-29)

1.10.11 (2014-08-18)

1.10.10 (2014-06-16)

1.10.3 (2014-06-02)

1.10.2 (2014-03-03)

1.10.1 (2014-02-25)

1.9.54 (2014-01-27)

1.9.53 (2014-01-14)

  • add kwargs for message_filters.Subscriber

1.9.52 (2014-01-08)

1.9.51 (2014-01-07)

  • update code after refactoring into rosbag_storage and roscpp_core (#299)
  • fix segmentation fault on OS X 10.9 (clang / libc++)

1.9.50 (2013-10-04)

1.9.49 (2013-09-16)

1.9.48 (2013-08-21)

1.9.47 (2013-07-03)

  • check for CATKIN_ENABLE_TESTING to enable configure without tests

1.9.46 (2013-06-18)

1.9.45 (2013-06-06)

  • fix template syntax for signal.template addCallback() to work with Intel compiler

1.9.44 (2013-03-21)

  • fix install destination for dll\'s under Windows

1.9.43 (2013-03-13)

  • fix exports of message filter symbols for Windows

1.9.42 (2013-03-08)

1.9.41 (2013-01-24)

1.9.40 (2013-01-13)

1.9.39 (2012-12-29)

  • first public release for Groovy

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

System Dependencies

Name
boost

Dependant Packages

Name Repo Deps
image_cb_detector github-ros-perception-calibration
laser_cb_detector github-ros-perception-calibration
cob_interactive_teleop github-ipa320-cob_command_tools
cob_camera_sensors github-ipa320-cob_driver
cob_sick_s300 github-ipa320-cob_driver
cob_cam3d_throttle github-ipa320-cob_perception_common
depthcloud_encoder github-RobotWebTools-depthcloud_encoder
tf github-ros-geometry
tf2_ros github-ros-geometry2
gps_common github-ktossell-gps_umd
hector_pose_estimation github-tu-darmstadt-ros-pkg-hector_localization
hector_mapping github-tu-darmstadt-ros-pkg-hector_slam
image_transport github-ros-perception-image_common
camera_calibration github-ros-perception-image_pipeline
depth_image_proc github-ros-perception-image_pipeline
image_view github-ros-perception-image_pipeline
stereo_image_proc github-ros-perception-image_pipeline
imu_filter_madgwick github-ccny-ros-pkg-imu_tools
audio_video_recorder github-jsk-ros-pkg-jsk_common
image_view2 github-jsk-ros-pkg-jsk_common
posedetection_msgs github-jsk-ros-pkg-jsk_common_msgs
jsk_footstep_controller github-jsk-ros-pkg-jsk_control
checkerboard_detector github-jsk-ros-pkg-jsk_recognition
sound_classification github-jsk-ros-pkg-jsk_recognition
jsk_interactive_marker github-jsk-ros-pkg-jsk_visualization
kobuki_auto_docking github-yujinrobot-kobuki
laser_assembler github-ros-perception-laser_assembler
laser_filters github-ros-perception-laser_filters
amcl github-ros-planning-navigation
costmap_2d github-ros-planning-navigation
fake_localization github-ros-planning-navigation
nodelet_topic_tools github-ros-nodelet_core
test_nodelet_topic_tools github-ros-nodelet_core
people_tracking_filter github-wg-perception-people
pcl_ros github-ros-perception-perception_pcl
pointcloud_to_laserscan github-ros-perception-perception_pcl
laser_joint_processor github-PR2-pr2_calibration
pr2_head_action github-PR2-pr2_controllers
robot_mechanism_controllers github-PR2-pr2_controllers
pr2_navigation_perception github-pr2-pr2_navigation
robot_localization github-cra-ros-pkg-robot_localization
ros_comm github-ros-ros_comm
rtabmap_ros github-introlab-rtabmap_ros
rviz github-ros-visualization-rviz
slam_karto github-ros-perception-slam_karto
simple_approximate_time_synchronizer github-uos-uos_tools
visp_auto_tracker github-lagadic-vision_visp
hector_barrel_detection_nodelet github-tu-darmstadt-ros-pkg-hector_visualization
humanoid_localization github-ahornung-humanoid_navigation
nao_description github-ros-naoqi-nao_robot
bag_tools github-srv-srv_tools
asctec_hl_gps github-ethz-asl-asctec_mav_framework
cob_people_tracking_filter github-ipa-rmb-cob_people_perception
ethzasl_icp_mapper github-ethz-asl-ethzasl_icp_mapping
head_pose_estimation github-OSUrobotics-ros-head-tracking
moveit_ros_perception github-ros-planning-moveit_ros
ndt_mcl github-tstoyanov-perception_oru-release
segbot_logical_translator github-utexas-bwi-segbot_apps
viso2_ros github-srv-viso2

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged message_filters at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.12.17
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/ros_comm.git
VCS Type git
VCS Version kinetic-devel
Last Updated 2020-10-26
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A set of message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.

Additional Links

Maintainers

  • Jacob Perron
  • Michael Carroll
  • Shane Loretz

Authors

  • Josh Faust
  • Vijay Pradeep
  • Dirk Thomas
README
No README found. No README in repository either.
CHANGELOG

Changelog for package message_filters

1.12.17 (2020-10-26)

  • Update maintainers (#2075)
  • Contributors: Jacob Perron, Shane Loretz

1.12.16 (2020-08-26)

1.12.15 (2020-08-10)

  • add \'template\' to resolve compile error (#1685)

1.12.14 (2018-08-23)

  • rename Python message_filters.Cache.getLastestTime to getLatestTime (#1450)

1.12.13 (2018-02-21)

1.12.12 (2017-11-16)

1.12.11 (2017-11-07)

1.12.10 (2017-11-06)

1.12.9 (2017-11-06)

1.12.8 (2017-11-06)

1.12.7 (2017-02-17)

1.12.6 (2016-10-26)

  • use boost::bind to bind the callback function (#906)

1.12.5 (2016-09-30)

1.12.4 (2016-09-19)

1.12.3 (2016-09-17)

  • add fast approximate time synchronization in message_filters (in pure Python) (#802)

1.12.2 (2016-06-03)

  • allow saving timestamp-less messages to Cache, add getLast method (#806)

1.12.1 (2016-04-18)

  • use directory specific compiler flags (#785)

1.12.0 (2016-03-18)

1.11.18 (2016-03-17)

  • fix compiler warnings

1.11.17 (2016-03-11)

  • use boost::make_shared instead of new for constructing boost::shared_ptr (#740)
  • add __getattr_ to handle sub in message_filters as standard one (#700)

1.11.16 (2015-11-09)

1.11.15 (2015-10-13)

  • add unregister() method to message_filter.Subscriber (#683)

1.11.14 (2015-09-19)

1.11.13 (2015-04-28)

1.11.12 (2015-04-27)

1.11.11 (2015-04-16)

  • implement message filter cache in Python (#599)

1.11.10 (2014-12-22)

1.11.9 (2014-08-18)

1.11.8 (2014-08-04)

1.11.7 (2014-07-18)

1.11.6 (2014-07-10)

1.11.5 (2014-06-24)

1.11.4 (2014-06-16)

  • add approximate Python time synchronizer (used to be in camera_calibration) (#424)

1.11.3 (2014-05-21)

1.11.2 (2014-05-08)

1.11.1 (2014-05-07)

  • update API to use boost::signals2 (#267)

1.11.0 (2014-03-04)

  • suppress boost::signals deprecation warning (#362)

1.10.0 (2014-02-11)

1.9.54 (2014-01-27)

1.9.53 (2014-01-14)

  • add kwargs for message_filters.Subscriber

1.9.52 (2014-01-08)

1.9.51 (2014-01-07)

  • update code after refactoring into rosbag_storage and roscpp_core (#299)
  • fix segmentation fault on OS X 10.9 (clang / libc++)

1.9.50 (2013-10-04)

1.9.49 (2013-09-16)

1.9.48 (2013-08-21)

1.9.47 (2013-07-03)

  • check for CATKIN_ENABLE_TESTING to enable configure without tests

1.9.46 (2013-06-18)

1.9.45 (2013-06-06)

  • fix template syntax for signal_.template addCallback() to work with Intel compiler

1.9.44 (2013-03-21)

  • fix install destination for dll\'s under Windows

1.9.43 (2013-03-13)

  • fix exports of message filter symbols for Windows

1.9.42 (2013-03-08)

1.9.41 (2013-01-24)

1.9.40 (2013-01-13)

1.9.39 (2012-12-29)

  • first public release for Groovy

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

System Dependencies

Name
boost

Dependant Packages

Name Repo Deps
asr_aruco_marker_recognition github-asr-ros-asr_aruco_marker_recognition
avt_vimba_camera github-astuff-avt_vimba_camera
image_cb_detector github-ros-perception-calibration
laser_cb_detector github-ros-perception-calibration
cob_map_accessibility_analysis github-ipa320-cob_navigation
cob_cam3d_throttle github-ipa320-cob_perception_common
cob_object_detection_visualizer github-ipa320-cob_perception_common
dataspeed_pds_can bitbucket-DataspeedInc-dataspeed_pds
dataspeed_pds_lcm bitbucket-DataspeedInc-dataspeed_pds
depthcloud_encoder github-RobotWebTools-depthcloud_encoder
find_object_2d github-introlab-find-object
tf github-ros-geometry
tf2_ros github-ros-geometry2
gps_common github-swri-robotics-gps_umd
hector_pose_estimation github-tu-darmstadt-ros-pkg-hector_localization
hector_mapping github-tu-darmstadt-ros-pkg-hector_slam
image_transport github-ros-perception-image_common
camera_calibration github-ros-perception-image_pipeline
depth_image_proc github-ros-perception-image_pipeline
image_view github-ros-perception-image_pipeline
stereo_image_proc github-ros-perception-image_pipeline
imu_transformer github-ros-perception-imu_pipeline
imu_complementary_filter github-ccny-ros-pkg-imu_tools
imu_filter_madgwick github-ccny-ros-pkg-imu_tools
audio_video_recorder github-jsk-ros-pkg-jsk_common
image_view2 github-jsk-ros-pkg-jsk_common
posedetection_msgs github-jsk-ros-pkg-jsk_common_msgs
jsk_footstep_controller github-jsk-ros-pkg-jsk_control
checkerboard_detector github-jsk-ros-pkg-jsk_recognition
sound_classification github-jsk-ros-pkg-jsk_recognition
jsk_interactive_marker github-jsk-ros-pkg-jsk_visualization
kobuki_auto_docking github-yujinrobot-kobuki
laser_assembler github-ros-perception-laser_assembler
laser_filters github-ros-perception-laser_filters
swri_image_util github-swri-robotics-marti_common
moveit_ros_perception github-ros-planning-moveit
moveit_ros_planning github-ros-planning-moveit
amcl github-ros-planning-navigation
costmap_2d github-ros-planning-navigation
fake_localization github-ros-planning-navigation
assisted_teleop github-ros-planning-navigation_experimental
track_odometry github-at-wat-neonavigation
nodelet_topic_tools github-ros-nodelet_core
test_nodelet_topic_tools github-ros-nodelet_core
nonpersistent_voxel_layer github-SteveMacenski-nonpersistent_voxel_layer
face_detector github-wg-perception-people
leg_detector github-wg-perception-people
people_tracking_filter github-wg-perception-people
pcl_ros github-ros-perception-perception_pcl
prbt_hardware_support github-PilzDE-pilz_robots
pointcloud_to_laserscan github-ros-perception-pointcloud_to_laserscan
laser_joint_processor github-UNR-RoboticsResearchLab-pr2_calibration
pr2_head_action github-pr2-pr2_controllers
robot_mechanism_controllers github-pr2-pr2_controllers
pr2_navigation_perception github-PR2-prime-pr2_navigation
robot_localization github-cra-ros-pkg-robot_localization
ros_comm github-ros-ros_comm
rtabmap_ros github-introlab-rtabmap_ros
rviz github-ros-visualization-rviz
laser_ortho_projector github-ccny-ros-pkg-scan_tools
sick_ldmrs_tools github-SICKAG-sick_ldmrs_laser
slam_karto github-ros-perception-slam_karto
spatio_temporal_voxel_layer github-SteveMacenski-spatio_temporal_voxel_layer
ublox_msg_filters github-KumarRobotics-ublox
simple_approximate_time_synchronizer github-uos-uos_tools
uuv_sensor_ros_plugins github-uuvsimulator-uuv_simulator
velo2cam_calibration github-beltransen-velo2cam_calibration
visp_auto_tracker github-lagadic-vision_visp
hector_barrel_detection_nodelet github-tu-darmstadt-ros-pkg-hector_visualization
humanoid_localization github-ROBOTIS-GIT-humanoid_navigation
rgbd_depth_correction github-ros-industrial-industrial_calibration
nao_description github-ros-naoqi-nao_robot
feature_tracker github-tu-rbo-omip
joint_tracker github-tu-rbo-omip
rb_tracker github-tu-rbo-omip
rb1_base_localization github-RobotnikAutomation-rb1_base_common
slam_constructor github-OSLL-slam-constructor
bag_tools github-srv-srv_tools
summit_xl_localization github-RobotnikAutomation-summit_xl_common
tiny_slam github-OSLL-tiny-slam-ros-cpp
xiaoqiang_depth_image_proc github-bluewhalerobot-xiaoqiang

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged message_filters at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.14.13
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/ros_comm.git
VCS Type git
VCS Version melodic-devel
Last Updated 2022-01-26
Dev Status MAINTAINED
CI status
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A set of message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.

Additional Links

Maintainers

  • Jacob Perron
  • Michael Carroll
  • Shane Loretz

Authors

  • Josh Faust
  • Vijay Pradeep
  • Dirk Thomas
README
No README found. No README in repository either.
CHANGELOG

Changelog for package message_filters

1.14.13 (2022-01-25)

1.14.12 (2021-09-21)

1.14.11 (2021-04-26)

1.14.10 (2020-10-16)

  • Update maintainers (#2075)
  • Contributors: Jacob Perron, Shane Loretz

1.14.9 (2020-08-20)

1.14.8 (2020-08-12)

1.14.7 (2020-07-31)

1.14.6 (2020-05-29)

1.14.5 (2020-03-19)

1.14.4 (2020-02-20)

  • bump CMake minimum version to avoid CMP0048 warning (#1869)
  • add overload of ApproximateTime::setInterMessageLowerBound() to set all topics to the same value (#1860)
  • update approximate time filter to work with Python 2 and 3 (#1660)
  • message_filters/__init_.py - Added reduce import for Python 3 compatability (#1633)
  • remove messages that are newer than the newly added message (#1438)
  • remove signals from find_package(Boost COMPONENTS ...) (#1580)
  • fix message_filters build issue on the template syntax (#1483)

1.14.3 (2018-08-06)

  • call Subscriber::unsubscribe() in destructor (#1434)
  • rename Python message_filters.Cache.getLastestTime to getLatestTime (#1450)

1.14.2 (2018-06-06)

1.14.1 (2018-05-21)

1.14.0 (2018-05-21)

  • change invocation to [add]{.title-ref} to conform template syntax (#1388)
  • fix sphinx warning (#1371)

1.13.6 (2018-02-05)

  • use SteadyTimer in message_filters (#1247)
  • remove unnecessary xmlrpcpp dependency from message_filters (#1264)

1.13.5 (2017-11-09)

1.13.4 (2017-11-02)

1.13.3 (2017-10-25)

1.13.2 (2017-08-15)

1.13.1 (2017-07-27)

1.13.0 (2017-02-22)

1.12.7 (2017-02-17)

1.12.6 (2016-10-26)

  • use boost::bind to bind the callback function (#906)

1.12.5 (2016-09-30)

1.12.4 (2016-09-19)

1.12.3 (2016-09-17)

  • add fast approximate time synchronization in message_filters (in pure Python) (#802)

1.12.2 (2016-06-03)

  • allow saving timestamp-less messages to Cache, add getLast method (#806)

1.12.1 (2016-04-18)

  • use directory specific compiler flags (#785)

1.12.0 (2016-03-18)

1.11.18 (2016-03-17)

  • fix compiler warnings

1.11.17 (2016-03-11)

  • use boost::make_shared instead of new for constructing boost::shared_ptr (#740)
  • add __getattr_ to handle sub in message_filters as standard one (#700)

1.11.16 (2015-11-09)

1.11.15 (2015-10-13)

  • add unregister() method to message_filter.Subscriber (#683)

1.11.14 (2015-09-19)

1.11.13 (2015-04-28)

1.11.12 (2015-04-27)

1.11.11 (2015-04-16)

  • implement message filter cache in Python (#599)

1.11.10 (2014-12-22)

1.11.9 (2014-08-18)

1.11.8 (2014-08-04)

1.11.7 (2014-07-18)

1.11.6 (2014-07-10)

1.11.5 (2014-06-24)

1.11.4 (2014-06-16)

  • add approximate Python time synchronizer (used to be in camera_calibration) (#424)

1.11.3 (2014-05-21)

1.11.2 (2014-05-08)

1.11.1 (2014-05-07)

  • update API to use boost::signals2 (#267)

1.11.0 (2014-03-04)

  • suppress boost::signals deprecation warning (#362)

1.10.0 (2014-02-11)

1.9.54 (2014-01-27)

1.9.53 (2014-01-14)

  • add kwargs for message_filters.Subscriber

1.9.52 (2014-01-08)

1.9.51 (2014-01-07)

  • update code after refactoring into rosbag_storage and roscpp_core (#299)
  • fix segmentation fault on OS X 10.9 (clang / libc++)

1.9.50 (2013-10-04)

1.9.49 (2013-09-16)

1.9.48 (2013-08-21)

1.9.47 (2013-07-03)

  • check for CATKIN_ENABLE_TESTING to enable configure without tests

1.9.46 (2013-06-18)

1.9.45 (2013-06-06)

  • fix template syntax for signal_.template addCallback() to work with Intel compiler

1.9.44 (2013-03-21)

  • fix install destination for dll\'s under Windows

1.9.43 (2013-03-13)

  • fix exports of message filter symbols for Windows

1.9.42 (2013-03-08)

1.9.41 (2013-01-24)

1.9.40 (2013-01-13)

1.9.39 (2012-12-29)

  • first public release for Groovy

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

System Dependencies

Name
boost

Dependant Packages

Name Repo Deps
asr_aruco_marker_recognition github-asr-ros-asr_aruco_marker_recognition
avt_vimba_camera github-astuff-avt_vimba_camera
image_cb_detector github-ros-perception-calibration
laser_cb_detector github-ros-perception-calibration
cob_map_accessibility_analysis github-ipa320-cob_navigation
cob_cam3d_throttle github-ipa320-cob_perception_common
cob_object_detection_visualizer github-ipa320-cob_perception_common
points_preprocessor github-nobleo-core_perception
dataspeed_pds_can bitbucket-DataspeedInc-dataspeed_pds
dataspeed_pds_lcm bitbucket-DataspeedInc-dataspeed_pds
depthcloud_encoder github-RobotWebTools-depthcloud_encoder
find_object_2d github-introlab-find-object
tf github-ros-geometry
tf2_ros github-ros-geometry2
tf2_ros github-jsk-ros-pkg-geometry2_python3
gps_common github-swri-robotics-gps_umd
hector_pose_estimation github-tu-darmstadt-ros-pkg-hector_localization
hector_mapping github-tu-darmstadt-ros-pkg-hector_slam
image_transport github-ros-perception-image_common
camera_calibration github-ros-perception-image_pipeline
depth_image_proc github-ros-perception-image_pipeline
image_view github-ros-perception-image_pipeline
stereo_image_proc github-ros-perception-image_pipeline
imu_transformer github-ros-perception-imu_pipeline
imu_complementary_filter github-CCNYRoboticsLab-imu_tools
imu_filter_madgwick github-CCNYRoboticsLab-imu_tools
iris_lama_ros github-iris-ua-iris_lama_ros
audio_video_recorder github-jsk-ros-pkg-jsk_common
image_view2 github-jsk-ros-pkg-jsk_common
posedetection_msgs github-jsk-ros-pkg-jsk_common_msgs
jsk_footstep_controller github-jsk-ros-pkg-jsk_control
checkerboard_detector github-jsk-ros-pkg-jsk_recognition
sound_classification github-jsk-ros-pkg-jsk_recognition
jsk_interactive_marker github-jsk-ros-pkg-jsk_visualization
kobuki_auto_docking github-yujinrobot-kobuki
laser_assembler github-ros-perception-laser_assembler
laser_filters github-ros-perception-laser_filters
swri_image_util github-swri-robotics-marti_common
moveit_ros_perception github-ros-planning-moveit
moveit_ros_planning github-ros-planning-moveit
amcl github-ros-planning-navigation
costmap_2d github-ros-planning-navigation
fake_localization github-ros-planning-navigation
assisted_teleop github-ros-planning-navigation_experimental
track_odometry github-at-wat-neonavigation
nodelet_topic_tools github-ros-nodelet_core
test_nodelet_topic_tools github-ros-nodelet_core
nonpersistent_voxel_layer github-SteveMacenski-nonpersistent_voxel_layer
face_detector github-wg-perception-people
leg_detector github-wg-perception-people
people_tracking_filter github-wg-perception-people
pcl_ros github-ros-perception-perception_pcl
prbt_hardware_support github-PilzDE-pilz_robots
point_cloud_transport github-ctu-vras-point_cloud_transport
pointcloud_to_laserscan github-ros-perception-pointcloud_to_laserscan
laser_joint_processor github-UNR-RoboticsResearchLab-pr2_calibration
pr2_head_action github-pr2-pr2_controllers
robot_mechanism_controllers github-pr2-pr2_controllers
pr2_navigation_perception github-PR2-pr2_navigation
radial_menu_example github-yoshito-n-students-radial_menu_ros
robot_localization github-cra-ros-pkg-robot_localization
ros_comm github-ros-ros_comm
rtabmap_ros github-introlab-rtabmap_ros
rviz github-ros-visualization-rviz
laser_ortho_projector github-ccny-ros-pkg-scan_tools
sick_ldmrs_tools github-SICKAG-sick_ldmrs_laser
slam_karto github-ros-perception-slam_karto
slam_toolbox github-SteveMacenski-slam_toolbox
spatio_temporal_voxel_layer github-SteveMacenski-spatio_temporal_voxel_layer
ublox_msg_filters github-KumarRobotics-ublox
uuv_sensor_ros_plugins github-uuvsimulator-uuv_simulator
velo2cam_calibration github-beltransen-velo2cam_calibration
visp_auto_tracker github-lagadic-vision_visp

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged message_filters at Robotics Stack Exchange