test_bag.cpp File Reference

#include "rosbag/bag.h"
#include "rosbag/chunked_file.h"
#include "rosbag/view.h"
#include <sys/stat.h>
#include <sys/types.h>
#include <iostream>
#include <set>
#include <boost/assign/list_of.hpp>
#include <boost/foreach.hpp>
#include <gtest/gtest.h>
#include "std_msgs/String.h"
#include "std_msgs/Int32.h"
Include dependency graph for test_bag.cpp:

Go to the source code of this file.

Classes

class  BagTest

Defines

#define foreach   BOOST_FOREACH

Functions

int main (int argc, char **argv)
 TEST (rosbag, modify_bag_works)
 TEST (rosbag, modify_view_works)
 TEST (rosbag, no_min_time)
 TEST (rosbag, overlapping_query_works)
 TEST (rosbag, multiple_bag_works)
 TEST (rosbag, bad_topic_query_works)
 TEST (rosbag, topic_query_works)
 TEST (rosbag, time_query_works)
 TEST (rosbag, write_then_read_without_read_mode_fails)
 TEST (rosbag, read_indexed_1_2_succeeds)
 TEST (rosbag, append_indexed_1_2_fails)
 TEST (rosbag, simple_write_and_read_works)
 TEST_F (BagTest, read_then_write_without_write_mode_fails)
 TEST_F (BagTest, bag_not_open_fails)
 TEST_F (BagTest, reopen_works)
 TEST_F (BagTest, different_writes)
 TEST_F (BagTest, append_works)
 TEST_F (BagTest, write_then_read_works)

Define Documentation

#define foreach   BOOST_FOREACH

Definition at line 46 of file test_bag.cpp.


Function Documentation

int main ( int  argc,
char **  argv 
)

Definition at line 649 of file test_bag.cpp.

TEST ( rosbag  ,
modify_bag_works   
)

Definition at line 581 of file test_bag.cpp.

TEST ( rosbag  ,
modify_view_works   
)

Definition at line 515 of file test_bag.cpp.

TEST ( rosbag  ,
no_min_time   
)

Definition at line 499 of file test_bag.cpp.

TEST ( rosbag  ,
overlapping_query_works   
)

Definition at line 436 of file test_bag.cpp.

TEST ( rosbag  ,
multiple_bag_works   
)

Definition at line 397 of file test_bag.cpp.

TEST ( rosbag  ,
bad_topic_query_works   
)

Definition at line 360 of file test_bag.cpp.

TEST ( rosbag  ,
topic_query_works   
)

Definition at line 322 of file test_bag.cpp.

TEST ( rosbag  ,
time_query_works   
)

Definition at line 287 of file test_bag.cpp.

TEST ( rosbag  ,
write_then_read_without_read_mode_fails   
)

Definition at line 250 of file test_bag.cpp.

TEST ( rosbag  ,
read_indexed_1_2_succeeds   
)

Definition at line 234 of file test_bag.cpp.

TEST ( rosbag  ,
append_indexed_1_2_fails   
)

Definition at line 223 of file test_bag.cpp.

TEST ( rosbag  ,
simple_write_and_read_works   
)

Definition at line 180 of file test_bag.cpp.

TEST_F ( BagTest  ,
read_then_write_without_write_mode_fails   
)

Definition at line 271 of file test_bag.cpp.

TEST_F ( BagTest  ,
bag_not_open_fails   
)

Definition at line 168 of file test_bag.cpp.

TEST_F ( BagTest  ,
reopen_works   
)

Definition at line 149 of file test_bag.cpp.

TEST_F ( BagTest  ,
different_writes   
)

Definition at line 126 of file test_bag.cpp.

TEST_F ( BagTest  ,
append_works   
)

Definition at line 110 of file test_bag.cpp.

TEST_F ( BagTest  ,
write_then_read_works   
)

Definition at line 98 of file test_bag.cpp.

 All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator Friends Defines


rosbag
Author(s): Jeremy Leibs (leibs@willowgarage.com), James Bowman (jamesb@willowgarage.com), Ken Conley (kwc@willowgarage.com), and Tim Field (tfield@willowgarage.com)
autogenerated on Fri Jan 11 10:11:42 2013